Package list
dev-ros / actionlib : Provides a standardized interface for interfacing with preemptable tasks
dev-ros / actionlib_msgs : Common messages to interact with an action server and an action client
dev-ros / actionlib_tools : Tools for dealing with actionlib
dev-ros / actionlib_tutorials : Actionlib tutorials
dev-ros / amcl : Probabilistic localization system for a robot moving in 2D
dev-ros / ament_cmake_copyright : The auto-magic functions for ease to use of the ament linters
dev-ros / ament_cmake_core : The core of the ament buildsystem in CMake
dev-ros / ament_cmake_cppcheck : CMake API for ament_cppcheck to perform static code analysis on C/C++
dev-ros / ament_cmake_cpplint : CMake API for ament_cpplint to lint C / C++ code using cpplint
dev-ros / ament_cmake_export_definitions : Export definitions to downstream packages in the ament buildsystem
dev-ros / ament_cmake_export_dependencies : Export dependencies to downstream packages in the ament buildsystem in CMake
dev-ros / ament_cmake_export_include_directories : Export include directories to downstream packages in the ament buildsystem
dev-ros / ament_cmake_export_interfaces : Export interfaces to downstream packages in the ament buildsystem
dev-ros / ament_cmake_export_libraries : Export libraries to downstream packages in the ament buildsystem
dev-ros / ament_cmake_export_link_flags : Export link flags to downstream packages in the ament buildsystem
dev-ros / ament_cmake_export_targets : Export targets to downstream packages in the ament buildsystem
dev-ros / ament_cmake_gen_version_h : Generate a C header containing the version number of the package
dev-ros / ament_cmake_gmock : The ability to add Google mock-based tests in the ament buildsystem
dev-ros / ament_cmake_gtest : The ability to add gtest-based tests in the ament buildsystem
dev-ros / ament_cmake_include_directories : Export include directories to downstream packages in the ament buildsystem
dev-ros / ament_cmake_libraries : The functionality to deduplicate libraries in the ament buildsystem
dev-ros / ament_cmake_lint_cmake : The CMake API for ament_lint_cmake to lint CMake code using cmakelint
dev-ros / ament_cmake_pytest : The ability to run Python tests using pytest in the ament buildsystem
dev-ros / ament_cmake_python : The ability to use Python in the ament buildsystem
dev-ros / ament_cmake_ros : ROS specific CMake bits in the ament buildsystem
dev-ros / ament_cmake_target_dependencies : Add defs, include dirs and libs to a target in the ament buildsystem
dev-ros / ament_cmake_test : The ability to add tests in the ament buildsystem
dev-ros / ament_cmake_uncrustify : The CMake API for ament_uncrustify to check code against styleconventions
dev-ros / ament_cmake_version : Override the exported package version in the ament buildsystem
dev-ros / ament_cmake_xmllint : he CMake API for ament_xmllint to check XML file using xmmlint
dev-ros / ament_copyright : The ability to check source files for copyright and license information
dev-ros / ament_cppcheck : The ability to perform static code analysis on C/C++ code using Cppcheck
dev-ros / ament_cpplint : The ability to check code against the Google style conventions using cpplint
dev-ros / ament_flake8 : The ability to check code for style and syntax conventions with flake8
dev-ros / ament_lint : Common API for ament linter packages
dev-ros / ament_lint_auto : The auto-magic functions for ease to use of the ament linters
dev-ros / ament_lint_cmake : Lint CMake code using cmakelint and generate xUnit test result files
dev-ros / ament_pep257 : Checks code against style conventions in PEP 8 and generate test result files
dev-ros / ament_uncrustify : The ability to check code against style conventions using uncrustify
dev-ros / ament_xmllint : Checks XML files like the package manifest using xmllint
dev-ros / angles : Set of simple math utilities to work with angles
dev-ros / audio_capture : Transports audio from a source to a destination
dev-ros / audio_common_msgs : Messages for transmitting audio via ROS
dev-ros / audio_play : Outputs audio to a speaker from a source node
dev-ros / base_local_planner : Trajectory Rollout and Dynamic Window approaches to robot navigation on a plane
dev-ros / bond : A bond allows two processes, A and B, to know when the other has terminated
dev-ros / bondcpp : C++ implementation of bond, for checking when another process has terminated
dev-ros / bondpy : Python implementation of bond, for checking when another process has terminated
dev-ros / calibration_estimation : Runs an optimization to estimate the a robot's kinematic parameters
dev-ros / calibration_launch : Launch files for configuring the calibration stack to run on your robot
dev-ros / calibration_msgs : Messages for storing calibration samples to be used in calibration procedures
dev-ros / calibration_setup_helper : Script to generate calibration launch and configurationfiles for your robot
dev-ros / camera_calibration : Calibration of monocular or stereo cameras
dev-ros / camera_calibration_parsers : Routines for reading and writing camera calibration parameters
dev-ros / camera_info_manager : C++ interface for camera calibration information
dev-ros / carrot_planner : Attempts to find a legal place to put a carrot for the robot to follow
dev-ros / class_loader : ROS-independent package for loading plugins
dev-ros / clear_costmap_recovery : Recovery behavior that attempts reverting the costmaps to the static map
dev-ros / cmake_modules : CMake Modules which are commonly used by ROS packages
dev-ros / collada_parser : C++ parser for the Collada robot description format
dev-ros / collada_urdf : Convert Unified Robot Description Format (URDF) documents into COLLADA documents
dev-ros / combined_robot_hw : Combined Robot HW class
dev-ros / combined_robot_hw_tests : Combined Robot HW class tests
dev-ros / compressed_depth_image_transport : Plugin for transparently sending depth images using PNG compression
dev-ros / compressed_image_transport : Plugin for transparently sending images encoded as JPEG or PNG
dev-ros / console_bridge_vendor : Wrapper around console_bridge
dev-ros / control_msgs : Base messages and actions useful for controlling robots
dev-ros / control_toolbox : Modules that are useful across all controllers
dev-ros / controller_interface : Interface base class for controllers
dev-ros / controller_manager : The controller manager
dev-ros / controller_manager_msgs : The controller manager
dev-ros / controller_manager_tests : Tests for the controller manager
dev-ros / convex_decomposition : Convex Decomposition Tool for Robot Model
dev-ros / costmap_2d : Creates a 2D costmap from sensor data
dev-ros / cpp_common : C++ code for doing things that are not necessarily ROS related
dev-ros / cv_bridge : Converts between ROS Image messages and OpenCV images
dev-ros / depth_image_proc : Nodelets for processing depth images such as those produced by OpenNI camera
dev-ros / depthimage_to_laserscan : Converts a depth image to a laser scan for use with navigation and localization
dev-ros / diagnostic_aggregator : Aggregates ROS diagnostics
dev-ros / diagnostic_analysis : Converts diagnostics data into a series of CSV files
dev-ros / diagnostic_common_diagnostics : Generic nodes for monitoring a linux host
dev-ros / diagnostic_msgs : Standardized interface for the diagnostic and runtime monitoring systems in ROS
dev-ros / diagnostic_updater : Tools for updating diagnostics
dev-ros / driver_base : Framework for writing drivers
dev-ros / dwa_local_planner : Dynamic Window Approach to local robot navigation on a plane
dev-ros / dynamic_reconfigure : Provides a means to change node parameters at runtime
dev-ros / eigen_conversions : Conversion functions between Eigen and KDL and Eigen and geometry_msgs
dev-ros / eigen_stl_containers : Provides a set of typedef's that allow using Eigen datatypes in STL containers
dev-ros / fake_localization : A ROS node that simply forwards odometry information
dev-ros / filters : Standardized interface for processing data as a sequence of filters
dev-ros / gazebo_dev : Cmake config for the default version of Gazebo for the ROS distribution
dev-ros / gazebo_msgs : Message and service data structures for interacting with Gazebo from ROS
dev-ros / gazebo_plugins : Robot-independent Gazebo plugins
dev-ros / gazebo_ros : ROS plugins that offer messages and services for interfacing with gazebo
dev-ros / gazebo_ros_control : ROS control plugins for gazebo
dev-ros / gencpp : ROS C++ message definition and serialization generators
dev-ros / geneus : EusLisp ROS message and service generators
dev-ros / genlisp : Common-Lisp ROS message and service generators
dev-ros / genmsg : Python library for generating ROS message and service data structures
dev-ros / gennodejs : Javascript ROS message and service generators
dev-ros / genpy : Python ROS message and service generators
dev-ros / geodesy : Python and C++ interfaces for manipulating geodetic coordinates
dev-ros / geographic_msgs : ROS messages for Geographic Information Systems
dev-ros / geometric_shapes : Generic definitions of geometric shapes and bodies
dev-ros / geometry_msgs : Messages for common geometric primitives such as points, vectors, and poses
dev-ros / global_planner : Path planner library and node
dev-ros / gmapping : ROS wrapper for OpenSlam's Gmapping
dev-ros / hardware_interface : Hardware Interface base class
dev-ros / hector_compressed_map_transport : Means for transporting compressed map data through the use of image_transport
dev-ros / hector_geotiff : Saves occupancy grid map, robot trajectory and object data to GeoTiff images
dev-ros / hector_geotiff_launch : Launch files for the hector_geotiff mapper
dev-ros / hector_geotiff_plugins : Plugins that extend geotiff maps generated by hector_geotiff
dev-ros / hector_imu_attitude_to_tf : Publish the roll/pitch attitude angles reported via a imu message to tf
dev-ros / hector_imu_tools : Tools for processing IMU messages
dev-ros / hector_map_server : Service for retrieving the map, as well as for raycasting based obstacle queries
dev-ros / hector_map_tools : Functions related to accessing information from OccupancyGridMap maps
dev-ros / hector_mapping : SLAM that can be used without odometry and on platforms that exhibit roll/pitch
dev-ros / hector_marker_drawing : Convenience functions for easier publishing of visualization markers
dev-ros / hector_nav_msgs : Messages and services used in the hector_slam stack
dev-ros / hector_pose_estimation : hector_pose_estimation node and the hector_pose_estimation nodelet
dev-ros / hector_pose_estimation_core : Extended Kalman Filter (EKF) that estimates the 6DOF pose of the robot
dev-ros / hector_slam_launch : Launch files for launching hector_slam with different robot scenarios
dev-ros / hector_trajectory_server : Keeps track of tf trajectories and makes this data accessible
dev-ros / image_cb_detector : Extracts checkerboard corners from ROS images
dev-ros / image_geometry : C++ and Python libraries for interpreting images geometrically
dev-ros / image_proc : Single image rectification and color processing
dev-ros / image_publisher : Publish an image stream from single image file or avi file
dev-ros / image_rotate : Rotates an image minimizing the angle between a vector and the camera frame
dev-ros / image_transport : Transparent support for transporting images in low-bandwidth compressed formats
dev-ros / image_view : Simple viewer for ROS image topics
dev-ros / imu_complementary_filter : Fuses angular velocities, accelerations, and magnetic readings from an IMU
dev-ros / imu_filter_madgwick : Fuses angular velocities, accelerations, and magnetic readings from an IMU
dev-ros / imu_processors : Processors for sensor_msgs::Imu data
dev-ros / imu_transformer : Transforms sensor_msgs::Imu data from one frame into another
dev-ros / interactive_marker_tutorials : Interactive marker tutorials
dev-ros / interactive_markers : 3D interactive marker communication library for RViz and similar tools
dev-ros / interval_intersection : Tools for calculating the intersection of interval messages
dev-ros / ivcon : Mesh Conversion Utility
dev-ros / joint_limits_interface : Interface for enforcing joint limits
dev-ros / joint_state_publisher : Tool for setting and publishing joint state values for a given URDF
dev-ros / joint_state_publisher_gui : Tool for setting and publishing joint state values for a given URDF
dev-ros / joint_states_settler : Reports how long a subset of joints has been settled
dev-ros / kdl_conversions : Conversion functions between KDL and geometry_msgs types
dev-ros / kdl_parser : Constructs a KDL tree from an XML robot representation in URDF
dev-ros / kdl_parser_py : Python tools to construct a KDL tree from an XML robot representation in URDF
dev-ros / laser_assembler : Nodes to assemble point clouds from either LaserScan or PointCloud messages
dev-ros / laser_cb_detector : Extracts checkerboard corners from a dense laser snapshot
dev-ros / laser_filters : Assorted filters designed to operate on 2D planar laser scanners
dev-ros / laser_geometry : Class for converting from a 2D laser scan into a point cloud
dev-ros / laser_proc : Converts representations of LaserScan and MultiEchoLaserScan
dev-ros / libmavconn : MAVLink communication library
dev-ros / librviz_tutorial : Tutorial showing how to build a C++ program with RViz displays and features
dev-ros / map_msgs : Messages commonly used in mapping packages
dev-ros / map_server : Offers map data as a ROS service
dev-ros / mavlink-gbp-release : MAVLink message marshaling library
dev-ros / mavros : MAVLink extendable communication node for ROS
dev-ros / mavros_extras : Extra nodes and plugins for mavros
dev-ros / mavros_msgs : Messages for MAVROS
dev-ros / media_export : Allow ROS packages to export media paths to each other
dev-ros / message_filters : Set of message filters which take in messages and outputs those at a later time
dev-ros / message_generation : Build-time dependencies for generating language bindings of messages
dev-ros / message_runtime : Package modeling the run-time dependencies for language bindings of messages
dev-ros / message_to_tf : Translates pose information from different kind of common message types to tf
dev-ros / mk : A collection of .mk include files for building ROS architectural elements
dev-ros / monocam_settler : Listens on a ImageFeatures topic, and waits for the data to settle
dev-ros / move_base : Given a goal in the world, will attempt to reach it with a mobile base
dev-ros / move_base_msgs : Holds the action description and relevant messages for the move_base package
dev-ros / move_slow_and_clear : Move slow and clear
dev-ros / moveit_msgs : Messages, services and actions used by MoveIt
dev-ros / nav_core : Common interfaces for navigation specific robot actions
dev-ros / nav_msgs : Common messages used to interact with the navigation stack
dev-ros / navfn : Fast interpolated navigation function for creating plans for a mobile base
dev-ros / nmea_msgs : Messages related to data in the NMEA format
dev-ros / nodelet : Runs multiple algorithms in the same process with zero copy transport
dev-ros / nodelet_topic_tools : Common nodelet tools such as a mux, demux and throttle
dev-ros / nodelet_tutorial_math : Nodelet tutorial
dev-ros / object_recognition_msgs : ROS message and the actionlib definition used in object_recognition_core
dev-ros / octomap_msgs : Messages and serializations / conversion for the OctoMap library
dev-ros / octomap_ros : Conversion functions between ROS / PCL and OctoMap's native types
dev-ros / opencv_apps : OpenCV applications for ROS
dev-ros / opencv_tests : Tests for ROS OpenCV integration
dev-ros / openni2_camera : ROS drivers for the Asus Xtion and Primesense Devices
dev-ros / openni2_launch : Launch files to start the openni2_camera drivers using rgbd_launch
dev-ros / openslam_gmapping : ROS-ified version of gmapping SLAM
dev-ros / pcl_conversions : Provides conversions from PCL data types and ROS message types
dev-ros / pcl_msgs : PCL (Point Cloud Library)-related ROS messages
dev-ros / pcl_ros : PCL (Point Cloud Library) ROS interface stack
dev-ros / pluginlib : Tools for writing and dynamically loading plugins using the ROS infrastructure
dev-ros / pluginlib_tutorials : Pluginlib tutorials
dev-ros / poco_vendor : CMake shim over the poco library
dev-ros / pointcloud_to_laserscan : Converts a 3D Point Cloud into a 2D laser scan
dev-ros / polled_camera : C++ classes for implementing a polled camera driver node
dev-ros / pr2_dashboard_aggregator : Aggregates all of the topics that a 'pr2_dashboard' app might be interested in
dev-ros / pr2_description : Description (mechanical, kinematic, visual, etc.) of the PR2 robot
dev-ros / pr2_machine : xxx.machine files that describe the different hosts a node can be spawned on
dev-ros / pr2_msgs : Messages for representing PR2 state
dev-ros / python_cmake_module : CMake module with extra functionality for Python
dev-ros / python_qt_binding : Infrastructure for an integrated graphical user interface based on Qt
dev-ros / qt_dotgraph : Helpers to work with dot graphs
dev-ros / qt_gui : ROS infrastructure for an integrated graphical user interface based on Qt
dev-ros / qt_gui_app : Instance of the integrated graphical user interface provided by qt_gui
dev-ros / qt_gui_cpp : C++-bindings for qt_gui and creates bindings for every generator available
dev-ros / qt_gui_py_common : Common functionality for ROS RQT GUI plugins written in Python
dev-ros / random_numbers : Wrappers for generating floating point values, integers and quaternions
dev-ros / realtime_tools : Set of tools that can be used from a hard realtime thread
dev-ros / resource_retriever : Retrieves data from url-format files
dev-ros / rgbd_launch : Launch files to open an RGBD device
dev-ros / robot_localization : Package of nonlinear state estimation nodes
dev-ros / robot_pose_ekf : Estimate the 3D pose of a robot from pose measurements from various sources
dev-ros / robot_pose_publisher : A Simple Node to Publish the Robot's Position Relative to the Map using TFs
dev-ros / robot_state_publisher : Package for publishing the state of a robot to tf
dev-ros / ros_environment : ROS environment variables
dev-ros / rosapi : Service calls for getting ros meta-information
dev-ros / rosauth : Server Side tools for Authorization and Authentication of ROS Clients
dev-ros / rosbag : Set of tools for recording from and playing back to ROS topics
dev-ros / rosbag_migration_rule : Allows to export rosbag migration rule files without depending on rosbag
dev-ros / rosbag_storage : Set of tools for recording from and playing back ROS message
dev-ros / rosbash : Assorted shell commands for using ros with bash
dev-ros / rosboost_cfg : Tool for determining cflags/lflags/etc. of boost on your system
dev-ros / rosbridge_library : Core rosbridge package for parsing JSON and performing the appropriate action
dev-ros / rosbridge_msgs : Package containing message files for rosbridge
dev-ros / rosbridge_server : A WebSocket interface to rosbridge
dev-ros / rosbuild : Scripts for managing the CMake-based build system for ROS
dev-ros / rosclean : Cleanup filesystem resources (e.g. log files)
dev-ros / rosconsole : ROS console output library
dev-ros / rosconsole_bridge : Connects console_bridge-based logging to rosconsole-based logging
dev-ros / roscpp : C++ implementation of ROS
dev-ros / roscpp_serialization : Code for serialization
dev-ros / roscpp_traits : Message traits code
dev-ros / roscpp_tutorials : Attempts to show the features of ROS step-by-step
dev-ros / roscreate : Tool that assists in the creation of ROS filesystem resources
dev-ros / rosdiagnostic : Command to print aggregated diagnostic contents to the command line
dev-ros / rosgraph : Prints information about the ROS Computation Graph
dev-ros / rosgraph_msgs : Messages relating to ROS comm
dev-ros / roslang : Common package for all ROS client libraries
dev-ros / roslaunch : Tool for easily launching multiple ROS nodes
dev-ros / roslib : Base dependencies and support libraries for ROS
dev-ros / roslint : Static checking of Python or C++ source code for errors and standards compliance
dev-ros / roslisp : Lisp client library for ROS
dev-ros / roslz4 : Python and C++ implementation of the LZ4 streaming format
dev-ros / rosmake : ROS dependency aware build tool
dev-ros / rosmaster : ROS Master implementation
dev-ros / rosmsg : Command-line tools for displaying information about message and services
dev-ros / rosnode : Command-line tool for displaying debug information about ROS nodes
dev-ros / rosout : System-wide logging mechanism for messages sent to the /rosout topic
dev-ros / rospack : Retrieves information about ROS packages available on the filesystem
dev-ros / rosparam : Command-line tool for getting and setting ROS Parameters on the parameter server
dev-ros / rospy : Python client library for ROS
dev-ros / rospy_tutorials : Attempts to show the features of ROS step-by-step
dev-ros / rosserial_arduino : Libraries and examples for ROSserial usage on Arduino/AVR Platforms
dev-ros / rosserial_client : Generalized client side source for rosserial
dev-ros / rosserial_embeddedlinux : Libraries and examples for ROSserial usage on Embedded Linux Enviroments
dev-ros / rosserial_msgs : Messages for automatic topic configuration using rosserial
dev-ros / rosserial_python : A Python-based implementation of the ROS serial protocol
dev-ros / rosserial_server : C++ implementation of the rosserial server side
dev-ros / rosserial_tivac : Definitions for rosserial_client targets for TivaC Launchpad evaluation boards
dev-ros / rosserial_windows : Libraries and examples for ROSserial usage on Windows Platforms
dev-ros / rosserial_xbee : Tools to do communicate between rosserial nodes connected to an xbee
dev-ros / rosservice : Command-line tool for listing and querying ROS Services
dev-ros / rostest : Integration test suite based on roslaunch compatible with xUnit frameworks
dev-ros / rostime : Time and Duration implementations for C++ libraries
dev-ros / rostopic : Command-line tool for displaying debug information about ROS Topics
dev-ros / rosunit : Unit-testing package for ROS
dev-ros / roswtf : Tool for diagnosing issues with a running ROS system
dev-ros / rotate_recovery : Recovery behavior that attempts performing a 360 degree rotation of the robot
dev-ros / rqt_action : Introspect all available ROS action (from actionlib) types
dev-ros / rqt_bag : GUI plugin for displaying and replaying ROS bag files
dev-ros / rqt_bag_plugins : GUI plugin for displaying and replaying ROS bag files
dev-ros / rqt_console : GUI plugin for displaying and filtering ROS messages
dev-ros / rqt_controller_manager : RQT control manager plugin
dev-ros / rqt_dep : GUI plugin for visualizing the ROS dependency graph
dev-ros / rqt_graph : GUI plugin for visualizing the ROS computation graph
dev-ros / rqt_gui : Instance of the ROS integrated graphical user interface provided by qt_gui
dev-ros / rqt_gui_cpp : Enables GUI plugins to use the C++ client library for ROS
dev-ros / rqt_gui_py : Enables GUI plugins to use the Python client library for ROS
dev-ros / rqt_image_view : GUI plugin for displaying images using image_transport
dev-ros / rqt_launch : Easy view of .launch files
dev-ros / rqt_logger_level : GUI plugin for configuring the logger level of ROS nodes
dev-ros / rqt_moveit : Assists monitoring tasks for MoveIt! motion planner
dev-ros / rqt_msg : Python GUI plugin for introspecting available ROS message types
dev-ros / rqt_nav_view : Provides a gui for viewing navigation maps and paths
dev-ros / rqt_plot : GUI plugin visualizing numeric values in a 2D plot
dev-ros / rqt_pose_view : GUI plugin for visualizing 3D poses
dev-ros / rqt_publisher : GUI plugin for publishing arbitrary messages with fixed or computed field values
dev-ros / rqt_py_common : Common functionality for rqt plugins written in Python
dev-ros / rqt_py_console : Python GUI plugin providing an interactive Python console
dev-ros / rqt_reconfigure : Provides the way to view and edit the parameters from dynamic_reconfigure
dev-ros / rqt_robot_dashboard : Infrastructure for building robot dashboard plugins in rqt
dev-ros / rqt_robot_monitor : Displays messages that are published by diagnostic_aggregator
dev-ros / rqt_robot_steering : GUI plugin for steering a robot using Twist messages
dev-ros / rqt_runtime_monitor : GUI plugin viewing DiagnosticsArray messages
dev-ros / rqt_rviz : GUI plugin embedding RViz
dev-ros / rqt_service_caller : GUI plugin for calling arbitrary services
dev-ros / rqt_shell : GUI plugin providing an interactive shell
dev-ros / rqt_srv : GUI plugin for introspecting available ROS message types
dev-ros / rqt_tf_tree : GUI plugin for visualizing the ROS TF frame tree
dev-ros / rqt_top : RQT plugin for monitoring ROS processes
dev-ros / rqt_topic : GUI plugin for displaying debug information about ROS topics
dev-ros / rqt_web : Simple web content viewer for rqt
dev-ros / rviz : 3D visualization tool for ROS
dev-ros / rviz_imu_plugin : RVIZ plugin for IMU visualization
dev-ros / rviz_plugin_tutorials : Tutorials showing how to write plugins for RViz
dev-ros / rviz_python_tutorial : Tutorials showing how to call into rviz internals from python scripts
dev-ros / self_test : Robot self-test node
dev-ros / sensor_msgs : Messages for commonly used sensors: cameras and scanning laser rangefinders
dev-ros / settlerlib : Helper functions for creating a settler for a specific sensor channel
dev-ros / shape_msgs : Messages for defining shapes: simple solid object primitives, planes, and meshes
dev-ros / smach : Task-level architecture for rapidly creating complex robot behavior
dev-ros / smach_msgs : Set of messages that are used by the introspection interfaces for smach
dev-ros / smach_ros : Extensions for the SMACH library to integrate it tightly with ROS
dev-ros / smclib : The SMC converts the description of a state machine into source code
dev-ros / stage_ros : ROS specific hooks and tools for the Stage simulator
dev-ros / std_msgs : Standard ROS Messages
dev-ros / std_srvs : Messages relating to ROS comm
dev-ros / stereo_image_proc : Stereo and single image rectification and disparity processing
dev-ros / stereo_msgs : Messages specific to stereo processing, such as disparity images
dev-ros / test_bond : Tests for bond, bondpy and bondcpp
dev-ros / test_diagnostic_aggregator : diagnostic_aggregator tests
dev-ros / test_nodelet : Nodelet unit tests
dev-ros / test_nodelet_topic_tools : Nodelet topic tools unit tests
dev-ros / test_rosbag : Unit tests for rosbag
dev-ros / test_rosbag_storage : Unit tests for rosbag_storage
dev-ros / test_roscpp : Unit tests for roscpp
dev-ros / test_rosgraph : Unit tests for rosgraph
dev-ros / test_roslaunch : Unit tests for roslaunch
dev-ros / test_roslib_comm : Unit tests for roslib
dev-ros / test_rosmaster : Unit tests for rosmaster
dev-ros / test_rosparam : Unit tests for rosparam
dev-ros / test_rospy : Unit tests for rospy
dev-ros / test_rosservice : Unit tests for rospy
dev-ros / test_tf2 : TF2 unit tests
dev-ros / tf : Maintains the relationship between frames in a tree structure over time
dev-ros / tf2 : The second generation Transform Library in ROS
dev-ros / tf2_bullet : TF2 bullet support
dev-ros / tf2_eigen : TF2 eigen support
dev-ros / tf2_geometry_msgs : The second generation Transform Library in ROS
dev-ros / tf2_kdl : KDL binding for tf2
dev-ros / tf2_msgs : TF2 messages
dev-ros / tf2_py : TF2 python bindings
dev-ros / tf2_ros : ROS bindings for the tf2 library, for both Python and C++
dev-ros / tf2_sensor_msgs : Transform sensor_msgs with tf. Most notably, PointCloud2
dev-ros / tf2_tools : Tools for 2nd gen Transform library
dev-ros / tf_conversions : Functions to convert common tf datatypes into those used by other libraries
dev-ros / theora_image_transport : Plugin for transparently sending an image stream encoded with the Theora codec
dev-ros / timestamp_tools : Classes to help timestamp hardware events
dev-ros / topic_tools : Tools for directing, throttling and selecting ROS topics
dev-ros / trajectory_msgs : Messages for defining robot trajectories
dev-ros / transmission_interface : Transmission Interface
dev-ros / turtle_actionlib : Demonstrates how to write an action server and client with the turtlesim
dev-ros / turtle_tf : Demonstrates how to write a tf broadcaster and listener with the turtlesim
dev-ros / turtle_tf2 : Demonstrates how to write a tf2 broadcaster and listener with the turtlesim
dev-ros / turtlesim : Tool made for teaching ROS and ROS packages
dev-ros / unique_id : ROS Python and C++ interfaces for universally unique identifiers
dev-ros / urdf : C++ parser for the Unified Robot Description Format (URDF)
dev-ros / urdf_parser_plugin : C++ base class for URDF parsers
dev-ros / urdf_tutorial : URDF tutorials
dev-ros / urg_c : URG Helper / URG Widget / URG Library / urg_c
dev-ros / urg_node : ROS wrapper for the Hokuyo urg_c library
dev-ros / uuid_msgs : ROS messages for universally unique identifiers
dev-ros / visp_auto_tracker : Online automated pattern-based object tracker relying on visual servoing
dev-ros / visp_bridge : Converts between ROS structures and ViSP structures
dev-ros / visp_camera_calibration : Calibration of cameras using a customizable pattern and ViSP library
dev-ros / visp_hand2eye_calibration : Estimates the camera position with respect to its effector using ViSP
dev-ros / visp_tracker : Wraps the ViSP moving edge tracker provided by the ViSP library
dev-ros / visualization_marker_tutorials : Visualization marker tutorials
dev-ros / visualization_msgs : Messages used by higher level packages that deal in visualization-specific data
dev-ros / voxel_grid : Implementation of an efficient 3D voxel grid
dev-ros / xacro : XML macro language
dev-ros / xmlrpcpp : C++ implementation of the XML-RPC protocol