Packages

Name Description
2 2018-12-06 trajectory_msgs
A package containing some robot trajectory message definitions.
A package containing some robot trajectory message definitions.
 
2 2018-12-06 tf2_sensor_msgs
Small lib to transform sensor_msgs with tf. Most notably, PointCloud2
Small lib to transform sensor_msgs with tf. Most notably, PointCloud2
 
2 2018-12-06 tf2_ros
This package contains the ROS bindings for the tf2 library, for both Python and C++.
This package contains the ROS bindings for the tf2 library, for both Python and C++.
 
2 2018-12-06 tf2_msgs
tf2_msgs
tf2_msgs
 
2 2018-12-06 tf2_geometry_msgs
tf2_geometry_msgs
tf2_geometry_msgs
 
2 2018-12-06 tf2_eigen
tf2_eigen
tf2_eigen
 
2 2018-12-06 tf2
tf2 is the second generation of the transform library, which lets the user keep track of multiple coordinate frames over time. tf2 maintains the relationship between coordinate frames in a tree structure buffered in time, and lets the user transform points, vectors, etc between any two coordinate frames at any desired point in time.
tf2 is the second generation of the transform library, which lets the user keep track of multiple coordinate frames over time. tf2 maintains the relationship between coordinate frames in a tree structure buffered in time, and lets the user transform points, vectors, etc between any two coordinate frames at any desired point in time.
 
2 2018-12-06 stereo_msgs
A package containing some stereo camera related message definitions.
A package containing some stereo camera related message definitions.
 
3 2018-12-06 std_srvs
A package containing some standard service definitions.
A package containing some standard service definitions.
 
2 2018-12-06 std_msgs
A package containing some standard message definitions.
A package containing some standard message definitions.
 
2 2018-12-06 shape_msgs
A package containing some message definitions which describe geometric shapes.
A package containing some message definitions which describe geometric shapes.
 
2 2018-12-06 sensor_msgs
A package containing some sensor data related message and service definitions.
A package containing some sensor data related message and service definitions.
 
1 2018-12-06 rmw_implementation
The decision which ROS middleware implementation should be used for C++.
The decision which ROS middleware implementation should be used for C++.
 
2 2018-12-06 nav_msgs
A package containing some navigation related message and service definitions.
A package containing some navigation related message and service definitions.
 
2 2018-12-06 geometry_msgs
A package containing some geometry related message definitions.
A package containing some geometry related message definitions.
 
2 2018-12-06 diagnostic_msgs
A package containing some diagnostics related message and service definitions.
A package containing some diagnostics related message and service definitions.
 
1 2018-12-06 common_interfaces
common_interfaces contains messages and services that are widely used by other ROS packages.
common_interfaces contains messages and services that are widely used by other ROS packages.
 
2 2018-12-06 actionlib_msgs
A package containing some message definitions used in the implementation or actions.
A package containing some message definitions used in the implementation or actions.
 
1 2018-11-29 yaml_cpp_vendor
Wrapper around yaml-cpp, it provides a fixed CMake module and an ExternalProject build of it.
Wrapper around yaml-cpp, it provides a fixed CMake module and an ExternalProject build of it.
 
3 2018-11-22 message_filters
A set of ROS2 message filters which take in messages and may output those messages at a later time, based on the conditions that filter needs met.
A set of ROS2 message filters which take in messages and may output those messages at a later time, based on the conditions that filter needs met.
 
1 2018-11-21 unique_identifier_msgs
ROS messages for universally unique identifiers.
ROS messages for universally unique identifiers.
 
3 2018-11-20 urdf
This package contains a C++ parser for the Unified Robot Description Format (URDF), which is an XML format for representing a robot model. The code API of the parser has been through our review process and will remain backwards compatible in future releases.
This package contains a C++ parser for the Unified Robot Description Format (URDF), which is an XML format for representing a robot model. The code API of the parser has been through our review process and will remain backwards compatible in future releases.
 
1 2018-11-20 tlsf_cpp
C++ stdlib-compatible wrapper around tlsf allocator and ROS2 examples
C++ stdlib-compatible wrapper around tlsf allocator and ROS2 examples
 
1 2018-11-20 rttest
Instrumentation library for real-time performance testing
Instrumentation library for real-time performance testing
 
2 2018-11-20 orocos_kdl
This package contains a recent version of the Kinematics and Dynamics Library (KDL), distributed by the Orocos Project.
This package contains a recent version of the Kinematics and Dynamics Library (KDL), distributed by the Orocos Project.
 
1 2018-11-20 laser_assembler
Provides nodes to assemble point clouds from either LaserScan or PointCloud messages
Provides nodes to assemble point clouds from either LaserScan or PointCloud messages
 
3 2018-11-20 kdl_parser
The Kinematics and Dynamics Library (KDL) defines a tree structure to represent the kinematic and dynamic parameters of a robot mechanism.
The Kinematics and Dynamics Library (KDL) defines a tree structure to represent the kinematic and dynamic parameters of a robot mechanism.
 
1 2018-11-20 angles
This package provides a set of simple math utilities to work with angles. The utilities cover simple things like normalizing an angle and conversion between degrees and radians. But even if you're trying to calculate things like the shortest angular distance between two joint space positions of your robot, but the joint motion is constrained by joint limits, this package is what you need. The code in this package is stable and well tested. There are no plans for major changes in the near future.
This package provides a set of simple math utilities to work with angles. The utilities cover simple things like normalizing an angle and conversion between degrees and radians. But even if you're trying to calculate things like the shortest angular distance between two joint space positions of your robot, but the joint motion is constrained by joint limits, this package is what you need. The code in this package is stable and well tested. There are no plans for major changes in the near future.
 
2 2018-11-19 urdfdom
A library to access URDFs using the DOM model.
A library to access URDFs using the DOM model.
 
2 2018-11-16 rosidl_default_runtime
A configuration package defining the runtime for the ROS interfaces.
A configuration package defining the runtime for the ROS interfaces.
 
2 2018-11-16 rosidl_default_generators
A configuration package defining the default ROS interface generators.
A configuration package defining the default ROS interface generators.
 
1 2018-11-16 console_bridge_vendor
Wrapper around console_bridge, providing nothing but a dependency on console_bridge, on some systems. On others, it provides an ExternalProject build of console_bridge.
Wrapper around console_bridge, providing nothing but a dependency on console_bridge, on some systems. On others, it provides an ExternalProject build of console_bridge.
 
1 2018-11-16 class_loader
The class_loader package is a ROS-independent package for loading plugins during runtime and the foundation of the higher level ROS "pluginlib" library. class_loader utilizes the host operating system's runtime loader to open runtime libraries (e.g. .so/.dll files), introspect the library for exported plugin classes, and allows users to instantiate objects of these exported classes without the explicit declaration (i.e. header file) for those classes.
The class_loader package is a ROS-independent package for loading plugins during runtime and the foundation of the higher level ROS "pluginlib" library. class_loader utilizes the host operating system's runtime loader to open runtime libraries (e.g. .so/.dll files), introspect the library for exported plugin classes, and allows users to instantiate objects of these exported classes without the explicit declaration (i.e. header file) for those classes.
 
1 2018-11-15 test_osrf_testing_tools_cpp
Test package, which uses things exported by osrf_testing_tools_cpp.
Test package, which uses things exported by osrf_testing_tools_cpp.
 
1 2018-11-15 rosidl_generator_dds_idl
Generate the DDS interfaces for ROS interfaces.
Generate the DDS interfaces for ROS interfaces.
 
1 2018-11-15 osrf_testing_tools_cpp
Testing tools for C++, and is used in various OSRF projects.
Testing tools for C++, and is used in various OSRF projects.
 
1 2018-11-13 ament_package
The parser for the manifest files in the ament buildsystem.
The parser for the manifest files in the ament buildsystem.
 
1 2018-10-23 rqt_bag_plugins
rqt_bag provides a GUI plugin for displaying and replaying ROS bag files.
rqt_bag provides a GUI plugin for displaying and replaying ROS bag files.
 
1 2018-10-23 rqt_bag
rqt_bag provides a GUI plugin for displaying and replaying ROS bag files.
rqt_bag provides a GUI plugin for displaying and replaying ROS bag files.
 
1 2018-10-19 rqt_logger_level
rqt_logger_level provides a GUI plugin for configuring the logger level of ROS nodes.
rqt_logger_level provides a GUI plugin for configuring the logger level of ROS nodes.
 
1 2018-09-27 sophus
C++ implementation of Lie Groups using Eigen.
C++ implementation of Lie Groups using Eigen.
 
2 2018-06-27 robot_state_publisher
ROS2 version of the robot_state_publisher package
ROS2 version of the robot_state_publisher package
 
1 2018-06-27 laser_geometry
This package contains a class for converting from a 2D laser scan as defined by sensor_msgs/LaserScan into a point cloud as defined by sensor_msgs/PointCloud or sensor_msgs/PointCloud2. In particular, it contains functionality to account for the skew resulting from moving robots or tilting laser scanners.
This package contains a class for converting from a 2D laser scan as defined by sensor_msgs/LaserScan into a point cloud as defined by sensor_msgs/PointCloud or sensor_msgs/PointCloud2. In particular, it contains functionality to account for the skew resulting from moving robots or tilting laser scanners.
 
1 2018-06-25 tlsf
TLSF allocator version 2.4.6
TLSF allocator version 2.4.6
 
