Packages

Name Description
1 2018-12-31 ecl_sigslots_lite
This avoids use of dynamic storage (malloc/new) and thread safety (mutexes) to provide a very simple sigslots implementation that can be used for *very* embedded development.
This avoids use of dynamic storage (malloc/new) and thread safety (mutexes) to provide a very simple sigslots implementation that can be used for *very* embedded development.
 
1 2018-12-31 ecl_sigslots
Provides a signal/slot mechanism (in the same vein as qt sigslots, boost::signals etc for intra-process communication. These include some improvements - they do not need a preprocessor, are fully type safe, allow for simple connections via a posix style string identifier and are multithread-safe.
Provides a signal/slot mechanism (in the same vein as qt sigslots, boost::signals etc for intra-process communication. These include some improvements - they do not need a preprocessor, are fully type safe, allow for simple connections via a posix style string identifier and are multithread-safe.
 
1 2018-12-31 ecl_mpl
Metaprogramming tools move alot of runtime calculations to be shifted to compile time. This has only very elementary structures at this stage.
Metaprogramming tools move alot of runtime calculations to be shifted to compile time. This has only very elementary structures at this stage.
 
2 2018-12-31 ecl_mobile_robot
Contains transforms (e.g. differential drive inverse kinematics) for the various types of mobile robot platforms.
Contains transforms (e.g. differential drive inverse kinematics) for the various types of mobile robot platforms.
 
1 2018-12-31 ecl_math
This package provides simple support to cmath, filling in holes or redefining in a c++ formulation where desirable.
This package provides simple support to cmath, filling in holes or redefining in a c++ formulation where desirable.
 
2 2018-12-31 ecl_manipulators
Deploys various manipulation algorithms, currently just feedforward filters (interpolations).
Deploys various manipulation algorithms, currently just feedforward filters (interpolations).
 
1 2018-12-31 ecl_lite
Libraries and utilities for embedded and low-level linux development.
Libraries and utilities for embedded and low-level linux development.
 
1 2018-12-31 ecl_linear_algebra
Ecl frontend to a linear matrix package (currently eigen).
Ecl frontend to a linear matrix package (currently eigen).
 
1 2018-12-31 ecl_license
Maintains the ecl licenses and also provides an install target for deploying licenses with the ecl libraries.
Maintains the ecl licenses and also provides an install target for deploying licenses with the ecl libraries.
 
1 2018-12-31 ecl_ipc
Interprocess mechanisms vary greatly across platforms - sysv, posix, win32, there are more than a few. This package provides an infrastructure to allow for developing cross platform c++ wrappers around the lower level c api's that handle these mechanisms. These make it not only easier to utilise such mechanisms, but allow it to be done consistently across platforms.
Interprocess mechanisms vary greatly across platforms - sysv, posix, win32, there are more than a few. This package provides an infrastructure to allow for developing cross platform c++ wrappers around the lower level c api's that handle these mechanisms. These make it not only easier to utilise such mechanisms, but allow it to be done consistently across platforms.
 
1 2018-12-31 ecl_io
Most implementations (windows, posix, ...) have slightly different api for low level input-output functions. These are gathered here and re-represented with a cross platform set of functions.
Most implementations (windows, posix, ...) have slightly different api for low level input-output functions. These are gathered here and re-represented with a cross platform set of functions.
 
1 2018-12-31 ecl_geometry
Any tools relating to mathematical geometry. Primarily featuring polynomials and interpolations.
Any tools relating to mathematical geometry. Primarily featuring polynomials and interpolations.
 
1 2018-12-31 ecl_formatters
The formatters here simply format various input types to a specified text format. They can be used with most streaming types (including both ecl and stl streams).
The formatters here simply format various input types to a specified text format. They can be used with most streaming types (including both ecl and stl streams).
 
1 2018-12-31 ecl_filesystem
Cross platform filesystem utilities (until c++11 makes its way in).
Cross platform filesystem utilities (until c++11 makes its way in).
 
1 2018-12-31 ecl_exceptions
Template based exceptions - these are simple and practical and avoid the proliferation of exception types. Although not syntatactically ideal, it is convenient and eminently practical.
Template based exceptions - these are simple and practical and avoid the proliferation of exception types. Although not syntatactically ideal, it is convenient and eminently practical.
 
1 2018-12-31 ecl_errors
This library provides lean and mean error mechanisms. It includes c style error functions as well as a few useful macros. For higher level mechanisms, refer to ecl_exceptions.
This library provides lean and mean error mechanisms. It includes c style error functions as well as a few useful macros. For higher level mechanisms, refer to ecl_exceptions.
 
1 2018-12-31 ecl_eigen
This provides an Eigen implementation for ecl's linear algebra.
This provides an Eigen implementation for ecl's linear algebra.
 
1 2018-12-31 ecl_devices
Provides an extensible and standardised framework for input-output devices.
Provides an extensible and standardised framework for input-output devices.
 
1 2018-12-31 ecl_core_apps
This includes a suite of programs demo'ing various aspects of the ecl_core. It also includes various benchmarking and utility programs for use primarily with embedded systems.
This includes a suite of programs demo'ing various aspects of the ecl_core. It also includes various benchmarking and utility programs for use primarily with embedded systems.
 
1 2018-12-31 ecl_core
A set of tools and interfaces extending the capabilities of c++ to provide a lightweight, consistent interface with a focus for control programming.
A set of tools and interfaces extending the capabilities of c++ to provide a lightweight, consistent interface with a focus for control programming.
 
1 2018-12-31 ecl_converters_lite
These are a very simple version of some of the functions in ecl_converters suitable for firmware development. That is, there is no use of new, templates or exceptions.
These are a very simple version of some of the functions in ecl_converters suitable for firmware development. That is, there is no use of new, templates or exceptions.
 
1 2018-12-31 ecl_converters
Some fast/convenient type converters, mostly for char strings or strings. These are not really fully fleshed out, alot of them could use the addition for the whole range of fundamental types (e.g. all integers, not just int, unsigned int). They will come as the need arises.
Some fast/convenient type converters, mostly for char strings or strings. These are not really fully fleshed out, alot of them could use the addition for the whole range of fundamental types (e.g. all integers, not just int, unsigned int). They will come as the need arises.
 
1 2018-12-31 ecl_containers
The containers included here are intended to extend the stl containers. In all cases, these implementations are designed to implement c++ conveniences and safety where speed is not sacrificed. Also includes techniques for memory debugging of common problems such as buffer overruns.
The containers included here are intended to extend the stl containers. In all cases, these implementations are designed to implement c++ conveniences and safety where speed is not sacrificed. Also includes techniques for memory debugging of common problems such as buffer overruns.
 
1 2018-12-31 ecl_console
Color codes for ansii consoles.
Color codes for ansii consoles.
 
1 2018-12-31 ecl_config
These tools inspect and describe your system with macros, types and functions.
These tools inspect and describe your system with macros, types and functions.
 
1 2018-12-31 ecl_concepts
Introduces a compile time concept checking mechanism that can be used most commonly to check for required functionality when passing template arguments.
Introduces a compile time concept checking mechanism that can be used most commonly to check for required functionality when passing template arguments.
 
1 2018-12-31 ecl_command_line
Embeds the TCLAP library inside the ecl. This is a very convenient command line parser in templatised c++.
Embeds the TCLAP library inside the ecl. This is a very convenient command line parser in templatised c++.
 
1 2018-12-31 ecl_build
Collection of cmake/make build tools primarily for ecl development itself, but also contains a few cmake modules useful outside of the ecl.
Collection of cmake/make build tools primarily for ecl development itself, but also contains a few cmake modules useful outside of the ecl.
 
1 2018-12-26 librealsense2
Library for capturing data from the Intel(R) RealSense(TM) SR300 and D400 cameras. This effort was initiated to better support researchers, creative coders, and app developers in domains such as robotics, virtual reality, and the internet of things. Several often-requested features of RealSense(TM); devices are implemented in this project, including multi-camera capture.
Library for capturing data from the Intel(R) RealSense(TM) SR300 and D400 cameras. This effort was initiated to better support researchers, creative coders, and app developers in domains such as robotics, virtual reality, and the internet of things. Several often-requested features of RealSense(TM); devices are implemented in this project, including multi-camera capture.
 
1 2018-12-13 theora_image_transport
Theora_image_transport provides a plugin to image_transport for transparently sending an image stream encoded with the Theora codec.
Theora_image_transport provides a plugin to image_transport for transparently sending an image stream encoded with the Theora codec.
 
1 2018-12-13 image_transport_plugins
A set of plugins for publishing and subscribing to sensor_msgs/Image topics in representations other than raw pixel data. For example, for viewing a stream of images off-robot, a video codec will give much lower bandwidth and latency. For low frame rate tranport of high-definition images, you might prefer sending them as JPEG or PNG-compressed form.
A set of plugins for publishing and subscribing to sensor_msgs/Image topics in representations other than raw pixel data. For example, for viewing a stream of images off-robot, a video codec will give much lower bandwidth and latency. For low frame rate tranport of high-definition images, you might prefer sending them as JPEG or PNG-compressed form.
 
1 2018-12-13 compressed_image_transport
Compressed_image_transport provides a plugin to image_transport for transparently sending images encoded as JPEG or PNG.
Compressed_image_transport provides a plugin to image_transport for transparently sending images encoded as JPEG or PNG.
 
1 2018-12-13 compressed_depth_image_transport
Compressed_depth_image_transport provides a plugin to image_transport for transparently sending depth images (raw, floating-point) using PNG compression.
Compressed_depth_image_transport provides a plugin to image_transport for transparently sending depth images (raw, floating-point) using PNG compression.
 
1 2018-12-12 rqt_srv
A Python GUI plugin for introspecting available ROS message types. Note that the srvs available through this plugin is the ones that are stored on your machine, not on the ROS core your rqt instance connects to.
A Python GUI plugin for introspecting available ROS message types. Note that the srvs available through this plugin is the ones that are stored on your machine, not on the ROS core your rqt instance connects to.
 
1 2018-12-12 rqt_console
rqt_console provides a GUI plugin for displaying and filtering ROS messages.
rqt_console provides a GUI plugin for displaying and filtering ROS messages.
 
2 2018-12-12 ros_core
A package to aggregate the packages required to use publish / subscribe, services, generate messages and other core ROS concepts.
A package to aggregate the packages required to use publish / subscribe, services, generate messages and other core ROS concepts.
 
2 2018-12-12 ros_base
A package which extends 'ros_core' and includes other basic functionalities like tf2 and urdf.
A package which extends 'ros_core' and includes other basic functionalities like tf2 and urdf.
 
1 2018-12-12 pluginlib
The pluginlib package provides tools for writing and dynamically loading plugins using the ROS build infrastructure. To work, these tools require plugin providers to register their plugins in the package.xml of their package.
The pluginlib package provides tools for writing and dynamically loading plugins using the ROS build infrastructure. To work, these tools require plugin providers to register their plugins in the package.xml of their package.
 
2 2018-12-12 desktop
A package which extends 'ros_base' and includes high level packages like vizualization tools and demos.
A package which extends 'ros_base' and includes high level packages like vizualization tools and demos.
 
1 2019-05-17 behaviortree_cpp
This package provides a behavior trees core.
This package provides a behavior trees core.
 
1 2018-12-11 rqt_top
RQT plugin for monitoring ROS processes.
RQT plugin for monitoring ROS processes.
 
1 2018-12-11 rqt_shell
rqt_shell is a Python GUI plugin providing an interactive shell.
rqt_shell is a Python GUI plugin providing an interactive shell.
 
1 2018-12-11 rqt_py_console
rqt_py_console is a Python GUI plugin providing an interactive Python console.
rqt_py_console is a Python GUI plugin providing an interactive Python console.
 
1 2018-12-11 python_qt_binding
This stack provides Python bindings for Qt. There are two providers: pyside and pyqt. PySide2 is available under the GPL, LGPL and a commercial license. PyQt is released under the GPL. Both the bindings and tools to build bindings are included from each available provider. For PySide, it is called "Shiboken". For PyQt, this is called "SIP". Also provided is adapter code to make the user's Python code independent of which binding provider was actually used which makes it very easy to switch between these.
This stack provides Python bindings for Qt. There are two providers: pyside and pyqt. PySide2 is available under the GPL, LGPL and a commercial license. PyQt is released under the GPL. Both the bindings and tools to build bindings are included from each available provider. For PySide, it is called "Shiboken". For PyQt, this is called "SIP". Also provided is adapter code to make the user's Python code independent of which binding provider was actually used which makes it very easy to switch between these.
 
1 2018-12-07 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 2018-12-07 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 2018-12-07 image_common
Common code for working with images in ROS.
Common code for working with images in ROS.
 
1 2018-12-07 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 2018-12-07 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.
 
2 2018-12-06 visualization_msgs
A package containing some visualization and interaction related message definitions.
A package containing some visualization and interaction related message definitions.
 

Packages

Name Description
1 2019-05-15 imagesift
For every image, computes its sift features and send a new message with the image, its intrinsic parameters, and the features. Parameters include: display - shows the image on the local computer
For every image, computes its sift features and send a new message with the image, its intrinsic parameters, and the features. Parameters include: display - shows the image on the local computer
 
1 2019-05-15 dataspeed_ulc_msgs
ROS messages for interacting with the Universal Lat/Lon Controller (ULC)
ROS messages for interacting with the Universal Lat/Lon Controller (ULC)
 
1 2019-05-15 dataspeed_ulc_can
Package to translate ROS messages to and from CAN messages to interact with the Universal Lat/Lon Controller (ULC) firmware
Package to translate ROS messages to and from CAN messages to interact with the Universal Lat/Lon Controller (ULC) firmware
 
1 2019-05-15 dataspeed_ulc
CAN interface to the Universal Lat/Lon Controller (ULC) firmware
CAN interface to the Universal Lat/Lon Controller (ULC) firmware
 
1 2019-05-15 checkerboard_detector
Uses opencv to find checkboards and compute their 6D poses with respect to the image. Requires the image to be calibrated.
Uses opencv to find checkboards and compute their 6D poses with respect to the image. Requires the image to be calibrated.
 
1 2019-05-14 yosemite_valley
The yosemite_valley package
The yosemite_valley package
 
1 2019-05-14 socketcan_interface
Generic CAN interface description with helpers for filtering and driver implementation. Further a socketcan implementation based on boost::asio is included.
Generic CAN interface description with helpers for filtering and driver implementation. Further a socketcan implementation based on boost::asio is included.
 
1 2019-05-14 socketcan_bridge
Conversion nodes for messages from SocketCAN to a ROS Topic and vice versa.
Conversion nodes for messages from SocketCAN to a ROS Topic and vice versa.
 
1 2019-05-14 sand_island
The sand_island package
The sand_island package
 
1 2019-05-14 rosfmt
fmt is an open-source formatting library for C++. It can be used as a safe and fast alternative to (s)printf and IOStreams.
fmt is an open-source formatting library for C++. It can be used as a safe and fast alternative to (s)printf and IOStreams.
 
1 2019-05-14 ros_type_introspection
The ros_type_introspection package allows the user to parse and deserialize ROS messages which type is unknown at compilation time.
The ros_type_introspection package allows the user to parse and deserialize ROS messages which type is unknown at compilation time.
 
1 2019-05-14 ros_canopen
A generic canopen implementation for ROS
A generic canopen implementation for ROS
 
1 2019-05-14 mcmillan_airfield
The mcmillan_airfield package
The mcmillan_airfield package
 
1 2019-05-14 ksql_airport
The ksql_airport package
The ksql_airport package
 
1 2019-05-14 canopen_motor_node
canopen_chain_node specialization for handling of canopen_402 motor devices. It facilitates interface abstraction with ros_control.
canopen_chain_node specialization for handling of canopen_402 motor devices. It facilitates interface abstraction with ros_control.
 
1 2019-05-14 canopen_master
CiA(r) CANopen 301 master implementation with support for interprocess master synchronisation.
CiA(r) CANopen 301 master implementation with support for interprocess master synchronisation.
 
1 2019-05-14 canopen_chain_node
Base implementation for CANopen chains node with support for management services and diagnostics
Base implementation for CANopen chains node with support for management services and diagnostics
 
1 2019-05-14 canopen_402
This implements the CANopen device profile for drives and motion control. CiA(r) 402
This implements the CANopen device profile for drives and motion control. CiA(r) 402
 
1 2019-05-14 can_msgs
CAN related message types.
CAN related message types.
 
1 2019-05-13 rqt_rosmon
rqt GUI for rosmon, the node launcher and monitor for ROS. rosmon is a replacement for the roslaunch tool, focused on performance, remote monitoring, and usability.
rqt GUI for rosmon, the node launcher and monitor for ROS. rosmon is a replacement for the roslaunch tool, focused on performance, remote monitoring, and usability.
 
1 2019-05-13 rosmon_msgs
Messages for rosmon, the node launcher and monitor for ROS. rosmon is a replacement for the roslaunch tool, focused on performance, remote monitoring, and usability.
Messages for rosmon, the node launcher and monitor for ROS. rosmon is a replacement for the roslaunch tool, focused on performance, remote monitoring, and usability.
 
1 2019-05-13 rosmon_core
Node launcher and monitor for ROS. rosmon is a replacement for the roslaunch tool, focused on performance, remote monitoring, and usability.
Node launcher and monitor for ROS. rosmon is a replacement for the roslaunch tool, focused on performance, remote monitoring, and usability.
 
1 2019-05-13 rosmon
Node launcher and monitor for ROS. rosmon is a replacement for the roslaunch tool, focused on performance, remote monitoring, and usability.
Node launcher and monitor for ROS. rosmon is a replacement for the roslaunch tool, focused on performance, remote monitoring, and usability.
 
1 2019-05-13 pacmod_game_control
ROS Package for controlling the AStuff PACMod with a Joystick
ROS Package for controlling the AStuff PACMod with a Joystick
 
3 2019-05-13 ml_classifiers
ml_classifiers
ml_classifiers
 
1 2019-05-13 flir_boson_usb
A simple USB camera driver for the FLIR BOSON using OpenCV
A simple USB camera driver for the FLIR BOSON using OpenCV
 
2 2019-05-13 automotive_platform_msgs
Generic Messages for Communication with an Automotive Autonomous Platform
Generic Messages for Communication with an Automotive Autonomous Platform
 
2 2019-05-13 automotive_navigation_msgs
Generic Messages for Navigation Objectives in Automotive Automation Software
Generic Messages for Navigation Objectives in Automotive Automation Software
 
2 2019-05-13 automotive_autonomy_msgs
Messages for vehicle automation
Messages for vehicle automation
 
1 2019-05-13 async_comm
A C++ library for asynchronous serial communication
A C++ library for asynchronous serial communication
 
2 2019-05-13 apriltag
AprilTag detector library
AprilTag detector library
 
2 2019-05-12 rqt_robot_monitor
rqt_robot_monitor displays diagnostics_agg topics messages that are published by
rqt_robot_monitor displays diagnostics_agg topics messages that are published by
 
1 2019-05-12 rdl_urdfreader
The rdl_urdfreader package
The rdl_urdfreader package
 
1 2019-05-12 rdl_ros_tools
ROS interface into rdl tools
ROS interface into rdl tools
 
1 2019-05-12 rdl_msgs
Custom msgs for rdl types
Custom msgs for rdl types
 
1 2019-05-12 rdl_dynamics
The rdl_dynamics package
The rdl_dynamics package
 
1 2019-05-12 rdl_cmake
The rdl_cmake package
The rdl_cmake package
 
1 2019-05-12 rdl_benchmark
The rdl_benchmark package
The rdl_benchmark package
 
1 2019-05-12 rdl
The rdl meta-package
The rdl meta-package
 
2 2019-05-11 rviz
3D visualization tool for ROS.
3D visualization tool for ROS.
 
1 2019-05-10 ensenso_driver
Driver for Ensenso stereo cameras.
Driver for Ensenso stereo cameras.
 
1 2019-05-10 ensenso_description
Description package for Ensenso stereo cameras. This package consists of all current supported camera models. The Xacro macros, which import the mesh files as stl, accept the following parameters: - camera name - parent frame and its transform regarding to the camera mounting frame - collision margin to the camera
Description package for Ensenso stereo cameras. This package consists of all current supported camera models. The Xacro macros, which import the mesh files as stl, accept the following parameters: - camera name - parent frame and its transform regarding to the camera mounting frame - collision margin to the camera
 
1 2019-05-10 ensenso_camera_test
Tests for the ensenso_camera package.
Tests for the ensenso_camera package.
 
1 2019-05-10 ensenso_camera_msgs
Message definitions for the ensenso_camera package.
Message definitions for the ensenso_camera package.
 
1 2019-05-10 ensenso_camera
Driver for Ensenso stereo cameras.
Driver for Ensenso stereo cameras.
 
1 2019-05-09 ypspur
YP-Spur is a mobile robot motion control software with coordinate frame based commands.
YP-Spur is a mobile robot motion control software with coordinate frame based commands.
 
1 2019-05-09 webots_ros
The ROS package containing examples for interfacing ROS with the standard ROS controller of Webots
The ROS package containing examples for interfacing ROS with the standard ROS controller of Webots
 
1 2019-05-09 fiducials
Localization using fiducial markers
Localization using fiducial markers
 
1 2019-05-09 fiducial_slam
ROS node to build a 3D map of fiducials and estimate robot pose from fiducial transforms
ROS node to build a 3D map of fiducials and estimate robot pose from fiducial transforms
 
1 2019-05-09 fiducial_msgs
Package containing message definitions for fiducials
Package containing message definitions for fiducials
 

Packages

Name Description
1 2019-04-25 desistek_saga_gazebo
Package with launch files for demonstrations with the Desistek SAGA ROV underwater vehicle
Package with launch files for demonstrations with the Desistek SAGA ROV underwater vehicle
 
1 2019-04-25 desistek_saga_description
The robot description files for the Desistek SAGA ROV underwater vehicle
The robot description files for the Desistek SAGA ROV underwater vehicle
 
1 2019-04-25 desistek_saga_control
Configuration and launch files to control the Desistek SAGA ROV
Configuration and launch files to control the Desistek SAGA ROV
 
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
 
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-17 rosflight_utils
Supporting utilities for ROSflight packages
Supporting utilities for ROSflight packages
 
1 2019-04-17 rosflight_sim
Software-in-the-loop (SIL) simulator for the ROSflight firmware
Software-in-the-loop (SIL) simulator for the ROSflight firmware
 
1 2019-04-17 rosflight_pkgs
ROS interface for the ROSflight autpilot stack
ROS interface for the ROSflight autpilot stack
 
1 2019-04-17 rosflight_msgs
Message and service definitions for the ROSflight ROS stack
Message and service definitions for the ROSflight ROS stack
 
1 2019-04-17 rosflight_firmware
Firmware library for software-in-the-loop of the ROSflight ROS stack
Firmware library for software-in-the-loop of the ROSflight ROS stack
 
1 2019-04-17 rosflight
Package for interfacing to the ROSflight autopilot firmware over MAVLink
Package for interfacing to the ROSflight autopilot firmware over MAVLink
 
1 2019-04-17 ocl
Orocos component library This package contains standard components for the Orocos Toolchain
Orocos component library This package contains standard components for the Orocos Toolchain
 
1 2019-04-14 pid
Launch a PID control node.
Launch a PID control node.
 
1 2019-04-12 towr_ros
A ROS dependent wrapper for
A ROS dependent wrapper for
 
1 2019-04-12 towr
A light-weight, Eigen-based C++ library for trajectory optimization for legged robots. This library provides implementations for variables, costs and constraints that can be used to represent a legged locomotion problem. The resulting Nonlinear Programming Problem (NLP) can then be solved with off-the-shelf solvers, e.g. Ipopt using the generic optimizer interface
A light-weight, Eigen-based C++ library for trajectory optimization for legged robots. This library provides implementations for variables, costs and constraints that can be used to represent a legged locomotion problem. The resulting Nonlinear Programming Problem (NLP) can then be solved with off-the-shelf solvers, e.g. Ipopt using the generic optimizer interface
 
1 2019-04-11 mvsim
Node for the "multivehicle simulator" framework.
Node for the "multivehicle simulator" framework.
 
2 2019-04-10 openhrp3
 
1 2019-04-09 genpy
Python ROS message and service generators.
Python ROS message and service generators.
 
1 2019-04-09 frame_editor
The frame_editor package
The frame_editor package
 
1 2019-04-09 flexbe_widget
flexbe_widget implements some smaller scripts for the behavior engine.
flexbe_widget implements some smaller scripts for the behavior engine.
 
1 2019-04-09 flexbe_testing
flexbe_testing provides a framework for unit testing states.
flexbe_testing provides a framework for unit testing states.
 
1 2019-04-09 flexbe_states
flexbe_states provides a collection of predefined states. Feel free to add new states.
flexbe_states provides a collection of predefined states. Feel free to add new states.
 
1 2019-04-09 flexbe_onboard
flexbe_onboard implements the robot-side of the behavior engine from where all behaviors are started.
flexbe_onboard implements the robot-side of the behavior engine from where all behaviors are started.
 
1 2019-04-09 flexbe_msgs
flexbe_msgs provides the messages used by FlexBE.
flexbe_msgs provides the messages used by FlexBE.
 
1 2019-04-09 flexbe_mirror
flexbe_mirror implements functionality to remotely mirror an executed behavior.
flexbe_mirror implements functionality to remotely mirror an executed behavior.
 
1 2019-04-09 flexbe_input
flexbe_input enables to send data to onboard behavior when required.
flexbe_input enables to send data to onboard behavior when required.
 
1 2019-04-09 flexbe_core
flexbe_core provides the core smach extension for the FlexBE behavior engine.
flexbe_core provides the core smach extension for the FlexBE behavior engine.
 
1 2019-04-09 flexbe_behavior_engine
A meta-package to aggregate all the FlexBE packages
A meta-package to aggregate all the FlexBE packages
 
1 2019-04-09 flexbe_app
flexbe_app provides a user interface (editor + runtime control) for the FlexBE behavior engine.
flexbe_app provides a user interface (editor + runtime control) for the FlexBE behavior engine.
 
1 2019-04-08 velocity_controllers
velocity_controllers
velocity_controllers
 
1 2019-04-08 rqt_joint_trajectory_controller
Graphical frontend for interacting with joint_trajectory_controller instances.
Graphical frontend for interacting with joint_trajectory_controller instances.
 
1 2019-04-08 ros_controllers
Library of ros controllers
Library of ros controllers
 

Packages

Name Description
1 2019-05-20 cob_model_identifier
The cob_model_identifier package
The cob_model_identifier package
 
1 2019-05-20 cob_manipulation
The cob_manipulation stack includes packages that provide manipulation capabilities for Care-O-bot.
The cob_manipulation stack includes packages that provide manipulation capabilities for Care-O-bot.
 
1 2019-05-20 cob_lookat_action
cob_lookat_action
cob_lookat_action
 
1 2019-05-20 cob_grasp_generation
Grasp generation for Care-O-bot based on OpenRAVE
Grasp generation for Care-O-bot based on OpenRAVE
 
1 2019-05-20 cob_frame_tracker
The cob_frame_tracker package
The cob_frame_tracker package
 
1 2019-05-20 cob_footprint_observer
The cob_footprint_observer package adjusts the footprint of the robot based on the setup (e.g. arm and/or tray).
The cob_footprint_observer package adjusts the footprint of the robot based on the setup (e.g. arm and/or tray).
 
1 2019-05-20 cob_description
This package contains the description (mechanical, kinematic, visual, etc.) of the Care-O-bot robot. 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 the Care-O-bot robot. 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-20 cob_control_msgs
Common messages and services used in various packages within cob_control.
Common messages and services used in various packages within cob_control.
 
1 2019-05-20 cob_control_mode_adapter
The cob_control_mode_adapter package
The cob_control_mode_adapter package
 
1 2019-05-20 cob_control
cob_control meta-package
cob_control meta-package
 
1 2019-05-20 cob_common
The cob_common stack hosts common packages that are used within the Care-O-bot repository. E.g. utility packages or common message and service definitions etc. Also the urdf desciption of the robot is located in this stack.
The cob_common stack hosts common packages that are used within the Care-O-bot repository. E.g. utility packages or common message and service definitions etc. Also the urdf desciption of the robot is located in this stack.
 
1 2019-05-20 cob_collision_velocity_filter
The cob_collision_velocity_filter package is a package for collision avoidance using teleoperation.
The cob_collision_velocity_filter package is a package for collision avoidance using teleoperation.
 
1 2019-05-20 cob_collision_monitor
The collision monitor uses the planning scene monitor to read the state of the robot and check it for collision with itselt or the environment. It addition a ground plane is added in any case. Can be used as a stand-aloan node or a move_group capability.
The collision monitor uses the planning scene monitor to read the state of the robot and check it for collision with itselt or the environment. It addition a ground plane is added in any case. Can be used as a stand-aloan node or a move_group capability.
 
1 2019-05-20 cob_cartesian_controller
This package provides nodes that broadcast tf-frames along various (model-based) Cartesian paths (e.g. Linear, Circular). The tf-frames are interpolated using a given velocity profile (e.g. Ramp, Sinoid) and can be used as targets for the cob_frame_tracker/cob_twist_controller.
This package provides nodes that broadcast tf-frames along various (model-based) Cartesian paths (e.g. Linear, Circular). The tf-frames are interpolated using a given velocity profile (e.g. Ramp, Sinoid) and can be used as targets for the cob_frame_tracker/cob_twist_controller.
 
1 2019-05-20 cob_base_velocity_smoother
The 'cob_base_velocity_smoother' reads velocity messages and publishes messages of the same type for "smoothed" velocity to avoid shaking behavior.
The 'cob_base_velocity_smoother' reads velocity messages and publishes messages of the same type for "smoothed" velocity to avoid shaking behavior.
 
1 2019-05-20 cob_base_controller_utils
The cob_base_controller_utils package
The cob_base_controller_utils package
 
1 2019-05-20 cob_actions
This Package contains Care-O-bot specific action definitions.
This Package contains Care-O-bot specific action definitions.
 
1 2019-05-20 cloudwatch_metrics_collector
Subscriber node for the aws/monitoring topic to publish metrics to AWS Cloudwatch
Subscriber node for the aws/monitoring topic to publish metrics to AWS Cloudwatch
 
1 2019-05-20 cloudwatch_logger
CloudWatch Logger node for publishing logs to AWS CloudWatch Logs
CloudWatch Logger node for publishing logs to AWS CloudWatch Logs
 
1 2019-05-20 aws_ros1_common
Common utilities for ROS1 nodes using Amazon Web Services
Common utilities for ROS1 nodes using Amazon Web Services
 
1 2019-05-20 aws_common
Common AWS SDK utilities, intended for use by ROS packages using the AWS SDK
Common AWS SDK utilities, intended for use by ROS packages using the AWS SDK
 
1 2019-05-20 actionlib_enhanced
The actionlib_enhanced package
The actionlib_enhanced package
 
1 2019-05-19 simple_drive
A simple robot drive system that includes skid steering joystick teleoperation, control of a panning servo to look around the robot, and Arduino firmware.
A simple robot drive system that includes skid steering joystick teleoperation, control of a panning servo to look around the robot, and Arduino firmware.
 
1 2019-05-19 plotjuggler
PlotJuggler: juggle with data
PlotJuggler: juggle with data
 
1 2019-05-19 cob_android_settings
cob_android_settings
cob_android_settings
 
1 2019-05-19 cob_android_script_server
cob_android_script_server
cob_android_script_server
 
1 2019-05-19 cob_android_resource_server
cob_android_resource_server
cob_android_resource_server
 
1 2019-05-19 cob_android_msgs
cob_android_msgs
cob_android_msgs
 
1 2019-05-19 cob_android
cob_android package provides tools for android apps operation.
cob_android package provides tools for android apps operation.
 
1 2019-05-17 svenzva_utils
Svenzva Arm utilities that streamline arm-code interaction
Svenzva Arm utilities that streamline arm-code interaction
 
1 2019-05-17 svenzva_simulation
Files relating to running 3D simulations of Svenzva manipulators
Files relating to running 3D simulations of Svenzva manipulators
 
1 2019-05-17 svenzva_ros
The svenzva_ros meta-package
The svenzva_ros meta-package
 
1 2019-05-17 svenzva_msgs
Svenzva arm and state related messages.
Svenzva arm and state related messages.
 
1 2019-05-17 svenzva_moveit
An automatically generated package with all the configuration and launch files for using the revel with the MoveIt! Motion Planning Framework
An automatically generated package with all the configuration and launch files for using the revel with the MoveIt! Motion Planning Framework
 
1 2019-05-17 svenzva_joy
The svenzva_joy package
The svenzva_joy package
 
1 2019-05-17 svenzva_drivers
The svenza_drivers package
The svenza_drivers package
 
1 2019-05-17 svenzva_description
Svenzva robot description files
Svenzva robot description files
 
1 2019-05-17 svenzva_demo
The svenzva_demo package
The svenzva_demo package
 
1 2019-05-17 pacmod3
AutonomouStuff PACMod v3 Driver Package
AutonomouStuff PACMod v3 Driver Package
 
1 2019-05-17 cnn_bridge
The cnn_bridge package take freeze graphs and publishes them as ROS messages
The cnn_bridge package take freeze graphs and publishes them as ROS messages
 
1 2019-05-17 behaviortree_cpp_v3
This package provides the Behavior Trees core library.
This package provides the Behavior Trees core library.
 
1 2019-05-16 sick_scan
A ROS driver for the SICK TiM and SICK MRS series of laser scanners. This package is based on the original sick_tim-repository of Martin Günther et al.
A ROS driver for the SICK TiM and SICK MRS series of laser scanners. This package is based on the original sick_tim-repository of Martin Günther et al.
 
1 2019-05-16 rtt_geometry
This metapackage contains tools for integrating the Orocos Kinematics and Dynamics Library (KDL) with the Orocos Toolchain and Real-Time Toolkit (RTT).
This metapackage contains tools for integrating the Orocos Kinematics and Dynamics Library (KDL) with the Orocos Toolchain and Real-Time Toolkit (RTT).
 
1 2019-05-16 omronsentech_camera
omronsentech_camera package contains a basic functionality to access OMRON SENTECH Camera. This package requires installation of SentechSDK.
omronsentech_camera package contains a basic functionality to access OMRON SENTECH Camera. This package requires installation of SentechSDK.
 
1 2019-05-16 moveit_runtime
moveit_runtime meta package contains MoveIt! packages that are essential for its runtime (e.g. running MoveIt! on robots).
moveit_runtime meta package contains MoveIt! packages that are essential for its runtime (e.g. running MoveIt! on robots).
 
1 2019-05-16 moveit_planners_chomp
The interface for using CHOMP within MoveIt!
The interface for using CHOMP within MoveIt!
 
1 2019-05-16 moveit_kinematics
Package for all inverse kinematics solvers in MoveIt!
Package for all inverse kinematics solvers in MoveIt!
 
1 2019-05-16 moveit_experimental
Experimental packages for moveit.
Experimental packages for moveit.
 
1 2019-05-16 moveit_chomp_optimizer_adapter
MoveIt planning request adapter utilizing chomp for solution optimization
MoveIt planning request adapter utilizing chomp for solution optimization
 
1 2019-05-16 moveit
Meta package that contains all essential package of MoveIt!. Until Summer 2016 MoveIt! had been developed over multiple repositories, where developers' usability and maintenance effort was non-trivial. See
Meta package that contains all essential package of MoveIt!. Until Summer 2016 MoveIt! had been developed over multiple repositories, where developers' usability and maintenance effort was non-trivial. See
 

Packages

Name Description
1 2019-04-30 master_discovery_fkie
Discover the running ROS Masters in local network. The discovering is done by sending an echo heartbeat messages to a defined multicast group. The alternative is to use a zeroconf/avahi daemon to register the ROS master as service and discover other ROS masters.
Discover the running ROS Masters in local network. The discovering is done by sending an echo heartbeat messages to a defined multicast group. The alternative is to use a zeroconf/avahi daemon to register the ROS master as service and discover other ROS masters.
 
1 2019-04-30 kvaser_interface
Kvaser CAN interface for ROS device drivers.
Kvaser CAN interface for ROS device drivers.
 
1 2019-04-30 default_cfg_fkie
The configuration node loads a given launch configuration and offers services to list or start the contained nodes. It provides additional description extracted from launch file. This is used by node_manager_fkie.
The configuration node loads a given launch configuration and offers services to list or start the contained nodes. It provides additional description extracted from launch file. This is used by node_manager_fkie.
 
1 2019-04-30 dbw_pacifica_msgs
Drive-by-wire messages for the Chrysler Pacifica
Drive-by-wire messages for the Chrysler Pacifica
 
1 2019-04-30 dbw_pacifica_joystick_speed_demo
Demonstration of drive-by-wire with joystick with speed control
Demonstration of drive-by-wire with joystick with speed control
 
1 2019-04-30 dbw_pacifica_joystick_demo
Demonstration of drive-by-wire with joystick
Demonstration of drive-by-wire with joystick
 
1 2019-04-30 dbw_pacifica_can
Drive-by-wire interface to the Chrysler Pacifica DBW kit
Drive-by-wire interface to the Chrysler Pacifica DBW kit
 
1 2019-04-30 dbc
DBC file interface. Read a DBC file, unpack CAN messages and convert to engineering units, pack values into CAN messages for publishing.
DBC file interface. Read a DBC file, unpack CAN messages and convert to engineering units, pack values into CAN messages for publishing.
 
1 2019-04-29 msp
Implementation of the MultiWii Serial Protocol (MSP)
Implementation of the MultiWii Serial Protocol (MSP)
 
1 2019-04-29 jsk_visualization
 
1 2019-04-29 jsk_rviz_plugins
The jsk_rviz_plugins package
The jsk_rviz_plugins package
 
1 2019-04-29 jsk_rqt_plugins
The jsk_rqt_plugins package
The jsk_rqt_plugins package
 
1 2019-04-29 jsk_interactive_test
jsk_interactive_test
jsk_interactive_test
 
1 2019-04-29 jsk_interactive_marker
jsk interactive markers
jsk interactive markers
 
1 2019-04-29 jsk_interactive
jsk_interactive
jsk_interactive
 
1 2019-04-27 pr2eus_tutorials
pr2eus_tutorials
pr2eus_tutorials
 
1 2019-04-27 pr2eus_openrave
pr2eus_openrave
pr2eus_openrave
 
1 2019-04-27 pr2eus_moveit
pr2eus_moveit
pr2eus_moveit
 
1 2019-04-27 pr2eus_impedance
pr2eus_impedance
pr2eus_impedance
 
1 2019-04-27 pr2eus_armnavigation
pr2eus_armnavigation
pr2eus_armnavigation
 
1 2019-04-27 pr2eus
pr2eus
pr2eus
 
1 2019-04-27 jsk_pr2eus
 
1 2019-04-26 multi_object_tracking_lidar
ROS package for Multiple objects detection, tracking and classification from LIDAR scans/point-clouds
ROS package for Multiple objects detection, tracking and classification from LIDAR scans/point-clouds
 
1 2019-04-26 freight_bringup
Bringup for freight
Bringup for freight
 
1 2019-04-26 fetch_teleop
Teleoperation for fetch and freight.
Teleoperation for fetch and freight.
 
1 2019-04-26 fetch_ros
Fetch ROS, packages for working with Fetch and Freight
Fetch ROS, packages for working with Fetch and Freight
 
1 2019-04-26 fetch_navigation
Configuration and launch files for running ROS navigation on Fetch.
Configuration and launch files for running ROS navigation on Fetch.
 
1 2019-04-26 fetch_moveit_config
An automatically generated package with all the configuration and launch files for using the fetch_urdf with the MoveIt Motion Planning Framework
An automatically generated package with all the configuration and launch files for using the fetch_urdf with the MoveIt Motion Planning Framework
 
1 2019-04-26 fetch_maps
The fetch_maps package
The fetch_maps package
 
1 2019-04-26 fetch_ikfast_plugin
Kinematics plugin for Fetch robot, generated through IKFast
Kinematics plugin for Fetch robot, generated through IKFast
 
1 2019-04-26 fetch_description
URDF for Fetch Robot.
URDF for Fetch Robot.
 
1 2019-04-26 fetch_depth_layer
The fetch_depth_layer package
The fetch_depth_layer package
 
1 2019-04-26 fetch_calibration
Launch and configuration files for calibrating Fetch using the 'robot_calibration' package.
Launch and configuration files for calibrating Fetch using the 'robot_calibration' package.
 
1 2019-04-26 fetch_bringup
Bringup for fetch
Bringup for fetch
 
1 2019-04-26 fcl
FCL is a collision checking library
FCL is a collision checking library
 
1 2019-04-25 video_stream_opencv
The video_stream_opencv package contains a node to publish a video stream (the protocols that opencv supports are supported, including rtsp, webcams on /dev/video and video files) in ROS image topics, it supports camera info and basic image flipping (horizontal, vertical or both) capabilities, also adjusting publishing rate.
The video_stream_opencv package contains a node to publish a video stream (the protocols that opencv supports are supported, including rtsp, webcams on /dev/video and video files) in ROS image topics, it supports camera info and basic image flipping (horizontal, vertical or both) capabilities, also adjusting publishing rate.
 
1 2019-04-25 swri_profiler_tools
Provides tools for viewing data produced by nodes that use the swri_profiler library to output profiling information.
Provides tools for viewing data produced by nodes that use the swri_profiler library to output profiling information.
 
1 2019-04-25 swri_profiler_msgs
Messages for the swri_profiler tool.
Messages for the swri_profiler tool.
 
1 2019-04-25 swri_profiler
swri_profiler provides basic tools for real-time selective profiling of ROS C++ nodes.
swri_profiler provides basic tools for real-time selective profiling of ROS C++ nodes.
 
1 2019-04-24 pr2_self_test_msgs
Messages used in PR2 hardware testing.
Messages used in PR2 hardware testing.
 
1 2019-04-24 pr2_self_test
The pr2_self_test package
The pr2_self_test package
 
1 2019-04-24 pr2_motor_diagnostic_tool
pr2_motor_diagnostic_tool
pr2_motor_diagnostic_tool
 
1 2019-04-24 pr2_counterbalance_check
pr2_counterbalance_check
pr2_counterbalance_check
 
1 2019-04-24 pr2_bringup_tests
Complete functionality tests for PR2. Contains utilities designed to test and verify devices, mechanicals and sensors.
Complete functionality tests for PR2. Contains utilities designed to test and verify devices, mechanicals and sensors.
 
1 2019-04-24 libpolypartition
Wraps the polypartition library to use it as a ROS dependency
Wraps the polypartition library to use it as a ROS dependency
 
1 2019-04-24 libopenmesh
Wraps the (external) OpenMesh library.
Wraps the (external) OpenMesh library.
 
1 2019-04-24 libgpc
Wraps the (external) GPC library.
Wraps the (external) GPC library.
 
1 2019-04-24 libcgal_addons
Installs some additional CGAL dependencies for ROS Kinetic.
Installs some additional CGAL dependencies for ROS Kinetic.
 
1 2019-04-24 joint_qualification_controllers
Controllers used in PR2 hardware testing. For testing counterbalance of PR2, and for internal WG use.
Controllers used in PR2 hardware testing. For testing counterbalance of PR2, and for internal WG use.
 
1 2019-04-24 cob_table_object_cluster
Nodes for segmenting objects on a table.
Nodes for segmenting objects on a table.
 

Packages

Name Description
2 2019-02-03 rqt_tf_tree
rqt_tf_tree provides a GUI plugin for visualizing the ROS TF frame tree.
rqt_tf_tree provides a GUI plugin for visualizing the ROS TF frame tree.
 
1 2019-01-31 interactive_markers
3D interactive marker communication library for RViz and similar tools.
3D interactive marker communication library for RViz and similar tools.
 
1 2019-01-30 imu_transformer
Node/nodelet combination to transform sensor_msgs::Imu data from one frame into another.
Node/nodelet combination to transform sensor_msgs::Imu data from one frame into another.
 
1 2019-01-30 imu_processors
Processors for sensor_msgs::Imu data
Processors for sensor_msgs::Imu data
 
1 2019-01-30 imu_pipeline
imu_pipeline
imu_pipeline
 
1 2019-01-23 rosdoc_lite
This ROS package wraps documentation tools like doxygen, sphinx, and epydoc, making it convenient to generate ROS package documentation. It also generates online documentation for the ROS wiki.
This ROS package wraps documentation tools like doxygen, sphinx, and epydoc, making it convenient to generate ROS package documentation. It also generates online documentation for the ROS wiki.
 
2 2019-01-21 teleop_twist_joy
Generic joystick teleop for twist robots.
Generic joystick teleop for twist robots.
 
1 2019-01-16 rtt
Orocos/RTT component framework
Orocos/RTT component framework
 
1 2019-05-22 microstrain_3dm_gx5_45
The microstrain_3dm_gx5_45 package provides a driver for the LORD/Microstrain 3DM_GXx_45 GPS-aided IMU sensor.
The microstrain_3dm_gx5_45 package provides a driver for the LORD/Microstrain 3DM_GXx_45 GPS-aided IMU sensor.
 
1 2019-01-16 geneus
EusLisp ROS message and service generators.
EusLisp ROS message and service generators.
 
1 2019-01-11 rqt_topic
rqt_topic provides a GUI plugin for displaying debug information about ROS topics including publishers, subscribers, publishing rate, and ROS Messages.
rqt_topic provides a GUI plugin for displaying debug information about ROS topics including publishers, subscribers, publishing rate, and ROS Messages.
 
1 2019-01-05 ueye
Driver for IDS Imaging uEye cameras.
Driver for IDS Imaging uEye cameras.
 
1 2018-12-31 ecl_utilities
Includes various supporting tools and utilities for c++ programming.
Includes various supporting tools and utilities for c++ programming.
 
1 2018-12-31 ecl_type_traits
Extends c++ type traits and implements a few more to boot.
Extends c++ type traits and implements a few more to boot.
 
1 2018-12-31 ecl_tools
Tools and utilities for ecl development.
Tools and utilities for ecl development.
 
1 2018-12-31 ecl_time_lite
Provides a portable set of time functions that are especially useful for porting other code or being wrapped by higher level c++ classes.
Provides a portable set of time functions that are especially useful for porting other code or being wrapped by higher level c++ classes.
 
1 2018-12-31 ecl_time
Timing utilities are very dependent on the system api provided for their use. This package provides a means for handling different timing models. Current support - posix rt : complete. - macosx : posix timers only, missing absolute timers. - win : none.
Timing utilities are very dependent on the system api provided for their use. This package provides a means for handling different timing models. Current support - posix rt : complete. - macosx : posix timers only, missing absolute timers. - win : none.
 
1 2018-12-31 ecl_threads
This package provides the c++ extensions for a variety of threaded programming tools. These are usually different on different platforms, so the architecture for a cross-platform framework is also implemented.
This package provides the c++ extensions for a variety of threaded programming tools. These are usually different on different platforms, so the architecture for a cross-platform framework is also implemented.
 
1 2018-12-31 ecl_streams
These are lightweight text streaming classes that connect to standardised ecl type devices.
These are lightweight text streaming classes that connect to standardised ecl type devices.
 
1 2018-12-31 ecl_statistics
Common statistical structures and algorithms for control systems.
Common statistical structures and algorithms for control systems.
 
1 2018-12-31 ecl_sigslots_lite
This avoids use of dynamic storage (malloc/new) and thread safety (mutexes) to provide a very simple sigslots implementation that can be used for *very* embedded development.
This avoids use of dynamic storage (malloc/new) and thread safety (mutexes) to provide a very simple sigslots implementation that can be used for *very* embedded development.
 
1 2018-12-31 ecl_sigslots
Provides a signal/slot mechanism (in the same vein as qt sigslots, boost::signals etc for intra-process communication. These include some improvements - they do not need a preprocessor, are fully type safe, allow for simple connections via a posix style string identifier and are multithread-safe.
Provides a signal/slot mechanism (in the same vein as qt sigslots, boost::signals etc for intra-process communication. These include some improvements - they do not need a preprocessor, are fully type safe, allow for simple connections via a posix style string identifier and are multithread-safe.
 
1 2018-12-31 ecl_mpl
Metaprogramming tools move alot of runtime calculations to be shifted to compile time. This has only very elementary structures at this stage.
Metaprogramming tools move alot of runtime calculations to be shifted to compile time. This has only very elementary structures at this stage.
 
1 2018-12-31 ecl_math
This package provides simple support to cmath, filling in holes or redefining in a c++ formulation where desirable.
This package provides simple support to cmath, filling in holes or redefining in a c++ formulation where desirable.
 
1 2018-12-31 ecl_lite
Libraries and utilities for embedded and low-level linux development.
Libraries and utilities for embedded and low-level linux development.
 
1 2018-12-31 ecl_linear_algebra
Ecl frontend to a linear matrix package (currently eigen).
Ecl frontend to a linear matrix package (currently eigen).
 
1 2018-12-31 ecl_license
Maintains the ecl licenses and also provides an install target for deploying licenses with the ecl libraries.
Maintains the ecl licenses and also provides an install target for deploying licenses with the ecl libraries.
 
1 2018-12-31 ecl_ipc
Interprocess mechanisms vary greatly across platforms - sysv, posix, win32, there are more than a few. This package provides an infrastructure to allow for developing cross platform c++ wrappers around the lower level c api's that handle these mechanisms. These make it not only easier to utilise such mechanisms, but allow it to be done consistently across platforms.
Interprocess mechanisms vary greatly across platforms - sysv, posix, win32, there are more than a few. This package provides an infrastructure to allow for developing cross platform c++ wrappers around the lower level c api's that handle these mechanisms. These make it not only easier to utilise such mechanisms, but allow it to be done consistently across platforms.
 
1 2018-12-31 ecl_io
Most implementations (windows, posix, ...) have slightly different api for low level input-output functions. These are gathered here and re-represented with a cross platform set of functions.
Most implementations (windows, posix, ...) have slightly different api for low level input-output functions. These are gathered here and re-represented with a cross platform set of functions.
 
1 2018-12-31 ecl_geometry
Any tools relating to mathematical geometry. Primarily featuring polynomials and interpolations.
Any tools relating to mathematical geometry. Primarily featuring polynomials and interpolations.
 
1 2018-12-31 ecl_formatters
The formatters here simply format various input types to a specified text format. They can be used with most streaming types (including both ecl and stl streams).
The formatters here simply format various input types to a specified text format. They can be used with most streaming types (including both ecl and stl streams).
 
1 2018-12-31 ecl_filesystem
Cross platform filesystem utilities (until c++11 makes its way in).
Cross platform filesystem utilities (until c++11 makes its way in).
 
1 2018-12-31 ecl_exceptions
Template based exceptions - these are simple and practical and avoid the proliferation of exception types. Although not syntatactically ideal, it is convenient and eminently practical.
Template based exceptions - these are simple and practical and avoid the proliferation of exception types. Although not syntatactically ideal, it is convenient and eminently practical.
 
1 2018-12-31 ecl_errors
This library provides lean and mean error mechanisms. It includes c style error functions as well as a few useful macros. For higher level mechanisms, refer to ecl_exceptions.
This library provides lean and mean error mechanisms. It includes c style error functions as well as a few useful macros. For higher level mechanisms, refer to ecl_exceptions.
 
1 2018-12-31 ecl_eigen
This provides an Eigen implementation for ecl's linear algebra.
This provides an Eigen implementation for ecl's linear algebra.
 
1 2018-12-31 ecl_devices
Provides an extensible and standardised framework for input-output devices.
Provides an extensible and standardised framework for input-output devices.
 
1 2018-12-31 ecl_core_apps
This includes a suite of programs demo'ing various aspects of the ecl_core. It also includes various benchmarking and utility programs for use primarily with embedded systems.
This includes a suite of programs demo'ing various aspects of the ecl_core. It also includes various benchmarking and utility programs for use primarily with embedded systems.
 
1 2018-12-31 ecl_core
A set of tools and interfaces extending the capabilities of c++ to provide a lightweight, consistent interface with a focus for control programming.
A set of tools and interfaces extending the capabilities of c++ to provide a lightweight, consistent interface with a focus for control programming.
 
1 2018-12-31 ecl_converters_lite
These are a very simple version of some of the functions in ecl_converters suitable for firmware development. That is, there is no use of new, templates or exceptions.
These are a very simple version of some of the functions in ecl_converters suitable for firmware development. That is, there is no use of new, templates or exceptions.
 
1 2018-12-31 ecl_converters
Some fast/convenient type converters, mostly for char strings or strings. These are not really fully fleshed out, alot of them could use the addition for the whole range of fundamental types (e.g. all integers, not just int, unsigned int). They will come as the need arises.
Some fast/convenient type converters, mostly for char strings or strings. These are not really fully fleshed out, alot of them could use the addition for the whole range of fundamental types (e.g. all integers, not just int, unsigned int). They will come as the need arises.
 
1 2018-12-31 ecl_containers
The containers included here are intended to extend the stl containers. In all cases, these implementations are designed to implement c++ conveniences and safety where speed is not sacrificed. Also includes techniques for memory debugging of common problems such as buffer overruns.
The containers included here are intended to extend the stl containers. In all cases, these implementations are designed to implement c++ conveniences and safety where speed is not sacrificed. Also includes techniques for memory debugging of common problems such as buffer overruns.
 
1 2018-12-31 ecl_console
Color codes for ansii consoles.
Color codes for ansii consoles.
 
1 2018-12-31 ecl_config
These tools inspect and describe your system with macros, types and functions.
These tools inspect and describe your system with macros, types and functions.
 
1 2018-12-31 ecl_concepts
Introduces a compile time concept checking mechanism that can be used most commonly to check for required functionality when passing template arguments.
Introduces a compile time concept checking mechanism that can be used most commonly to check for required functionality when passing template arguments.
 
1 2018-12-31 ecl_command_line
Embeds the TCLAP library inside the ecl. This is a very convenient command line parser in templatised c++.
Embeds the TCLAP library inside the ecl. This is a very convenient command line parser in templatised c++.
 
1 2018-12-31 ecl_build
Collection of cmake/make build tools primarily for ecl development itself, but also contains a few cmake modules useful outside of the ecl.
Collection of cmake/make build tools primarily for ecl development itself, but also contains a few cmake modules useful outside of the ecl.
 
1 2018-12-22 libccd
libccd is library for collision detection between two convex shapes.
libccd is library for collision detection between two convex shapes.
 
1 2018-12-18 vigir_walk_monitor
The vigir_walk_monitor package
The vigir_walk_monitor package
 
1 2018-12-18 vigir_pattern_generator
The vigir_pattern_generator package
The vigir_pattern_generator package
 
1 2018-12-18 vigir_global_footstep_planner
The vigir_global_footstep_planner package
The vigir_global_footstep_planner package
 

Packages

Name Description
2 2018-04-25 pr2_navigation_slam
This package holds launch files for running the
This package holds launch files for running the
 
2 2018-04-25 pr2_navigation_self_filter
Filters the robot's body out of point clouds.
Filters the robot's body out of point clouds.
 
2 2018-04-25 pr2_navigation_perception
This package holds navigation-specific sensor configuration options and launch files for the PR2.
This package holds navigation-specific sensor configuration options and launch files for the PR2.
 
2 2018-04-25 pr2_navigation_local
This package holds xml files for running the
This package holds xml files for running the
 
2 2018-04-25 pr2_navigation_global
This package holds XML files for running the
This package holds XML files for running the
 
2 2018-04-25 pr2_navigation_config
This package holds common configuration files for running the
This package holds common configuration files for running the
 
2 2018-04-25 pr2_navigation
The pr2_navigation stack holds common configuration options for running the
The pr2_navigation stack holds common configuration options for running the
 
2 2018-04-25 pr2_move_base
pr2_move_base
pr2_move_base
 
2 2018-04-25 laser_tilt_controller_filter
laser_tilt_controller_filter
laser_tilt_controller_filter
 
1 2018-04-22 epuck_driver
The epuck_driver package
The epuck_driver package
 
1 2018-04-15 vrep_ros_plugin
The vrep_ros_plugin package
The vrep_ros_plugin package
 
1 2018-04-15 vrep_ros_bridge
The main application of the plugin is to provide a communication interface between V-Rep and (ROS). The aim is to control the V-Rep simulation externally using ROS messages and ROS services.
The main application of the plugin is to provide a communication interface between V-Rep and (ROS). The aim is to control the V-Rep simulation externally using ROS messages and ROS services.
 
1 2018-04-15 rigid_body_handler
The rigid_body_handler package
The rigid_body_handler package
 
1 2018-04-15 quadrotor_tk_handler
The quadrotor_tk_handler package
The quadrotor_tk_handler package
 
1 2018-04-15 quadrotor_handler
The quadrotor_handler package
The quadrotor_handler package
 
1 2018-04-15 manipulator_handler
The manipulator_handler package
The manipulator_handler package
 
1 2018-04-15 imu_handler
The imu_handler package
The imu_handler package
 
1 2018-04-15 force_sensor_handler
The force_sensor_handler package
The force_sensor_handler package
 
1 2018-04-15 drawing_handler
The rigid_body_handler package
The rigid_body_handler package
 
1 2018-04-15 contact_handler
The contact_handler package. It reports the dynamic-engine-reported contacts between all scene objects on a topic called "contacts". This package uses gazebo_msgs/ContactsState message type to report body contacts. This is because ROS doesn't have any standardized contact reporting messages. However, to have gazebo_msgs, you don't need to install whole Gazebo, you just need to install the single package ros-indigo-gazebo-msgs.
The contact_handler package. It reports the dynamic-engine-reported contacts between all scene objects on a topic called "contacts". This package uses gazebo_msgs/ContactsState message type to report body contacts. This is because ROS doesn't have any standardized contact reporting messages. However, to have gazebo_msgs, you don't need to install whole Gazebo, you just need to install the single package ros-indigo-gazebo-msgs.
 
1 2018-04-15 camera_handler
The camera_handler package
The camera_handler package
 
2 2018-04-12 libuvc_ros
libuvc_ros metapackage
libuvc_ros metapackage
 
2 2018-04-12 libuvc_camera
USB Video Class camera driver
USB Video Class camera driver
 
1 2018-04-09 pmb2_robot
PMB2 robot description and launch files
PMB2 robot description and launch files
 
1 2018-04-09 pmb2_description
Mechanical, kinematic, visual, etc. description of the PMB2 robot. The files in this package are parsed and used by a variety of other components. Most users will not interact directly with this package.
Mechanical, kinematic, visual, etc. description of the PMB2 robot. 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 2018-04-09 pmb2_controller_configuration
Launch files and scripts needed to configure the controllers of the PMB2 robot.
Launch files and scripts needed to configure the controllers of the PMB2 robot.
 
1 2018-04-09 pmb2_bringup
Launch files and scripts needed to bring up the ROS nodes of a PMB2 robot.
Launch files and scripts needed to bring up the ROS nodes of a PMB2 robot.
 
2 2018-04-04 lms1xx
The lms1xx package contains a basic ROS driver for the SICK LMS1xx line of LIDARs.
The lms1xx package contains a basic ROS driver for the SICK LMS1xx line of LIDARs.
 
1 2018-03-28 rospeex_webaudiomonitor
This package provides a browser-based waveform monitor of rospeex's (beta version). This package requires an external web browser: Google Chrome or Firefox.
This package provides a browser-based waveform monitor of rospeex's (beta version). This package requires an external web browser: Google Chrome or Firefox.
 
1 2018-03-28 rospeex_samples
This package provides some rospeex samples.
This package provides some rospeex samples.
 
1 2018-03-28 rospeex_msgs
This package defines messages used in rospeex.
This package defines messages used in rospeex.
 
1 2018-03-28 rospeex_launch
This package launches rospeex's core nodes.
This package launches rospeex's core nodes.
 
1 2018-03-28 rospeex_if
This package provides interface libraries on C++ and Python.
This package provides interface libraries on C++ and Python.
 
1 2018-03-28 rospeex_core
This package provides rospeex's core nodes.
This package provides rospeex's core nodes.
 
1 2018-03-28 rospeex_audiomonitor
This package provides a stable waveform monitor of rospeex's (recommended). This package requires an external library: qtmobility-dev.
This package provides a stable waveform monitor of rospeex's (recommended). This package requires an external library: qtmobility-dev.
 
1 2018-03-28 rospeex
Meta package for rospeex packages.
Meta package for rospeex packages.
 
1 2018-03-27 wfov_camera_msgs
Messages related to the Point Grey camera driver.
Messages related to the Point Grey camera driver.
 
1 2018-03-27 statistics_msgs
Messages related to the Point Grey camera driver.
Messages related to the Point Grey camera driver.
 
1 2018-03-27 pointgrey_camera_driver
Point Grey camera driver based on libflycapture2.
Point Grey camera driver based on libflycapture2.
 
1 2018-03-27 pointgrey_camera_description
URDF descriptions for Point Grey cameras
URDF descriptions for Point Grey cameras
 
1 2018-03-27 image_exposure_msgs
Messages related to the Point Grey camera driver.
Messages related to the Point Grey camera driver.
 
1 2018-03-27 geographic_msgs
ROS messages for Geographic Information Systems.
ROS messages for Geographic Information Systems.
 
1 2018-03-27 geographic_info
Geographic information metapackage. Not needed for wet packages, use only to resolve dry stack dependencies.
Geographic information metapackage. Not needed for wet packages, use only to resolve dry stack dependencies.
 
1 2018-03-27 geodesy
Python and C++ interfaces for manipulating geodetic coordinates.
Python and C++ interfaces for manipulating geodetic coordinates.
 
1 2018-02-14 app_manager
app_manager
app_manager
 
2 2018-02-13 pr2_mechanism_msgs
This package defines services that are used to communicate with the realtime control loop. It also defines messages that represent the state of the realtime controllers, the joints and the actuators.
This package defines services that are used to communicate with the realtime control loop. It also defines messages that represent the state of the realtime controllers, the joints and the actuators.
 
1 2018-02-11 pepper_sensors_py
The pepper_sensors package
The pepper_sensors package
 
1 2018-02-11 pepper_robot
The pepper_robot package
The pepper_robot package
 
1 2018-02-11 pepper_description
The pepper_description package
The pepper_description package
 
1 2018-02-11 pepper_bringup
The pepper_bringup package
The pepper_bringup package