• Stars
    star
    177
  • Rank 214,681 (Top 5 %)
  • Language
    C++
  • Created about 12 years ago
  • Updated about 2 months ago

Reviews

There are no reviews yet. Be the first to send feedback to the community and the maintainers!

Repository Details

Commonly used messages in ROS. Includes messages for actions (actionlib_msgs), diagnostics (diagnostic_msgs), geometric primitives (geometry_msgs), robot navigation (nav_msgs), and common sensors (sensor_msgs), such as laser range finders, cameras, point clouds.

More Repositories

1

ros

Core ROS packages
Python
2,741
star
2

rosdistro

This repo maintains a lists of repositories for each ROS distribution
Python
905
star
3

ros_tutorials

Code used in tutorials found on ROS wiki
C++
785
star
4

ros_comm

ROS communications-related packages, including core client libraries (roscpp, rospy, roslisp) and graph introspection tools (rostopic, rosnode, rosservice, rosparam).
Python
750
star
5

meta-ros

OpenEmbedded Layers for ROS 1 and ROS 2
BitBake
381
star
6

solidworks_urdf_exporter

SolidWorks to URDF Exporter
C#
357
star
7

catkin

A CMake-based build system that is used to build all packages in ROS.
Python
317
star
8

urdf_tutorial

CMake
221
star
9

geometry2

A set of ROS packages for keeping track of coordinate transforms.
C++
189
star
10

geometry

Packages for common geometric calculations including the ROS transform library, "tf". Also includes ROS bindings for "bullet" physics engine and "kdl" kinematics/dynamics package.
C++
172
star
11

executive_smach

A procedural python-based task execution framework with ROS integration.
Python
168
star
12

cheatsheet

The ROS Cheatsheet source
TeX
122
star
13

urdfdom

URDF parser
C++
97
star
14

actionlib

Provides a standardized interface for interfacing with preemptable tasks. Examples of this include moving the base to a target location, performing a laser scan and returning the resulting point cloud, detecting the handle of a door, etc.
C++
96
star
15

diagnostics

Packages related to gathering, viewing, and analyzing diagnostics data from robots.
C++
88
star
16

roscpp_core

ros distribution sandbox
C++
88
star
17

robot_state_publisher

Allows you to publish the state of a robot (i.e the position of its base and all joints) via the "tf" transform library
C++
86
star
18

rosbag_snapshot

C++
85
star
19

xacro

Xacro is an XML macro language. With xacro, you can construct shorter and more readable XML files by using macros that expand to larger XML expressions.
Python
85
star
20

urdf_parser_py

Standalone URDF parser for Python.
Python
81
star
21

urdf

Repository for URDF parsing code
C++
63
star
22

kdl_parser

kdl_parser and kdl_parser_py provide tools to construct a KDL tree from an XML robot representation in URDF.
C++
63
star
23

common_tutorials

ROS common_tutorials stack migrated from https://code.ros.org/svn/ros-pkg/stacks/common_tutorials/branches/common_tutorials-0.1/
C++
61
star
24

urdf_sim_tutorial

CMake
57
star
25

angles

Python
53
star
26

pluginlib

Library for loading/unloading plugins in ROS packages during runtime
C++
50
star
27

dynamic_reconfigure

Python
47
star
28

roslisp

Client library for writing ROS nodes in idiomatic Common Lisp
Common Lisp
46
star
29

joint_state_publisher

http://wiki.ros.org/joint_state_publisher
Python
46
star
30

nodelet_core

Allows one to create "nodelets" -- ROS node-like entities that run within the same process so as to avoid IPC and serialization overhead
C++
46
star
31

filters

This library provides a standardized interface for processing data as a sequence of filters. This package contains a base class upon which to build specific implementations as well as an interface which dynamically loads filters based on runtime parameters.
C++
38
star
32

robot_model