1 2018-06-25 libyaml_vendor
Wrapper around libyaml, provides the last version (1.8.0 rc) that ships with a CMake module
Wrapper around libyaml, provides the last version (1.8.0 rc) that ships with a CMake module
 
1 2018-06-22 poco_vendor
CMake shim over the poco library.
CMake shim over the poco library.
 
2 2018-06-21 resource_retriever
This package retrieves data from url-format files such as http://, ftp://, package:// file://, etc., and loads the data into memory. The package:// url for ros packages is translated into a local file:// url. The resourse retriever was initially designed to load mesh files into memory, but it can be used for any type of data. The resource retriever is based on the the libcurl library.
This package retrieves data from url-format files such as http://, ftp://, package:// file://, etc., and loads the data into memory. The package:// url for ros packages is translated into a local file:// url. The resourse retriever was initially designed to load mesh files into memory, but it can be used for any type of data. The resource retriever is based on the the libcurl library.
 
1 2018-06-21 libcurl_vendor
Wrapper around libcurl, it provides a fixed CMake module and an ExternalProject build of it.
Wrapper around libcurl, it provides a fixed CMake module and an ExternalProject build of it.
 
1 2018-06-18 ament_index_python
Python API to access the ament resource index.
Python API to access the ament resource index.
 
1 2018-06-18 ament_index_cpp
C++ API to access the ament resource index.
C++ API to access the ament resource index.
 

Packages

Name Description
1 2019-05-09 aruco_detect
Fiducial detection based on the aruco library
Fiducial detection based on the aruco library
 
1 2019-05-09 agni_tf_tools
This package provides a gui program as well as a rviz plugin to publish static transforms. Both support the transformation between various Euler angle representations. The rviz plugin also allows to configure the transform with an interactive marker.
This package provides a gui program as well as a rviz plugin to publish static transforms. Both support the transformation between various Euler angle representations. The rviz plugin also allows to configure the transform with an interactive marker.
 
1 2019-05-08 turtlebot3_teleop
Provides teleoperation using keyboard for TurtleBot3.
Provides teleoperation using keyboard for TurtleBot3.
 
1 2019-05-08 turtlebot3_slam
The turtlebot3_slam package provides roslaunch scripts for starting the SLAM
The turtlebot3_slam package provides roslaunch scripts for starting the SLAM
 
1 2019-05-08 turtlebot3_navigation
The turtlebot3_navigation provides roslaunch scripts for starting the navigation.
The turtlebot3_navigation provides roslaunch scripts for starting the navigation.
 
1 2019-05-08 turtlebot3_example
This package provides four TurtleBot3 basic example include move using interactive marker, move and stop using LDS, move to goal position, move to custom routes. The interactions node is that you can control the TurtleBot3 front and back side or rotate to goal position. The obstacle node is that when the robot meets an obstacle, it stops. The patrol node is that TurtleBot3 move to custom route. There are 3 route(square, triangle, circle) in this package. You can add your route and move the TurtleBot3. The pointop node is that you can insert goal position include distance x-axis, y-axis and angluar z-axis.
This package provides four TurtleBot3 basic example include move using interactive marker, move and stop using LDS, move to goal position, move to custom routes. The interactions node is that you can control the TurtleBot3 front and back side or rotate to goal position. The obstacle node is that when the robot meets an obstacle, it stops. The patrol node is that TurtleBot3 move to custom route. There are 3 route(square, triangle, circle) in this package. You can add your route and move the TurtleBot3. The pointop node is that you can insert goal position include distance x-axis, y-axis and angluar z-axis.
 
1 2019-05-08 turtlebot3_description
3D models of the TurtleBot3 for simulation and visualization
3D models of the TurtleBot3 for simulation and visualization
 
1 2019-05-08 turtlebot3_bringup
roslaunch scripts for starting the TurtleBot3
roslaunch scripts for starting the TurtleBot3
 
1 2019-05-08 turtlebot3
ROS packages for the Turtlebot3 (meta package)
ROS packages for the Turtlebot3 (meta package)
 
1 2019-05-08 schunk_simulated_tactile_sensors
This package provides simulated tactile sensors for the Schunk Dextrous Hand (SDH) which is mounted on the Care-O-bot arm. The node subscribes to the Gazebo bumper topics of the SDH. It transforms the Gazebo feedback to the "tactile_data" topic to provide the same tactile sensor interface as the schunk_sdh package. The following parameters can be set: * cells_x: The number of patches on the tactile sensor in the direction perpendicular to the finger. Defaults to 6. * cells_y: The number of patches on the tactile sensor along the direction of the finger. Defaults to 14. * output_range: The maximum output value of one patch. Defaults to 3500. * sensitivity: The change of output in one patch per Newton. Defaults to 350. The sensitivity can be approximated by the following formula: S = output_range / (measurement_range * cell_area) - The measurement range of the tactile pads is 250 kPa (from the data sheet). - The output range can be determined by experiment from the real SDH. It is about 3500. - The cell area is the size of one patch. Length and width of the area are determined by dividing the length/width of the collision surface by the number of cells in the respective direction. Important: In most cases this is NOT the cell area that is given in the data sheet! * filter_length: The length of the moving average filter which smoothes the values from simulation. Defaults to 10. The node subscribes to the following topics to receive data from the simulation: * thumb_2/state * thumb_3/state * finger_12/state * finger_13/state * finger_22/state * finger_23/state The node publishes the processed data on the following topic: * tactile_data The simulated bumper must obtain the collision data in the link that the sensor is attached to. This is achieved by setting the "frameName" property in the gazebo_ros_bumper controller.
This package provides simulated tactile sensors for the Schunk Dextrous Hand (SDH) which is mounted on the Care-O-bot arm. The node subscribes to the Gazebo bumper topics of the SDH. It transforms the Gazebo feedback to the "tactile_data" topic to provide the same tactile sensor interface as the schunk_sdh package. The following parameters can be set: * cells_x: The number of patches on the tactile sensor in the direction perpendicular to the finger. Defaults to 6. * cells_y: The number of patches on the tactile sensor along the direction of the finger. Defaults to 14. * output_range: The maximum output value of one patch. Defaults to 3500. * sensitivity: The change of output in one patch per Newton. Defaults to 350. The sensitivity can be approximated by the following formula: S = output_range / (measurement_range * cell_area) - The measurement range of the tactile pads is 250 kPa (from the data sheet). - The output range can be determined by experiment from the real SDH. It is about 3500. - The cell area is the size of one patch. Length and width of the area are determined by dividing the length/width of the collision surface by the number of cells in the respective direction. Important: In most cases this is NOT the cell area that is given in the data sheet! * filter_length: The length of the moving average filter which smoothes the values from simulation. Defaults to 10. The node subscribes to the following topics to receive data from the simulation: * thumb_2/state * thumb_3/state * finger_12/state * finger_13/state * finger_22/state * finger_23/state The node publishes the processed data on the following topic: * tactile_data The simulated bumper must obtain the collision data in the link that the sensor is attached to. This is achieved by setting the "frameName" property in the gazebo_ros_bumper controller.
 
1 2019-05-08 schunk_sdh
This package provides an interface for operating the schunk dexterous hand (SDH), including the tactile sensors.
This package provides an interface for operating the schunk dexterous hand (SDH), including the tactile sensors.
 
1 2019-05-08 schunk_powercube_chain
This packages provides a configurable driver of a chain of Schunk powercubes. The powercube chain is configured through parameters. Most users will not directly interact with this package but with the corresponding launch files in other packages, e.g. schunk_bringup, cob_bringup, ...
This packages provides a configurable driver of a chain of Schunk powercubes. The powercube chain is configured through parameters. Most users will not directly interact with this package but with the corresponding launch files in other packages, e.g. schunk_bringup, cob_bringup, ...
 
1 2019-05-08 schunk_modular_robotics
This stack includes packages that provide access to the Schunk hardware through ROS messages, services and actions.
This stack includes packages that provide access to the Schunk hardware through ROS messages, services and actions.
 
1 2019-05-08 schunk_libm5api
This package wraps the libm5api to use it as a ros dependency. Original sources from http://www.schunk-modular-robotics.com/fileadmin/user_upload/software/schunk_libm5api_source.zip.
This package wraps the libm5api to use it as a ros dependency. Original sources from http://www.schunk-modular-robotics.com/fileadmin/user_upload/software/schunk_libm5api_source.zip.
 
1 2019-05-08 schunk_description
This package contains the description (mechanical, kinematic, visual, etc.) of different schunk components. The files in this package are parsed and used by a variety of other components. Most users will not interact directly with this package.
This package contains the description (mechanical, kinematic, visual, etc.) of different schunk components. The files in this package are parsed and used by a variety of other components. Most users will not interact directly with this package.
 
1 2019-05-08 rospilot
rospilot
rospilot
 
1 2019-05-08 rc_dynamics_api
The rc_dynamics_api provides an API for easy handling of the dynamic-state data streams provided by Roboception's stereo camera with self-localization. See http://rc-visard.com Dynamic-state estimates of the rc_visard relate to its self-localization and ego-motion estimation. These states refer to rc_visard's current pose, velocity, or acceleration and are published on demand via several data streams. For a complete list and descriptions of these dynamics states and the respective data streams please refer to rc_visard's user manual.
The rc_dynamics_api provides an API for easy handling of the dynamic-state data streams provided by Roboception's stereo camera with self-localization. See http://rc-visard.com Dynamic-state estimates of the rc_visard relate to its self-localization and ego-motion estimation. These states refer to rc_visard's current pose, velocity, or acceleration and are published on demand via several data streams. For a complete list and descriptions of these dynamics states and the respective data streams please refer to rc_visard's user manual.
 
1 2019-05-07 rosbridge_suite
Rosbridge provides a JSON API to ROS functionality for non-ROS programs. There are a variety of front ends that interface with rosbridge, including a WebSocket server for web browsers to interact with. Rosbridge_suite is a meta-package containing rosbridge, various front end packages for rosbridge like a WebSocket package, and helper packages.
Rosbridge provides a JSON API to ROS functionality for non-ROS programs. There are a variety of front ends that interface with rosbridge, including a WebSocket server for web browsers to interact with. Rosbridge_suite is a meta-package containing rosbridge, various front end packages for rosbridge like a WebSocket package, and helper packages.
 
1 2019-05-07 rosbridge_server
A WebSocket interface to rosbridge.
A WebSocket interface to rosbridge.
 
1 2019-05-07 rosbridge_msgs
Package containing message files
Package containing message files
 
1 2019-05-07 rosbridge_library
The core rosbridge package, repsonsible for interpreting JSON andperforming the appropriate ROS action, like subscribe, publish, call service, and interact with params.
The core rosbridge package, repsonsible for interpreting JSON andperforming the appropriate ROS action, like subscribe, publish, call service, and interact with params.
 
1 2019-05-07 rosapi
Provides service calls for getting ros meta-information, like list of topics, services, params, etc.
Provides service calls for getting ros meta-information, like list of topics, services, params, etc.
 
1 2019-05-07 cv_camera
cv_camera uses OpenCV capture object to capture camera image. This supports camera_image and nodelet.
cv_camera uses OpenCV capture object to capture camera image. This supports camera_image and nodelet.
 
1 2019-05-06 sick_tim
A ROS driver for the SICK TiM and the SICK MRS 1000 laser scanners.
A ROS driver for the SICK TiM and the SICK MRS 1000 laser scanners.
 
1 2019-05-06 sick_safetyscanners
Provides an Interface to read the sensor output of a SICK Safety Scanner
Provides an Interface to read the sensor output of a SICK Safety Scanner
 
1 2019-05-06 sick_ldmrs_tools
Examples how to use the sick_ldmrs
Examples how to use the sick_ldmrs
 
1 2019-05-06 sick_ldmrs_msgs
Messages and PCL point types for SICK LD-MRS.
Messages and PCL point types for SICK LD-MRS.
 
1 2019-05-06 sick_ldmrs_laser
A ROS driver for the SICK LD-MRS series of laser scanners.
A ROS driver for the SICK LD-MRS series of laser scanners.
 
1 2019-05-06 sick_ldmrs_driver
A ROS driver for the SICK LD-MRS series of laser scanners.
A ROS driver for the SICK LD-MRS series of laser scanners.
 
1 2019-05-06 sick_ldmrs_description
This package contains an URDF description of the SICK LD-MRS scanner and all supporting mesh files.
This package contains an URDF description of the SICK LD-MRS scanner and all supporting mesh files.
 
1 2019-05-06 rviz_imu_plugin
RVIZ plugin for IMU visualization
RVIZ plugin for IMU visualization
 
1 2019-05-06 rosthrottle
ROS Python package for throttling ROS topics programatically in Python. Sits on top of the ros_comm topic_tools throttle utility.
ROS Python package for throttling ROS topics programatically in Python. Sits on top of the ros_comm topic_tools throttle utility.
 
2 2019-05-06 rospy_message_converter
Converts between Python dictionaries and JSON to rospy messages.
Converts between Python dictionaries and JSON to rospy messages.
 
2 2019-05-06 phidgets_imu
Driver for the Phidgets Spatial 3/3/3 devices
Driver for the Phidgets Spatial 3/3/3 devices
 
1 2019-05-06 phidgets_ik
Driver for the Phidgets InterfaceKit devices
Driver for the Phidgets InterfaceKit devices
 
1 2019-05-06 phidgets_high_speed_encoder
Driver for the Phidgets high speed encoder devices
Driver for the Phidgets high speed encoder devices
 
2 2019-05-06 phidgets_drivers
API and ROS drivers for Phidgets devices
API and ROS drivers for Phidgets devices
 
2 2019-05-06 phidgets_api
A C++ Wrapper for the Phidgets C API
A C++ Wrapper for the Phidgets C API
 
1 2019-05-06 mir_robot
URDF description, Gazebo simulation, navigation, bringup launch files, message and action descriptions for the MiR100 robot.
URDF description, Gazebo simulation, navigation, bringup launch files, message and action descriptions for the MiR100 robot.
 
1 2019-05-06 mir_navigation
Launch and configuration files for move_base, localization etc. on the MiR robot.
Launch and configuration files for move_base, localization etc. on the MiR robot.
 
1 2019-05-06 mir_msgs
Message definitions for the MiR100 robot
Message definitions for the MiR100 robot
 
1 2019-05-06 mir_gazebo
Simulation specific launch and configuration files for the MiR100 robot.
Simulation specific launch and configuration files for the MiR100 robot.
 
1 2019-05-06 mir_dwb_critics
Trajectory critics for the dwb_local_planner that work well together with the SBPL global planner on the MiR robot
Trajectory critics for the dwb_local_planner that work well together with the SBPL global planner on the MiR robot
 
1 2019-05-06 mir_driver
A reverse ROS bridge for the MiR100 robot
A reverse ROS bridge for the MiR100 robot
 
1 2019-05-06 mir_description
URDF description of the MiR100 robot
URDF description of the MiR100 robot
 
1 2019-05-06 mir_actions
Action definitions for the MiR100 robot
Action definitions for the MiR100 robot
 
2 2019-05-06 libphidget21
This package wraps the libphidget21 to use it as a ROS dependency
This package wraps the libphidget21 to use it as a ROS dependency
 
1 2019-05-06 jointstick
Move any joint with any controller!
Move any joint with any controller!
 
1 2019-05-06 imu_tools
Various tools for IMU devices
Various tools for IMU devices
 
1 2019-05-06 imu_filter_madgwick
Filter which fuses angular velocities, accelerations, and (optionally) magnetic readings from a generic IMU device into an orientation. Based on code by Sebastian Madgwick, http://www.x-io.co.uk/node/8#open_source_ahrs_and_imu_algorithms.
Filter which fuses angular velocities, accelerations, and (optionally) magnetic readings from a generic IMU device into an orientation. Based on code by Sebastian Madgwick, http://www.x-io.co.uk/node/8#open_source_ahrs_and_imu_algorithms.
 

Packages

Name Description
1 2019-04-08 position_controllers
position_controllers
position_controllers
 
1 2019-04-08 joint_trajectory_controller
Controller for executing joint-space trajectories on a group of joints.
Controller for executing joint-space trajectories on a group of joints.
 
1 2019-04-08 joint_state_controller
Controller to publish joint state
Controller to publish joint state
 
1 2019-04-08 imu_sensor_controller
Controller to publish state of IMU sensors
Controller to publish state of IMU sensors
 
1 2019-04-08 gripper_action_controller
The gripper_action_controller package
The gripper_action_controller package
 
2 2019-04-08 four_wheel_steering_controller
Controller for a four wheel steering mobile base.
Controller for a four wheel steering mobile base.
 
1 2019-04-08 forward_command_controller
forward_command_controller
forward_command_controller
 
1 2019-04-08 force_torque_sensor_controller
Controller to publish state of force-torque sensors
Controller to publish state of force-torque sensors
 
1 2019-04-08 effort_controllers
effort_controllers
effort_controllers
 
1 2019-04-08 diff_drive_controller
Controller for a differential drive mobile base.
Controller for a differential drive mobile base.
 
1 2019-04-08 ackermann_steering_controller
Controller for a steer drive mobile base.
Controller for a steer drive mobile base.
 
1 2019-04-04 xpp_vis
Visualization for the XPP Motion Framework.
Visualization for the XPP Motion Framework.
 
1 2019-04-04 xpp_states
Common definitions (positions, velocities, angular angles, angular rates) and robot definitions in Cartesian and joint state used in the Xpp Motion Framework, as well as conversions to/from xpp_msgs.
Common definitions (positions, velocities, angular angles, angular rates) and robot definitions in Cartesian and joint state used in the Xpp Motion Framework, as well as conversions to/from xpp_msgs.
 
1 2019-04-04 xpp_quadrotor
The URDF file for a quadrotor to be used with the xpp packages and a simple rviz publisher of quadrotor tfs. Adapted from Daniel Mellinger, Nathan Michael, Vijay Kumar, "Trajectory Generation and Control for Precise Aggressive Maneuvers with Quadrotors".
The URDF file for a quadrotor to be used with the xpp packages and a simple rviz publisher of quadrotor tfs. Adapted from Daniel Mellinger, Nathan Michael, Vijay Kumar, "Trajectory Generation and Control for Precise Aggressive Maneuvers with Quadrotors".
 
1 2019-04-04 xpp_msgs
ROS messages used in the XPP framework.
ROS messages used in the XPP framework.
 
1 2019-04-04 xpp_hyq
HyQ-robot specific functions for visualization in the XPP Motion Framework. These include inverse kinematics as well as urdf files for a one-legged, two-legged and four legged robot with
HyQ-robot specific functions for visualization in the XPP Motion Framework. These include inverse kinematics as well as urdf files for a one-legged, two-legged and four legged robot with
 