Contains packages for modeling various aspects of robot information, specified in the Xml Robot Description Format (URDF). The core package of this stack is urdf, which parses URDF files, and constructs an object model (C++) of the robot.
CMake
36
star
33

bond_core

Maintains a bond (i.e. heart beat ) between ROS nodes and provides feedback when the bond is broken
C++
35
star
34

class_loader

ROS-independent library for dynamic class (i.e. plugin) introspection and loading from runtime libraries
C++
34
star
35

ros-overlay

Gentoo Overlay for ROS packages
Shell
33
star
36

cmake_modules

A common repository for CMake Modules which are not distributed with CMake but are commonly used by ROS packages.
CMake
33
star
37

std_msgs

Contains minimal messages of primitive data types and multiarrays. Intended for quick prototyping, not production use.
C
32
star
38

sdformat_urdf

A urdf_parser_plugin using libsdformat to parse SDFormat XML into URDF structures
C++
32
star
39

geometry_tutorials

ROS geometry_tutorials stack migrated from https://kforge.ros.org/geometry/tutorials/branches
Python
31
star
40

genpy

genpy
Python
30
star
41

collada_urdf

Contains packages for converting collada files into URDF
C++
28
star
42

genmsg

Standalone Python library for generating ROS message and service data structures for various languages
Python
28
star
43

roslint

Lint macros for ROS packages
Python
27
star
44

urdfdom_headers

Headers for URDF parsers
C++
27
star
45

urdf_launch

Launch files for common URDF operations
Python
25
star
46

gencpp

ROS C++ message definition and serialization generators
Python
25
star
47

catkin_tutorials

Source and build files generated by the catkin tutorials on the ros.org wiki.
CMake
23
star
48

console_bridge

A ROS-independent package for logging that seamlessly pipes into rosconsole/rosout for ROS-dependent packages.
C++
21
star
49

rosconsole

C++
17
star
50

ros_realtime

C++
16
star
51

rospack

A command-line tool for retrieving information about ROS packages available on the filesystem
C++
15
star
52

metapackages

Variants for ROS (implemented as metapackages)
CMake
11
star
53

resource_retriever

Package used to retrieve resources of different kinds, e.g. http://, file://, the ROS specific package://, etc.
C++
8
star
54

roslisp_common

Clone of the old roslisp_common SVN repo from code.ros.org.
Common Lisp
8
star
55

homebrew-deps

Homebrew Formula for common system ROS dependencies
Ruby
8
star
56

convex_decomposition

C++
6
star
57

genlisp

Lisp message generation for ROS
Python
6
star
58

ivcon

C++
5
star
59

eigen_stl_containers

C++
5
star
60

ros_comm_msgs

CMake
5
star
61

rosconsole_bridge

Pipes console_bridge output to rosconsole/rosout when console_bridge is used in a ROS-dependent package
C++
4
star
62

message_generation

CMake
4
star
63

meta-ros-webos

Shell
3
star
64

documentation

Python
3
star
65

flirtlib

C++
3
star
66

swig-wx

Custom version of swig for wxPython, used by rx (deprecated)
C++
3
star
67

ros_message_user_examples

How to use ros messages in a "standalone" way
C++
3
star
68

gentypelibxml

supposed to generate typelib xml, but is more of a hello-world for message generators
Python
2
star
69

ros_environment

EmberScript
2
star
70

rosbag_image_compressor

A utility for compressing images in rosbags
Python
2
star
71

homebrew-hydro

Hydro packages and dependencies repository for Homebrew
Ruby
2
star
72

roslisp_repl

Tiny script for running emacs and slime to interactively work with roslisp.
Emacs Lisp
2
star
73

tf2_visualization

Python
2
star
74

langs-dev

1
star
75

rosbag_migration_rule

CMake
1
star
76

media_export

Placeholder package enabling generic export of media paths.
CMake
1
star
77

message_runtime

CMake
1
star
78

langs

a meta package for pulling generators
1
star