1 2019-04-04 xpp_examples
Examples of how to use the xpp framework.
Examples of how to use the xpp framework.
 
1 2019-04-04 xpp
Visualization of motion-plans for legged robots. It draws support areas, contact forces and motion trajectories in RVIZ and displays URDFs for specific robots, including a one-legged, a two-legged hopper and
Visualization of motion-plans for legged robots. It draws support areas, contact forces and motion trajectories in RVIZ and displays URDFs for specific robots, including a one-legged, a two-legged hopper and
 
2 2019-04-04 resource_retriever
This package retrieves data from url-format files such as http://, ftp://, package:// file://, etc., and loads the data into memory. The package:// url for ros packages is translated into a local file:// url. The resourse retriever was initially designed to load mesh files into memory, but it can be used for any type of data. The resource retriever is based on the the libcurl library.
This package retrieves data from url-format files such as http://, ftp://, package:// file://, etc., and loads the data into memory. The package:// url for ros packages is translated into a local file:// url. The resourse retriever was initially designed to load mesh files into memory, but it can be used for any type of data. The resource retriever is based on the the libcurl library.
 
1 2019-04-04 mavlink
MAVLink message marshaling library. This package provides C-headers and C++11 library for both 1.0 and 2.0 versions of protocol. For pymavlink use separate install via rosdep (python-pymavlink).
MAVLink message marshaling library. This package provides C-headers and C++11 library for both 1.0 and 2.0 versions of protocol. For pymavlink use separate install via rosdep (python-pymavlink).
 
1 2019-04-03 teleop_keyboard_omni3
Generic keyboard teleop for 3 wheeled omnidirectional robots.
Generic keyboard teleop for 3 wheeled omnidirectional robots.
 
1 2019-04-03 rostime
Time and Duration implementations for C++ libraries, including roscpp.
Time and Duration implementations for C++ libraries, including roscpp.
 
1 2019-04-03 roscpp_traits
roscpp_traits contains the message traits code as described in
roscpp_traits contains the message traits code as described in
 
1 2019-04-03 roscpp_serialization
roscpp_serialization contains the code for serialization as described in
roscpp_serialization contains the code for serialization as described in
 
1 2019-04-03 roscpp_core
Underlying data libraries for roscpp messages.
Underlying data libraries for roscpp messages.
 
1 2019-04-03 open_karto
Catkinized ROS packaging of the OpenKarto library
Catkinized ROS packaging of the OpenKarto library
 
1 2019-04-03 multisense_ros
multisense_ros
multisense_ros
 
1 2019-04-03 multisense_lib
multisense_lib
multisense_lib
 
1 2019-04-03 multisense_description
multisense_description
multisense_description
 
1 2019-04-03 multisense_cal_check
multisense_cal_check
multisense_cal_check
 
1 2019-04-03 multisense_bringup
multisense_bringup
multisense_bringup
 
1 2019-04-03 multisense
multisense catkin driver
multisense catkin driver
 
1 2019-04-03 moveit_resources
Resources used for MoveIt! testing
Resources used for MoveIt! testing
 
1 2019-04-03 cpp_common
cpp_common contains C++ code for doing things that are not necessarily ROS related, but are useful for multiple packages. This includes things like the ROS_DEPRECATED and ROS_FORCE_INLINE macros, as well as code for getting backtraces. This package is a component of
cpp_common contains C++ code for doing things that are not necessarily ROS related, but are useful for multiple packages. This includes things like the ROS_DEPRECATED and ROS_FORCE_INLINE macros, as well as code for getting backtraces. This package is a component of
 
1 2019-04-02 roseus_tutorials
roseus_tutorials
roseus_tutorials
 
1 2019-04-02 roseus_smach
roseus_smach * Euslisp state machine class. it will be moved. * Message publisher for visualizing current state by smach_viewer. * Simple pickle dump script for debugging state machine. * Execute state machine as a action server.
roseus_smach * Euslisp state machine class. it will be moved. * Message publisher for visualizing current state by smach_viewer. * Simple pickle dump script for debugging state machine. * Execute state machine as a action server.
 
1 2019-04-02 roseus_mongo
The roseus_mongo package
The roseus_mongo package
 
1 2019-04-02 roseus
EusLisp client for ROS Robot Operating System.
EusLisp client for ROS Robot Operating System.
 
1 2019-04-02 jsk_roseus
 
1 2019-04-01 app_manager
app_manager
app_manager
 
1 2019-03-29 rosunit
Unit-testing package for ROS. This is a lower-level library for rostest and handles unit tests, whereas rostest handles integration tests.
Unit-testing package for ROS. This is a lower-level library for rostest and handles unit tests, whereas rostest handles integration tests.
 
1 2019-03-29 rosmake
rosmake is a ros dependency aware build tool which can be used to build all dependencies in the correct order.
rosmake is a ros dependency aware build tool which can be used to build all dependencies in the correct order.
 
1 2019-03-29 roslib
Base dependencies and support libraries for ROS. roslib contains many of the common data structures and tools that are shared across ROS client library implementations.
Base dependencies and support libraries for ROS. roslib contains many of the common data structures and tools that are shared across ROS client library implementations.
 
1 2019-03-29 roslang
roslang is a common package that all
roslang is a common package that all
 
1 2019-03-29 roscreate
roscreate contains a tool that assists in the creation of ROS filesystem resources. It provides:
roscreate contains a tool that assists in the creation of ROS filesystem resources. It provides:
 
1 2019-03-29 rosclean
rosclean: cleanup filesystem resources (e.g. log files).
rosclean: cleanup filesystem resources (e.g. log files).
 
1 2019-03-29 rosbuild
rosbuild contains scripts for managing the CMake-based build system for ROS.
rosbuild contains scripts for managing the CMake-based build system for ROS.
 
1 2019-03-29 rosboost_cfg
Contains scripts used by the rosboost-cfg tool for determining cflags/lflags/etc. of boost on your system
Contains scripts used by the rosboost-cfg tool for determining cflags/lflags/etc. of boost on your system
 
1 2019-03-29 rosbash
Assorted shell commands for using ros with bash.
Assorted shell commands for using ros with bash.
 
1 2019-03-29 ros
ROS packaging system
ROS packaging system
 

Packages

Name Description
1 2019-05-16 kdl_typekit
This package contains the KDL RTT bindings
This package contains the KDL RTT bindings
 
1 2019-05-16 ifopt
An
An
 
1 2019-05-16 hector_xacro_tools
hector_xacro_tools
hector_xacro_tools
 
1 2019-05-16 hector_sensors_description
hector_sensors_description contains URDF xacro macros for sensors, so they are easily attachable to robot models and usable in gazebo.
hector_sensors_description contains URDF xacro macros for sensors, so they are easily attachable to robot models and usable in gazebo.
 
1 2019-05-16 hector_models
hector_models contains (urdf) models of robots, sensors etc.
hector_models contains (urdf) models of robots, sensors etc.
 
1 2019-05-16 hector_components_description
hector_components_description contains URDF xacro macros for robot components, so they are easily attachable to robot models.
hector_components_description contains URDF xacro macros for robot components, so they are easily attachable to robot models.
 
1 2019-05-16 eigen_typekit
An Orocos typekit for Eigen types.
An Orocos typekit for Eigen types.
 
1 2019-05-15 rtt_visualization_msgs
Provides an rtt typekit for ROS visualization_msgs messages. It allows you to use ROS messages transparently in RTT components and applications. This package was automatically generated by the create_rtt_msgs generator and should not be manually modified. See the http://ros.org/wiki/visualization_msgs documentation for the documentation of the ROS messages in this typekit.
Provides an rtt typekit for ROS visualization_msgs messages. It allows you to use ROS messages transparently in RTT components and applications. This package was automatically generated by the create_rtt_msgs generator and should not be manually modified. See the http://ros.org/wiki/visualization_msgs documentation for the documentation of the ROS messages in this typekit.
 
1 2019-05-15 rtt_trajectory_msgs
Provides an rtt typekit for ROS trajectory_msgs messages. It allows you to use ROS messages transparently in RTT components and applications. This package was automatically generated by the create_rtt_msgs generator and should not be manually modified. See the http://ros.org/wiki/trajectory_msgs documentation for the documentation of the ROS messages in this typekit.
Provides an rtt typekit for ROS trajectory_msgs messages. It allows you to use ROS messages transparently in RTT components and applications. This package was automatically generated by the create_rtt_msgs generator and should not be manually modified. See the http://ros.org/wiki/trajectory_msgs documentation for the documentation of the ROS messages in this typekit.
 
1 2019-05-15 rtt_tf2_msgs
Provides an rtt typekit for ROS tf2_msgs messages. It allows you to use ROS messages transparently in RTT components and applications. This package was automatically generated by the create_rtt_msgs generator and should not be manually modified. See the http://ros.org/wiki/tf2_msgs documentation for the documentation of the ROS messages in this typekit.
Provides an rtt typekit for ROS tf2_msgs messages. It allows you to use ROS messages transparently in RTT components and applications. This package was automatically generated by the create_rtt_msgs generator and should not be manually modified. See the http://ros.org/wiki/tf2_msgs documentation for the documentation of the ROS messages in this typekit.
 
1 2019-05-15 rtt_tf
This package contains the components of the rtt_tf package
This package contains the components of the rtt_tf package
 
1 2019-05-15 rtt_stereo_msgs
Provides an rtt typekit for ROS stereo_msgs messages. It allows you to use ROS messages transparently in RTT components and applications. This package was automatically generated by the create_rtt_msgs generator and should not be manually modified. See the http://ros.org/wiki/stereo_msgs documentation for the documentation of the ROS messages in this typekit.
Provides an rtt typekit for ROS stereo_msgs messages. It allows you to use ROS messages transparently in RTT components and applications. This package was automatically generated by the create_rtt_msgs generator and should not be manually modified. See the http://ros.org/wiki/stereo_msgs documentation for the documentation of the ROS messages in this typekit.
 
1 2019-05-15 rtt_std_srvs
Provides an rtt typekit for ROS std_msgs messages. It allows you to use ROS messages transparently in RTT components and applications. This package was automatically generated by the create_rtt_msgs generator and should not be manually modified. See the http://ros.org/wiki/std_msgs documentation for the documentation of the ROS messages in this typekit.
Provides an rtt typekit for ROS std_msgs messages. It allows you to use ROS messages transparently in RTT components and applications. This package was automatically generated by the create_rtt_msgs generator and should not be manually modified. See the http://ros.org/wiki/std_msgs documentation for the documentation of the ROS messages in this typekit.
 
1 2019-05-15 rtt_std_msgs
Provides an rtt typekit for ROS std_msgs messages. It allows you to use ROS messages transparently in RTT components and applications. This package was automatically generated by the create_rtt_msgs generator and should not be manually modified. See the http://ros.org/wiki/std_msgs documentation for the documentation of the ROS messages in this typekit.
Provides an rtt typekit for ROS std_msgs messages. It allows you to use ROS messages transparently in RTT components and applications. This package was automatically generated by the create_rtt_msgs generator and should not be manually modified. See the http://ros.org/wiki/std_msgs documentation for the documentation of the ROS messages in this typekit.
 
1 2019-05-15 rtt_shape_msgs
Provides an rtt typekit for ROS shape_msgs messages. It allows you to use ROS messages transparently in RTT components and applications. This package was automatically generated by the create_rtt_msgs generator and should not be manually modified. See the http://ros.org/wiki/shape_msgs documentation for the documentation of the ROS messages in this typekit.
Provides an rtt typekit for ROS shape_msgs messages. It allows you to use ROS messages transparently in RTT components and applications. This package was automatically generated by the create_rtt_msgs generator and should not be manually modified. See the http://ros.org/wiki/shape_msgs documentation for the documentation of the ROS messages in this typekit.
 
1 2019-05-15 rtt_sensor_msgs
Provides an rtt typekit for ROS sensor_msgs messages. It allows you to use ROS messages transparently in RTT components and applications. This package was automatically generated by the create_rtt_msgs generator and should not be manually modified. See the http://ros.org/wiki/sensor_msgs documentation for the documentation of the ROS messages in this typekit.
Provides an rtt typekit for ROS sensor_msgs messages. It allows you to use ROS messages transparently in RTT components and applications. This package was automatically generated by the create_rtt_msgs generator and should not be manually modified. See the http://ros.org/wiki/sensor_msgs documentation for the documentation of the ROS messages in this typekit.
 
1 2019-05-15 rtt_rosparam_tests
The rtt_rosparam_tests package
The rtt_rosparam_tests package
 
1 2019-05-15 rtt_rosparam
This package provides an RTT service and service-requester for associating RTT component properties with ROS parameters
This package provides an RTT service and service-requester for associating RTT component properties with ROS parameters
 
1 2019-05-15 rtt_rospack_tests
The rtt_ros_tests package
The rtt_ros_tests package
 
1 2019-05-15 rtt_rospack
rtt_rospack provides an RTT plugin to use rospack to find packages in your ROS_PACKAGE_PATH
rtt_rospack provides an RTT plugin to use rospack to find packages in your ROS_PACKAGE_PATH
 
1 2019-05-15 rtt_rosnode
This package provides an RTT plugin to add a ROS node to the RTT process.
This package provides an RTT plugin to add a ROS node to the RTT process.
 
1 2019-05-15 rtt_rosgraph_msgs
Provides an rtt typekit for ROS rosgraph_msgs messages. It allows you to use ROS messages transparently in RTT components and applications. This package was automatically generated by the create_rtt_msgs generator and should not be manually modified. See the http://ros.org/wiki/rosgraph_msgs documentation for the documentation of the ROS messages in this typekit.
Provides an rtt typekit for ROS rosgraph_msgs messages. It allows you to use ROS messages transparently in RTT components and applications. This package was automatically generated by the create_rtt_msgs generator and should not be manually modified. See the http://ros.org/wiki/rosgraph_msgs documentation for the documentation of the ROS messages in this typekit.
 
1 2019-05-15 rtt_rosdeployment
rtt_rosdeployment provides an RTT plugin to control an ocl deployment component over ROS service calls.
rtt_rosdeployment provides an RTT plugin to control an ocl deployment component over ROS service calls.
 
1 2019-05-15 rtt_roscomm_tests
The rtt_roscomm_tests package
The rtt_roscomm_tests package
 
1 2019-05-15 rtt_roscomm
rtt_roscomm provides the necessary template files and cmake macros for automatic rtt typekit and transport generation from ROS msg files
rtt_roscomm provides the necessary template files and cmake macros for automatic rtt typekit and transport generation from ROS msg files
 
1 2019-05-15 rtt_rosclock
This package provides an RTT plugin to access different time measurements on a realtime host.
This package provides an RTT plugin to access different time measurements on a realtime host.
 
1 2019-05-15 rtt_rosbuild_tests
rtt_ros_rosbuild_test
rtt_ros_rosbuild_test
 
1 2019-05-15 rtt_ros_tests
The rtt_ros_tests package
The rtt_ros_tests package
 
1 2019-05-15 rtt_ros_msgs
This package provides .msg and .srv files for use with the rtt_ros_integration packages.
This package provides .msg and .srv files for use with the rtt_ros_integration packages.
 
1 2019-05-15 rtt_ros_integration
This stack contains all software necessary to build systems using both Orocos and ROS infrastructures
This stack contains all software necessary to build systems using both Orocos and ROS infrastructures
 
1 2019-05-15 rtt_ros_comm
The rtt_ros_comm package
The rtt_ros_comm package
 
1 2019-05-15 rtt_ros
This package provides an RTT plugin to add a ROS node to the RTT process, as well as several wrapper scripts to enable roslaunching of orocos programs.
This package provides an RTT plugin to add a ROS node to the RTT process, as well as several wrapper scripts to enable roslaunching of orocos programs.
 
1 2019-05-15 rtt_nav_msgs
Provides an rtt typekit for ROS nav_msgs messages. It allows you to use ROS messages transparently in RTT components and applications. This package was automatically generated by the create_rtt_msgs generator and should not be manually modified. See the http://ros.org/wiki/nav_msgs documentation for the documentation of the ROS messages in this typekit.
Provides an rtt typekit for ROS nav_msgs messages. It allows you to use ROS messages transparently in RTT components and applications. This package was automatically generated by the create_rtt_msgs generator and should not be manually modified. See the http://ros.org/wiki/nav_msgs documentation for the documentation of the ROS messages in this typekit.
 
1 2019-05-15 rtt_kdl_conversions
This package contains the components of the kdl_conversions package
This package contains the components of the kdl_conversions package
 
1 2019-05-15 rtt_geometry_msgs
Provides an rtt typekit for ROS geometry_msgs messages. It allows you to use ROS messages transparently in RTT components and applications. This package was automatically generated by the create_rtt_msgs generator and should not be manually modified. See the http://ros.org/wiki/geometry_msgs documentation for the documentation of the ROS messages in this typekit.
Provides an rtt typekit for ROS geometry_msgs messages. It allows you to use ROS messages transparently in RTT components and applications. This package was automatically generated by the create_rtt_msgs generator and should not be manually modified. See the http://ros.org/wiki/geometry_msgs documentation for the documentation of the ROS messages in this typekit.
 
1 2019-05-15 rtt_dynamic_reconfigure_tests
The rtt_dynamic_reconfigure_tests package
The rtt_dynamic_reconfigure_tests package
 
1 2019-05-15 rtt_dynamic_reconfigure
The rtt_dynamic_reconfigure package
The rtt_dynamic_reconfigure package
 
1 2019-05-15 rtt_diagnostic_msgs
Provides an rtt typekit for ROS diagnostic_msgs messages. It allows you to use ROS messages transparently in RTT components and applications. This package was automatically generated by the create_rtt_msgs generator and should not be manually modified. See the http://ros.org/wiki/diagnostic_msgs documentation for the documentation of the ROS messages in this typekit.
Provides an rtt typekit for ROS diagnostic_msgs messages. It allows you to use ROS messages transparently in RTT components and applications. This package was automatically generated by the create_rtt_msgs generator and should not be manually modified. See the http://ros.org/wiki/diagnostic_msgs documentation for the documentation of the ROS messages in this typekit.
 
1 2019-05-15 rtt_common_msgs
The rtt_common_msgs package
The rtt_common_msgs package
 
1 2019-05-15 rtt_actionlib_msgs
Provides an rtt typekit for ROS actionlib_msgs messages. It allows you to use ROS messages transparently in RTT components and applications. This package was automatically generated by the create_rtt_msgs generator and should not be manually modified. See the http://ros.org/wiki/actionlib_msgs documentation for the documentation of the ROS messages in this typekit.
Provides an rtt typekit for ROS actionlib_msgs messages. It allows you to use ROS messages transparently in RTT components and applications. This package was automatically generated by the create_rtt_msgs generator and should not be manually modified. See the http://ros.org/wiki/actionlib_msgs documentation for the documentation of the ROS messages in this typekit.
 
1 2019-05-15 rtt_actionlib
The rtt_actionlib package
The rtt_actionlib package
 
1 2019-05-15 rexrov2_gazebo
Package with launch files for demonstrations with the RexROV 2 vehicle with different positioning controllers.
Package with launch files for demonstrations with the RexROV 2 vehicle with different positioning controllers.
 
1 2019-05-15 rexrov2_description
The robot description files for the RexROV 2 underwater vehicle and launch files to spawn the model in different configurations.
The robot description files for the RexROV 2 underwater vehicle and launch files to spawn the model in different configurations.
 
1 2019-05-15 rexrov2_control
Launch and configuration files to start controllers nodes from the [`uuv_trajectory_control`](https://github.com/uuvsimulator/uuv_simulator/tree/master/uuv_control/uuv_trajectory_control) package for the RexROV 2 vehicle.
Launch and configuration files to start controllers nodes from the [`uuv_trajectory_control`](https://github.com/uuvsimulator/uuv_simulator/tree/master/uuv_control/uuv_trajectory_control) package for the RexROV 2 vehicle.
 
1 2019-05-15 resized_image_transport
ROS nodes to publish resized images.
ROS nodes to publish resized images.
 
1 2019-05-15 khi_rs_ikfast_plugin
The khi_rs_ikfast_plugin package
The khi_rs_ikfast_plugin package
 
1 2019-05-15 khi_rs_gazebo
The khi_rs_gazebo package
The khi_rs_gazebo package
 
1 2019-05-15 khi_rs_description
The khi_rs_description package
The khi_rs_description package
 
1 2019-05-15 khi_rs080n_moveit_config
An automatically generated package with all the configuration and launch files for using the khi_rs080n with the MoveIt! Motion Planning Framework
An automatically generated package with all the configuration and launch files for using the khi_rs080n with the MoveIt! Motion Planning Framework
 
1 2019-05-15 khi_rs007n_moveit_config
An automatically generated package with all the configuration and launch files for using the khi_rs007n with the MoveIt! Motion Planning Framework
An automatically generated package with all the configuration and launch files for using the khi_rs007n with the MoveIt! Motion Planning Framework
 

Packages

Name Description
1 2019-04-24 cob_keyframe_detector
Node that listens to TF, detects a robot movement and triggers a service.
Node that listens to TF, detects a robot movement and triggers a service.
 
1 2019-04-24 cob_environment_perception
Metapackage for 3D environment perception algorithms.
Metapackage for 3D environment perception algorithms.
 
1 2019-04-24 cob_3d_visualization
Visualization of 3D environment data using mainly interactive markers.
Visualization of 3D environment data using mainly interactive markers.
 
1 2019-04-24 cob_3d_transform_nodes
Transform nodes for point clouds and shape arrays.
Transform nodes for point clouds and shape arrays.
 
1 2019-04-24 cob_3d_segmentation
Segmentation algorithms.
Segmentation algorithms.
 
1 2019-04-24 cob_3d_registration
Registration algorithms.
Registration algorithms.
 
1 2019-04-24 cob_3d_meshing
ROS Wrapper for meshing (OpenMesh).
ROS Wrapper for meshing (OpenMesh).
 
1 2019-04-24 cob_3d_mapping_tools
Various tools for 3D mapping.
Various tools for 3D mapping.
 
1 2019-04-24 cob_3d_mapping_slam
3D SLAM algorithms.
3D SLAM algorithms.
 
1 2019-04-24 cob_3d_mapping_semantics
Extraction of semantic data (e.g. table extraction) from 3-D environment maps.
Extraction of semantic data (e.g. table extraction) from 3-D environment maps.
 
1 2019-04-24 cob_3d_mapping_point_map
Package for creating a point map of the environment.
Package for creating a point map of the environment.
 
1 2019-04-24 cob_3d_mapping_pipeline
Launch files for mapping pipeline.
Launch files for mapping pipeline.
 
1 2019-04-24 cob_3d_mapping_geometry_map
Package for creating a geometric map of the environment.
Package for creating a geometric map of the environment.
 
1 2019-04-24 cob_3d_mapping_filters
Filters for point clouds.
Filters for point clouds.
 
1 2019-04-24 cob_3d_mapping_common
Common classes and nodes for 3D environment perception.
Common classes and nodes for 3D environment perception.
 
1 2019-04-24 cob_3d_fov_segmentation
Segments a point cloud by the field of view (FOV) of a camera.
Segments a point cloud by the field of view (FOV) of a camera.
 
1 2019-04-24 cob_3d_features_evaluation
The cob_3d_features_evaluation package
The cob_3d_features_evaluation package
 
1 2019-04-24 cob_3d_features
Feature algorithms.
Feature algorithms.
 
1 2019-04-24 cob_3d_evaluation_features
PCL feature evaluation.
PCL feature evaluation.
 
1 2019-04-22 trac_ik_python
The trac_ik_python package contains a python wrapper using SWIG for trac_ik_lib
The trac_ik_python package contains a python wrapper using SWIG for trac_ik_lib
 
1 2019-04-22 trac_ik_lib
TRAC-IK is a faster, significantly more reliable drop-in replacement for KDL's pseudoinverse Jacobian solver. The TRAC-IK library has a very similar API to KDL's IK solver calls, except that the user passes a maximum time instead of a maximum number of search iterations. Additionally, TRAC-IK allows for error tolerances to be set independently for each Cartesian dimension (x,y,z,roll,pitch.yaw).
TRAC-IK is a faster, significantly more reliable drop-in replacement for KDL's pseudoinverse Jacobian solver. The TRAC-IK library has a very similar API to KDL's IK solver calls, except that the user passes a maximum time instead of a maximum number of search iterations. Additionally, TRAC-IK allows for error tolerances to be set independently for each Cartesian dimension (x,y,z,roll,pitch.yaw).
 
1 2019-04-22 trac_ik_kinematics_plugin
A MoveIt! Kinematics plugin using TRAC-IK
A MoveIt! Kinematics plugin using TRAC-IK
 
1 2019-04-22 trac_ik_examples
This package contains the source code for testing and comparing trac_ik
This package contains the source code for testing and comparing trac_ik
 
1 2019-04-22 trac_ik
The ROS packages in this repository were created to provide an improved alternative Inverse Kinematics solver to the popular inverse Jacobian methods in KDL. TRAC-IK handles joint-limited chains better than KDL without increasing solve time.
The ROS packages in this repository were created to provide an improved alternative Inverse Kinematics solver to the popular inverse Jacobian methods in KDL. TRAC-IK handles joint-limited chains better than KDL without increasing solve time.
 
1 2019-04-22 opencv_apps
 
1 2019-04-18 rosserial_leonardo_cmake
CMake scripts for building Arduino Leonardo (atmega32u4) Firmwares
CMake scripts for building Arduino Leonardo (atmega32u4) Firmwares
 
2 2019-04-18 grid_map_visualization
Configurable tool to visualize grid maps in RViz.
Configurable tool to visualize grid maps in RViz.
 
2 2019-04-18 grid_map_sdf
Generates signed distance fields from grid maps.
Generates signed distance fields from grid maps.
 
2 2019-04-18 grid_map_rviz_plugin
RViz plugin for displaying grid map messages.
RViz plugin for displaying grid map messages.
 
2 2019-04-18 grid_map_ros
ROS interface for the grid map library to manage two-dimensional grid maps with multiple data layers.
ROS interface for the grid map library to manage two-dimensional grid maps with multiple data layers.
 
2 2019-04-18 grid_map_pcl
Conversions between grid maps and Point Cloud Library (PCL) types.
Conversions between grid maps and Point Cloud Library (PCL) types.
 
2 2019-04-18 grid_map_octomap
Conversions between grid maps and OctoMap types.
Conversions between grid maps and OctoMap types.
 
2 2019-04-18 grid_map_msgs
Definition of the multi-layered grid map message type.
Definition of the multi-layered grid map message type.
 
2 2019-04-18 grid_map_loader
Loading and publishing grid maps from bag files.
Loading and publishing grid maps from bag files.
 
2 2019-04-18 grid_map_filters
Processing grid maps as a sequence of ROS filters.
Processing grid maps as a sequence of ROS filters.
 
2 2019-04-18 grid_map_demos
Demo nodes to demonstrate the usage of the grid map library.
Demo nodes to demonstrate the usage of the grid map library.
 
2 2019-04-18 grid_map_cv
Conversions between grid maps and OpenCV images.
Conversions between grid maps and OpenCV images.
 
2 2019-04-18 grid_map_costmap_2d
Interface for grid maps to the costmap_2d format.
Interface for grid maps to the costmap_2d format.
 
2 2019-04-18 grid_map_core
Universal grid map library to manage two-dimensional grid maps with multiple data layers.
Universal grid map library to manage two-dimensional grid maps with multiple data layers.
 
2 2019-04-18 grid_map
Meta-package for the universal grid map library.
Meta-package for the universal grid map library.
 
1 2019-04-18 fanuc_resources
 
2 2019-04-18 fanuc_r1000ia_support
 
2 2019-04-18 fanuc_r1000ia_moveit_plugins
 
2 2019-04-18 fanuc_r1000ia80f_moveit_config
 
2 2019-04-18 fanuc_m900ib_support
 
2 2019-04-18 fanuc_m900ia_support
 
2 2019-04-18 fanuc_m710ic_support
 
1 2019-04-18 fanuc_m6ib_support
 
1 2019-04-18 fanuc_m6ib_moveit_plugins
 
1 2019-04-18 fanuc_m6ib_moveit_config
 

Packages

Name Description
1 2018-12-18 vigir_footstep_planning_default_plugins
The vigir_footstep_planning_default_plugins package
The vigir_footstep_planning_default_plugins package
 
1 2018-12-18 vigir_footstep_planning
The vigir_footstep_planning package is a stack for the whole footstep planning system. It contains the top-level launch files and may be used to include all dependencies.
The vigir_footstep_planning package is a stack for the whole footstep planning system. It contains the top-level launch files and may be used to include all dependencies.
 
1 2018-12-18 vigir_footstep_planner
The vigir_footstep_planner package
The vigir_footstep_planner package
 
1 2018-12-18 vigir_foot_pose_transformer
The vigir_foot_pose_transformer package
The vigir_foot_pose_transformer package
 
1 2018-12-18 vigir_feet_pose_generator
The vigir_feet_pose_generator package
The vigir_feet_pose_generator package
 
2 2018-12-13 rqt_multiplot
rqt_multiplot provides a GUI plugin for visualizing numeric values in multiple 2D plots using the Qwt plotting backend.
rqt_multiplot provides a GUI plugin for visualizing numeric values in multiple 2D plots using the Qwt plotting backend.
 
1 2018-12-01 openni2_camera
Drivers for the Asus Xtion and Primesense Devices. For using a kinect with ROS, try the
Drivers for the Asus Xtion and Primesense Devices. For using a kinect with ROS, try the
 
1 2018-11-27 wireless_watcher
A Python-based which publishes connection information about a linux wireless interface.
A Python-based which publishes connection information about a linux wireless interface.
 
1 2018-11-27 wireless_msgs
Messages for describing a wireless network such as bitrate, essid, and link quality.
Messages for describing a wireless network such as bitrate, essid, and link quality.
 
1 2018-11-26 rcll_fawkes_sim_msgs
Message definitions to access RCLL simulation via Fawkes stack
Message definitions to access RCLL simulation via Fawkes stack
 
2 2018-11-23 variant_topic_tools
Topic tools for treating messages as variant types.
Topic tools for treating messages as variant types.
 
2 2018-11-23 variant_topic_test
Variant topic tools testing suites.
Variant topic tools testing suites.
 
2 2018-11-23 variant_msgs
Variant messages are designed to accommodate the information content of any invariant message. They are truly generic and can freely be converted to and from specific message objects.
Variant messages are designed to accommodate the information content of any invariant message. They are truly generic and can freely be converted to and from specific message objects.
 
2 2018-11-23 variant
Meta-package for the universal variant library.
Meta-package for the universal variant library.
 
2 2018-11-23 robot_self_filter
Filters the robot's body out of point clouds.
Filters the robot's body out of point clouds.
 
1 2018-11-20 laser_assembler
Provides nodes to assemble point clouds from either LaserScan or PointCloud messages
Provides nodes to assemble point clouds from either LaserScan or PointCloud messages
 
1 2018-11-19 vigir_step_control
The vigir_step_control package
The vigir_step_control package
 
2 2018-11-16 tf2_tools
tf2_tools
tf2_tools
 
2 2018-11-16 tf2_sensor_msgs
Small lib to transform sensor_msgs with tf. Most notably, PointCloud2
Small lib to transform sensor_msgs with tf. Most notably, PointCloud2
 
2 2018-11-16 tf2_ros
This package contains the ROS bindings for the tf2 library, for both Python and C++.
This package contains the ROS bindings for the tf2 library, for both Python and C++.
 
2 2018-11-16 tf2_py
The tf2_py package
The tf2_py package
 
2 2018-11-16 tf2_msgs
tf2_msgs
tf2_msgs
 
2 2018-11-16 tf2_kdl
KDL binding for tf2
KDL binding for tf2
 
2 2018-11-16 tf2_geometry_msgs
tf2_geometry_msgs
tf2_geometry_msgs
 
2 2018-11-16 tf2_eigen
tf2_eigen
tf2_eigen
 
2 2018-11-16 tf2_bullet
tf2_bullet
tf2_bullet
 
2 2018-11-16 tf2
tf2 is the second generation of the transform library, which lets the user keep track of multiple coordinate frames over time. tf2 maintains the relationship between coordinate frames in a tree structure buffered in time, and lets the user transform points, vectors, etc between any two coordinate frames at any desired point in time.
tf2 is the second generation of the transform library, which lets the user keep track of multiple coordinate frames over time. tf2 maintains the relationship between coordinate frames in a tree structure buffered in time, and lets the user transform points, vectors, etc between any two coordinate frames at any desired point in time.
 
2 2018-11-16 test_tf2
tf2 unit tests
tf2 unit tests
 
1 2018-11-16 rtmros_common
A package suite that provides all the capabilities for the ROS users to connect to the robots that run on
A package suite that provides all the capabilities for the ROS users to connect to the robots that run on
 
1 2018-11-16 rtmbuild
Build scripts for OpenRTM and OpenHRP
Build scripts for OpenRTM and OpenHRP
 
1 2018-11-16 rosnode_rtc
This package gives transparency between RTM and ROS. rtmros-data-bridge.py is a RT-Component for dataport/topic. This automatically convert ROS/topic into RTM/dataport.
This package gives transparency between RTM and ROS. rtmros-data-bridge.py is a RT-Component for dataport/topic. This automatically convert ROS/topic into RTM/dataport.
 
1 2018-11-16 openrtm_tools
The openrtm_tools package
The openrtm_tools package
 
1 2018-11-16 openrtm_ros_bridge
openrtm_ros_bridge package provides basic functionalities to bind two robotics framework:
openrtm_ros_bridge package provides basic functionalities to bind two robotics framework:
 
1 2018-11-16 hrpsys_tools
The hrpsys_tools package
The hrpsys_tools package
 
1 2018-11-16 hrpsys_ros_bridge
hrpsys_ros_bridge package provides basic functionalities to bind
hrpsys_ros_bridge package provides basic functionalities to bind
 
2 2018-11-16 geometry_experimental
The second generation Transform Library in ros. This metapackage is deprecated, but is kept for backwards compatability.
The second generation Transform Library in ros. This metapackage is deprecated, but is kept for backwards compatability.
 
2 2018-11-16 geometry2
A metapackage to bring in the default packages second generation Transform Library in ros, tf2.
A metapackage to bring in the default packages second generation Transform Library in ros, tf2.
 
1 2018-11-15 naoqi_tools
Set of tools provided by Aldebaran to convert Aldebaran files (URDF, blender...)
Set of tools provided by Aldebaran to convert Aldebaran files (URDF, blender...)
 
1 2018-11-15 naoqi_sensors_py
ROS driver for miscellaneous sensors on NAO. Python bindings for camera, sonar and octomap C++: bindings for camera only (requires NAOqi to build)
ROS driver for miscellaneous sensors on NAO. Python bindings for camera, sonar and octomap C++: bindings for camera only (requires NAOqi to build)
 
1 2018-11-15 naoqi_pose
 
1 2018-11-15 naoqi_navigation
The naoqi_navigation package
The naoqi_navigation package
 
1 2018-11-15 naoqi_driver_py
 
1 2018-11-15 naoqi_bridge
Meta package to interface ROS with Aldebaran's NAOqi.
Meta package to interface ROS with Aldebaran's NAOqi.
 
1 2018-11-15 naoqi_apps
Package bridging NAOqi to executing things on the robot.
Package bridging NAOqi to executing things on the robot.
 
1 2018-11-09 flask_cors
Cross Origin Resource Sharing ( CORS ) support for Flask
Cross Origin Resource Sharing ( CORS ) support for Flask
 
2 2018-11-08 visualization_msgs
visualization_msgs is a set of messages used by higher level packages, such as
visualization_msgs is a set of messages used by higher level packages, such as
 
2 2018-11-08 trajectory_msgs
This package defines messages for defining robot trajectories. These messages are also the building blocks of most of the
This package defines messages for defining robot trajectories. These messages are also the building blocks of most of the
 
2 2018-11-08 stereo_msgs
stereo_msgs contains messages specific to stereo processing, such as disparity images.
stereo_msgs contains messages specific to stereo processing, such as disparity images.
 
2 2018-11-08 shape_msgs
This package contains messages for defining shapes, such as simple solid object primitives (cube, sphere, etc), planes, and meshes.
This package contains messages for defining shapes, such as simple solid object primitives (cube, sphere, etc), planes, and meshes.
 
2 2018-11-08 sensor_msgs
This package defines messages for commonly used sensors, including cameras and scanning laser rangefinders.
This package defines messages for commonly used sensors, including cameras and scanning laser rangefinders.
 

Packages

Name Description
1 2018-02-07 angles
This package provides a set of simple math utilities to work with angles. The utilities cover simple things like normalizing an angle and conversion between degrees and radians. But even if you're trying to calculate things like the shortest angular distance between two joint space positions of your robot, but the joint motion is constrained by joint limits, this package is what you need. The code in this package is stable and well tested. There are no plans for major changes in the near future.
This package provides a set of simple math utilities to work with angles. The utilities cover simple things like normalizing an angle and conversion between degrees and radians. But even if you're trying to calculate things like the shortest angular distance between two joint space positions of your robot, but the joint motion is constrained by joint limits, this package is what you need. The code in this package is stable and well tested. There are no plans for major changes in the near future.
 
1 2018-02-02 dynpick_driver
Driver package for Wacohtech dynpick force sensor. This contains
Driver package for Wacohtech dynpick force sensor. This contains
 
2 2018-01-29 nao_vision
Package for the Nao robot, providing access to NAOqi vision proxies
Package for the Nao robot, providing access to NAOqi vision proxies
 
2 2018-01-29 nao_interaction_msgs
Messages and services declarations for the nao_interaction metapackage
Messages and services declarations for the nao_interaction metapackage
 
2 2018-01-29 nao_interaction_launchers
Launchers for bringing up the nodes of nao_interaction metapackage.
Launchers for bringing up the nodes of nao_interaction metapackage.
 
2 2018-01-29 nao_interaction
 
2 2018-01-29 nao_audio
Package for the Nao robot, providing access to NAOqi audio proxies
Package for the Nao robot, providing access to NAOqi audio proxies
 
1 2018-01-23 uuid_msgs
ROS messages for universally unique identifiers.
ROS messages for universally unique identifiers.
 
1 2018-01-23 unique_identifier
ROS messages and interfaces for universally unique identifiers. Not needed for wet packages, use only to resolve dry stack dependencies.
ROS messages and interfaces for universally unique identifiers. Not needed for wet packages, use only to resolve dry stack dependencies.
 
1 2018-01-23 unique_id
ROS Python and C++ interfaces for universally unique identifiers.
ROS Python and C++ interfaces for universally unique identifiers.
 
1 2018-01-23 slam_gmapping
slam_gmapping contains a wrapper around gmapping which provides SLAM capabilities.
slam_gmapping contains a wrapper around gmapping which provides SLAM capabilities.
 
1 2018-01-23 gmapping
This package contains a ROS wrapper for OpenSlam's Gmapping. The gmapping package provides laser-based SLAM (Simultaneous Localization and Mapping), as a ROS node called slam_gmapping. Using slam_gmapping, you can create a 2-D occupancy grid map (like a building floorplan) from laser and pose data collected by a mobile robot.
This package contains a ROS wrapper for OpenSlam's Gmapping. The gmapping package provides laser-based SLAM (Simultaneous Localization and Mapping), as a ROS node called slam_gmapping. Using slam_gmapping, you can create a 2-D occupancy grid map (like a building floorplan) from laser and pose data collected by a mobile robot.
 
1 2018-01-09 rqt_paramedit
rqt_paramedit - a rqt plugin for editing parameters using qt_paramedit.
rqt_paramedit - a rqt plugin for editing parameters using qt_paramedit.
 
1 2018-01-09 qt_paramedit
A GUI application for viewing and editing ROS parameters.
A GUI application for viewing and editing ROS parameters.
 
1 2018-01-05 velodyne_height_map
Obstacle detection for 3D point clouds using a height map algorithm.
Obstacle detection for 3D point clouds using a height map algorithm.
 
1 2018-01-02 pmb2_simulation
PMB2-specific simulation components. These include plugins and launch scripts necessary for running PMB2 in simulation.
PMB2-specific simulation components. These include plugins and launch scripts necessary for running PMB2 in simulation.
 
1 2018-01-02 pmb2_gazebo
Simulation files for the PMB2 robot.
Simulation files for the PMB2 robot.
 
1 2018-01-02 pmb2_controller_configuration_gazebo
Gazebo-specifig launch files and scripts needed to configure the controllers of the PMB2 robot in simulation.
Gazebo-specifig launch files and scripts needed to configure the controllers of the PMB2 robot in simulation.
 
1 2018-01-02 pmb2_2dnav_gazebo
PMB2-specific launch files needed to run navigation on the PMB2 robot.
PMB2-specific launch files needed to run navigation on the PMB2 robot.
 
1 2017-12-23 segway_rmp
segway_rmp
segway_rmp
 
2 2017-12-14 zbar_ros
Lightweight ROS wrapper for Zbar barcode/qrcode reader library (http://zbar.sourceforge .net/)
Lightweight ROS wrapper for Zbar barcode/qrcode reader library (http://zbar.sourceforge .net/)
 
1 2017-12-14 schunk_svh_driver
SVH Driver wrapper to enable control of the Schunk five finger hand
SVH Driver wrapper to enable control of the Schunk five finger hand
 
1 2017-12-11 open_karto
Catkinized ROS packaging of the OpenKarto library
Catkinized ROS packaging of the OpenKarto library
 
1 2017-12-10 denso_robot_ros
DENSO robot meta package
DENSO robot meta package
 
1 2017-12-10 denso_robot_moveit_config
An automatically generated package with all the configuration and launch files for using the DENSO robots with the MoveIt Motion Planning Framework
An automatically generated package with all the configuration and launch files for using the DENSO robots with the MoveIt Motion Planning Framework
 
1 2017-12-10 denso_robot_gazebo
DENSO robot simulation package
DENSO robot simulation package
 
1 2017-12-10 denso_robot_descriptions
DENSO robot descriptions package
DENSO robot descriptions package
 
1 2017-12-10 denso_robot_core_test
DENSO robot control core test package
DENSO robot control core test package
 
1 2017-12-10 denso_robot_core
DENSO robot control core package
DENSO robot control core package
 
1 2017-12-10 denso_robot_control
DENSO robot control package
DENSO robot control package
 
1 2017-12-10 denso_robot_bringup
DENSO robot bringup package
DENSO robot bringup package
 
1 2017-12-10 bcap_service_test
b-CAP service test package
b-CAP service test package
 
1 2017-12-10 bcap_service
b-CAP service package
b-CAP service package
 
1 2017-12-10 bcap_core
b-CAP core library package
b-CAP core library package
 
1 2017-12-06 test_osm
These are regression tests for the osm_cartography and route_network packages. They are packaged separately to avoid unnecessary implementation dependencies.
These are regression tests for the osm_cartography and route_network packages. They are packaged separately to avoid unnecessary implementation dependencies.
 
1 2017-12-06 route_network
Route network graphing and path planning.
Route network graphing and path planning.
 
1 2017-12-06 osm_cartography
Geographic mapping using Open Street Map data.
Geographic mapping using Open Street Map data.
 
1 2017-11-23 play_motion_msgs
Messages, services and actions used by play_motion.
Messages, services and actions used by play_motion.
 
1 2017-11-23 play_motion
Plays a pre-recorded motion on a robot
Plays a pre-recorded motion on a robot
 
1 2017-11-16 romeo_moveit_config
An automatically generated package with all the configuration and launch files for using the romeoH37 with the MoveIt Motion Planning Framework
An automatically generated package with all the configuration and launch files for using the romeoH37 with the MoveIt Motion Planning Framework
 
1 2017-11-12 object_recognition_tod
Textured Object Recognition a standard bag of features approach
Textured Object Recognition a standard bag of features approach
 
1 2017-11-12 ecto_opencv
Ecto bindings for common opencv functionality.
Ecto bindings for common opencv functionality.
 
1 2017-11-09 object_recognition_transparent_objects
A technique to recognize and estimate poses of transparent objects
A technique to recognize and estimate poses of transparent objects
 
1 2017-11-05 polled_camera
polled_camera contains a service and C++ helper classes for implementing a polled camera driver node and requesting images from it. The package is currently for internal use as the API is still under development.
polled_camera contains a service and C++ helper classes for implementing a polled camera driver node and requesting images from it. The package is currently for internal use as the API is still under development.
 
1 2017-11-05 image_transport
image_transport should always be used to subscribe to and publish images. It provides transparent support for transporting images in low-bandwidth compressed formats. Examples (provided by separate plugin packages) include JPEG/PNG compression and Theora streaming video.
image_transport should always be used to subscribe to and publish images. It provides transparent support for transporting images in low-bandwidth compressed formats. Examples (provided by separate plugin packages) include JPEG/PNG compression and Theora streaming video.
 
1 2017-11-05 image_common
Common code for working with images in ROS.
Common code for working with images in ROS.
 
1 2017-11-05 camera_info_manager
This package provides a C++ interface for camera calibration information. It provides CameraInfo, and handles SetCameraInfo service requests, saving and restoring the camera calibration data.
This package provides a C++ interface for camera calibration information. It provides CameraInfo, and handles SetCameraInfo service requests, saving and restoring the camera calibration data.
 
1 2017-11-05 camera_calibration_parsers
camera_calibration_parsers contains routines for reading and writing camera calibration parameters.
camera_calibration_parsers contains routines for reading and writing camera calibration parameters.
 
1 2017-10-18 nerian_sp1
Node for the SP1 Stereo Vision System by Nerian Vision Technologies
Node for the SP1 Stereo Vision System by Nerian Vision Technologies
 
1 2017-10-17 purepursuit_planner
The purepursuit_planner package. Planner to follow a list of waypoints implementing the Pure Pursuit algorithm.
The purepursuit_planner package. Planner to follow a list of waypoints implementing the Pure Pursuit algorithm.