Packages

Name Description
3 2019-05-13 ml_classifiers
ml_classifiers
ml_classifiers
 
1 2019-03-29 mk
A collection of .mk include files for building ROS architectural elements. Most package authors should use cmake .mk, which calls CMake for the build of the package. The other files in this package are intended for use in exotic situations that mostly arise when importing 3rdparty code.
A collection of .mk include files for building ROS architectural elements. Most package authors should use cmake .mk, which calls CMake for the build of the package. The other files in this package are intended for use in exotic situations that mostly arise when importing 3rdparty code.
 
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
 
1 2019-05-23 mini_maxwell
mini_maxwell
mini_maxwell
 
1 2014-01-15 microstrain_3dmgx2_imu
A driver for IMUs compatible the microstrain 3DM-GX2 and 3DM-GX3 protocol. Includes a heavily modified standalone driver pulled from the player distribution, and a ROS node.
A driver for IMUs compatible the microstrain 3DM-GX2 and 3DM-GX3 protocol. Includes a heavily modified standalone driver pulled from the player distribution, and a ROS node.
 
1 2013-08-21 message_runtime
Package modeling the run-time dependencies for language bindings of messages.
Package modeling the run-time dependencies for language bindings of messages.
 
1 2016-04-28 message_generation
Package modeling the build-time dependencies for generating language bindings of messages.
Package modeling the build-time dependencies for generating language bindings of messages.
 
3 2019-04-23 message_filters
A set of 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 message filters which take in messages and may output those messages at a later time, based on the conditions that filter needs met.
 
1 2014-03-24 media_export
Placeholder package enabling generic export of media paths.
Placeholder package enabling generic export of media paths.
 
1 2015-12-26 md49_serialport
The md49_serialport package
The md49_serialport package
 
1 2015-12-26 md49_messages
The md49_messages package
The md49_messages package
 
1 2015-12-26 md49_base_controller
The md49_base_controller package
The md49_base_controller package
 
1 2019-05-14 mcmillan_airfield
The mcmillan_airfield package
The mcmillan_airfield package
 
1 2019-05-23 mcl_3dl_msgs
The mcl_3dl message definition package
The mcl_3dl message definition package
 
1 2019-05-23 mcl_3dl
3-D/6-DOF localization for mobile robots with 3-D LIDAR(s)
3-D/6-DOF localization for mobile robots with 3-D LIDAR(s)
 
1 2018-11-13 mbf_utility
The mbf_utility package
The mbf_utility package
 
1 2018-11-13 mbf_simple_nav
The mbf_simple_nav package contains a simple navigation server implementation of Move Base Flex (MBF). The simple navigation server is bound to no map representation. It provides actions for planning, controlling and recovering. MBF loads all defined plugins which are defined in the lists *planners*, *controllers* and *recovery_behaviors*. Each list holds a pair of a *name* and a *type*. The *type* defines which kind of plugin to load. The *name* defines under which name the plugin should be callable by the actions. It tries to load the defined plugins which implements the defined interfaces in
The mbf_simple_nav package contains a simple navigation server implementation of Move Base Flex (MBF). The simple navigation server is bound to no map representation. It provides actions for planning, controlling and recovering. MBF loads all defined plugins which are defined in the lists *planners*, *controllers* and *recovery_behaviors*. Each list holds a pair of a *name* and a *type*. The *type* defines which kind of plugin to load. The *name* defines under which name the plugin should be callable by the actions. It tries to load the defined plugins which implements the defined interfaces in
 
1 2018-11-13 mbf_msgs
The move_base_flex messages package providing the action definition files for the action GetPath, ExePath, Recovery and MoveBase. The action servers providing these action are implemented in
The move_base_flex messages package providing the action definition files for the action GetPath, ExePath, Recovery and MoveBase. The action servers providing these action are implemented in
 
1 2018-11-13 mbf_costmap_nav
The mbf_costmap_nav package contains the costmap navigation server implementation of Move Base Flex (MBF). The costmap navigation server is bound to the
The mbf_costmap_nav package contains the costmap navigation server implementation of Move Base Flex (MBF). The costmap navigation server is bound to the
 
1 2018-11-13 mbf_costmap_core
This package provides common interfaces for navigation specific robot actions. It contains the CostmapPlanner, CostmapController and CostmapRecovery interfaces. The interfaces have to be implemented by the plugins to make them available for Move Base Flex using the mbf_costmap_nav navigation implementation. That implementation inherits the mbf_abstract_nav implementation and binds the system to a local and a global costmap.
This package provides common interfaces for navigation specific robot actions. It contains the CostmapPlanner, CostmapController and CostmapRecovery interfaces. The interfaces have to be implemented by the plugins to make them available for Move Base Flex using the mbf_costmap_nav navigation implementation. That implementation inherits the mbf_abstract_nav implementation and binds the system to a local and a global costmap.
 
1 2018-11-13 mbf_abstract_nav
The mbf_abstract_nav package contains the abstract navigation server implementation of Move Base Flex (MBF). The abstract navigation server is not bound to any map representation. It provides the actions for planning, controlling and recovering. MBF loads all defined plugins at the program start. Therefor, it loads all plugins which are defined in the lists *planners*, *controllers* and *recovery_behaviors*. Each list holds a pair of a *name* and a *type*. The *type* defines which kind of plugin to load. The *name* defines under which name the plugin should be callable by the actions.
The mbf_abstract_nav package contains the abstract navigation server implementation of Move Base Flex (MBF). The abstract navigation server is not bound to any map representation. It provides the actions for planning, controlling and recovering. MBF loads all defined plugins at the program start. Therefor, it loads all plugins which are defined in the lists *planners*, *controllers* and *recovery_behaviors*. Each list holds a pair of a *name* and a *type*. The *type* defines which kind of plugin to load. The *name* defines under which name the plugin should be callable by the actions.
 
1 2018-11-13 mbf_abstract_core
This package provides common interfaces for navigation specific robot actions. It contains the AbstractPlanner, AbstractController and AbstractRecovery plugin interfaces. This interfaces have to be implemented by the plugins to make the plugin available for Move Base Flex. The abstract classes provides a meaningful interface enabling the planners, controllers and recovery behaviors to return information, e.g. why something went wrong. Derivided interfaces can, for example, provide methods to initialize the planner, controller or recovery with map representations like costmap_2d, grid_map or other representations.
This package provides common interfaces for navigation specific robot actions. It contains the AbstractPlanner, AbstractController and AbstractRecovery plugin interfaces. This interfaces have to be implemented by the plugins to make the plugin available for Move Base Flex. The abstract classes provides a meaningful interface enabling the planners, controllers and recovery behaviors to return information, e.g. why something went wrong. Derivided interfaces can, for example, provide methods to initialize the planner, controller or recovery with map representations like costmap_2d, grid_map or other representations.
 
1 2019-05-22 mavros_msgs
mavros_msgs defines messages for
mavros_msgs defines messages for
 
1 2019-05-22 mavros_extras
Extra nodes and plugins for
Extra nodes and plugins for
 
1 2019-05-22 mavros
MAVROS -- MAVLink extendable communication node for ROS with proxy for Ground Control Station.
MAVROS -- MAVLink extendable communication node for ROS with proxy for Ground Control Station.
 
1 2019-05-20 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 2018-08-24 mav_planning_msgs
Messages specific to MAV planning, especially polynomial planning.
Messages specific to MAV planning, especially polynomial planning.
 
1 2018-08-24 mav_msgs
Package containing messages for communicating with rotary wing MAVs
Package containing messages for communicating with rotary wing MAVs
 
1 2018-08-24 mav_comm
Contains messages and services for MAV communication
Contains messages and services for MAV communication
 
1 2019-04-30 master_sync_fkie
Synchronize the local ROS master to the remote masters discovered by master_discovery_fkie node. The registration of topics and services is only perform by local ROS master.
Synchronize the local ROS master to the remote masters discovered by master_discovery_fkie node. The registration of topics and services is only perform by local ROS master.
 
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 2018-10-19 marti_visualization_msgs
marti_visualization_msgs
marti_visualization_msgs
 
1 2018-10-19 marti_status_msgs
marti_status_msgs
marti_status_msgs
 
1 2018-10-19 marti_sensor_msgs
marti_sensor_msgs
marti_sensor_msgs
 
1 2018-10-19 marti_perception_msgs
marti_perception_msgs
marti_perception_msgs
 
1 2018-10-19 marti_nav_msgs
marti_nav_msgs
marti_nav_msgs
 
1 2019-05-23 marti_data_structures
marti_data_structures
marti_data_structures
 
1 2018-10-19 marti_common_msgs
marti_common_msgs
marti_common_msgs
 
1 2018-10-19 marti_can_msgs
marti_can_msgs
marti_can_msgs
 
1 2018-05-30 marker_msgs
The marker_msgs package contains messages usable to setup a marker/fiducial system. The package distinguishes between two types of messages. First messages to describe the properties of a marker/fiducial detection system and the detected markers. Secondly messages used to represent a map of markers/features with covariances as it would be produced by a SLAM system or published by a map server for self-localization.
The marker_msgs package contains messages usable to setup a marker/fiducial system. The package distinguishes between two types of messages. First messages to describe the properties of a marker/fiducial detection system and the detected markers. Secondly messages used to represent a map of markers/features with covariances as it would be produced by a SLAM system or published by a map server for self-localization.
 
1 2018-11-04 mapviz_plugins
Common plugins for the Mapviz visualization tool
Common plugins for the Mapviz visualization tool
 
1 2018-11-04 mapviz
mapviz
mapviz
 
2 2019-04-28 map_server
map_server provides the
map_server provides the
 

Packages

Name Description
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 2014-11-02 grasping_msgs
Messages for describing objects and how to grasp them.
Messages for describing objects and how to grasp them.
 
1 2015-12-10 graph_msgs
ROS messages for publishing graphs of different data types
ROS messages for publishing graphs of different data types
 
2 2018-08-13 gpsd_client
connects to a GPSd server and broadcasts GPS fixes using the NavSatFix message
connects to a GPSd server and broadcasts GPS fixes using the NavSatFix message
 
2 2018-08-13 gps_umd
gps_umd metapackage
gps_umd metapackage
 
2 2018-08-13 gps_common
GPS messages and common routines for use in GPS drivers
GPS messages and common routines for use in GPS drivers
 
1 2019-03-26 goal_passer
A global planner plugin for move_base that simply passes the target pose on as a global plan. Useful for debugging local planners.
A global planner plugin for move_base that simply passes the target pose on as a global plan. Useful for debugging local planners.
 
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 2019-05-24 global_planner_tests
A collection of tests for checking the validity and completeness of global planners.
A collection of tests for checking the validity and completeness of global planners.
 
2 2019-02-28 global_planner
A path planner library and node.
A path planner library and node.
 
1 2016-04-28 gl_dependency
This encapsulates the GL dependency for a specific ROS distribution and its Qt version
This encapsulates the GL dependency for a specific ROS distribution and its Qt version
 
1 2017-08-07 geometry_tutorials
Metapackage of geometry tutorials ROS.
Metapackage of geometry tutorials ROS.
 
2 2018-11-08 geometry_msgs
geometry_msgs provides messages for common geometric primitives such as points, vectors, and poses. These primitives are designed to provide a common data type and facilitate interoperability throughout the system.
geometry_msgs provides messages for common geometric primitives such as points, vectors, and poses. These primitives are designed to provide a common data type and facilitate interoperability throughout the system.
 
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-07-06 geometry
 
1 2018-12-10 geometric_shapes
This package contains generic definitions of geometric shapes and bodies.
This package contains generic definitions of geometric shapes and bodies.
 
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 2019-04-09 genpy
Python ROS message and service generators.
Python ROS message and service generators.
 
1 2017-02-16 gennodejs
Javascript ROS message and service generators.
Javascript ROS message and service generators.
 
1 2019-03-04 genmsg
Standalone Python library for generating ROS message and service data structures for various languages.
Standalone Python library for generating ROS message and service data structures for various languages.
 
1 2016-09-02 genlisp
Common-Lisp ROS message and service generators.
Common-Lisp ROS message and service generators.
 
1 2019-01-16 geneus
EusLisp ROS message and service generators.
EusLisp ROS message and service generators.
 
1 2019-03-18 gencpp
C++ ROS message and service generators.
C++ ROS message and service generators.
 
1 2018-09-16 gcloud_speech_utils
Utilities and examples for gcloud_speech package.
Utilities and examples for gcloud_speech package.
 
1 2018-09-16 gcloud_speech_msgs
ROS message definitions for gcloud_speech and relevant packages.
ROS message definitions for gcloud_speech and relevant packages.
 
1 2018-09-16 gcloud_speech
Google Cloud Speech client.
Google Cloud Speech client.
 
1 2019-03-23 gazebo_ros_pkgs
Interface for using ROS with the
Interface for using ROS with the
 
1 2019-03-23 gazebo_ros_control
gazebo_ros_control
gazebo_ros_control
 
1 2019-03-23 gazebo_ros
Provides ROS plugins that offer message and service publishers for interfacing with
Provides ROS plugins that offer message and service publishers for interfacing with
 
1 2019-03-23 gazebo_plugins
Robot-independent Gazebo plugins for sensors, motors and dynamic reconfigurable components.
Robot-independent Gazebo plugins for sensors, motors and dynamic reconfigurable components.
 
1 2019-03-23 gazebo_msgs
Message and service data structures for interacting with Gazebo from ROS.
Message and service data structures for interacting with Gazebo from ROS.
 
1 2019-03-23 gazebo_dev
Provides a cmake config for the default version of Gazebo for the ROS distribution.
Provides a cmake config for the default version of Gazebo for the ROS distribution.
 
1 2018-08-08 franka_visualization
This package contains visualization tools for Franka Emika.
This package contains visualization tools for Franka Emika.
 
1 2018-08-08 franka_ros
franka_ros is a metapackage for all Franka Emika ROS packages
franka_ros is a metapackage for all Franka Emika ROS packages
 
1 2018-08-08 franka_msgs
franka_msgs provides messages specific to Franka Emika research robots
franka_msgs provides messages specific to Franka Emika research robots
 

Packages

Name Description
1 2018-07-30 robot_controllers_msgs
Messages for use with robot_controllers framework.
Messages for use with robot_controllers framework.
 
1 2018-07-30 robot_controllers_interface
Generic framework for robot controls.
Generic framework for robot controls.
 
1 2018-07-30 robot_controllers
Some basic robot controllers for use with robot_controllers_interface.
Some basic robot controllers for use with robot_controllers_interface.
 
1 2018-09-06 robot_calibration_msgs
Messages for calibrating a robot
Messages for calibrating a robot
 
1 2018-09-06 robot_calibration
Calibrate a Robot
Calibrate a Robot
 
1 2019-01-18 robot_activity_tutorials
The robot_activity_tutorials package
The robot_activity_tutorials package
 
1 2019-01-18 robot_activity_msgs
This package contains messages used by robot_activity, such as node's state and error
This package contains messages used by robot_activity, such as node's state and error
 
1 2019-01-18 robot_activity
The robot_activity package implements ROS node lifecycle
The robot_activity package implements ROS node lifecycle
 
1 2018-04-02 robot
A metapackage which extends ros_base and includes ROS libaries for any robot hardware. It may not contain any GUI dependencies.
A metapackage which extends ros_base and includes ROS libaries for any robot hardware. It may not contain any GUI dependencies.
 
1 2016-05-25 ridgeback_viz
Visualization launchers and helpers for Ridgeback.
Visualization launchers and helpers for Ridgeback.
 
1 2018-04-25 ridgeback_simulator
Packages for simulating Ridgeback.
Packages for simulating Ridgeback.
 
1 2019-03-25 ridgeback_navigation
Launch files and code for autonomous navigation of the Ridgeback
Launch files and code for autonomous navigation of the Ridgeback
 
1 2019-03-25 ridgeback_msgs
Messages exclusive to Ridgeback, especially for representing low-level motor commands and sensors.
Messages exclusive to Ridgeback, especially for representing low-level motor commands and sensors.
 
1 2018-04-25 ridgeback_gazebo_plugins
A fork of hector_gazebo_plugins to provide the ros_force_based_move plugin.
A fork of hector_gazebo_plugins to provide the ros_force_based_move plugin.
 
1 2018-04-25 ridgeback_gazebo
Launchfiles to use Ridgeback in Gazebo.
Launchfiles to use Ridgeback in Gazebo.
 
1 2016-05-25 ridgeback_desktop
Packages for working with Ridgeback from a ROS desktop.
Packages for working with Ridgeback from a ROS desktop.
 
1 2019-03-25 ridgeback_description
URDF robot description for Ridgeback
URDF robot description for Ridgeback
 
1 2019-03-25 ridgeback_control
Controllers for Ridgeback
Controllers for Ridgeback
 
1 2018-03-21 rh_p12_rn_manager
Manager package using ROBOTIS framework to control the RH-P12-RN
Manager package using ROBOTIS framework to control the RH-P12-RN
 
1 2018-03-21 rh_p12_rn_gui
This package provides GUI interface to control the RH-P12-RN
This package provides GUI interface to control the RH-P12-RN
 
1 2018-03-21 rh_p12_rn_gazebo
This package provides basic message pub and launch file to use RH-P12-RN on Gazebo
This package provides basic message pub and launch file to use RH-P12-RN on Gazebo
 
1 2018-03-21 rh_p12_rn_description
3D models of the RH-P12-RN for simulation and visualization
3D models of the RH-P12-RN for simulation and visualization
 
1 2018-03-21 rh_p12_rn_base_module_msgs
This package includes ROS messages and services for the rh_p12_rn packages
This package includes ROS messages and services for the rh_p12_rn packages
 
1 2018-03-21 rh_p12_rn_base_module
Base module using ROBOTIS framework for RH-P12-RN
Base module using ROBOTIS framework for RH-P12-RN
 
1 2018-03-21 rh_p12_rn
ROS messages packages for the ROBOTIS RH-P12-RN (meta package)
ROS messages packages for the ROBOTIS RH-P12-RN (meta package)
 
1 2017-04-17 rgbd_launch
Launch files to open an RGBD device and load all nodelets to convert raw depth/RGB/IR streams to depth images, disparity images, and (registered) point clouds.
Launch files to open an RGBD device and load all nodelets to convert raw depth/RGB/IR streams to depth images, disparity images, and (registered) point clouds.
 
1 2017-05-02 rfsm
This package contains the rFSM flavor of Statecharts.
This package contains the rFSM flavor of Statecharts.
 
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-23 respeaker_ros
The respeaker_ros package
The respeaker_ros package
 
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-05-15 resized_image_transport
ROS nodes to publish resized images.
ROS nodes to publish resized images.
 
1 2019-01-24 recordit
Record the joint_states and/or the mobile changes (via tf) of a ROS system as three.js animation
Record the joint_states and/or the mobile changes (via tf) of a ROS system as three.js animation
 
1 2019-02-10 realtime_tools
Contains a set of tools that can be used from a hard realtime thread, without breaking the realtime behavior. The tools currently only provides the realtime publisher, which makes it possible to publish messages to a ROS topic from a realtime thread. We plan to add a basic implementation of a realtime buffer, to make it possible to get data from a (non-realtime) topic callback into the realtime loop. Once the lockfree buffer is created, the realtime publisher will start using it, which will result in major API changes for the realtime publisher (removal of all lock methods).
Contains a set of tools that can be used from a hard realtime thread, without breaking the realtime behavior. The tools currently only provides the realtime publisher, which makes it possible to publish messages to a ROS topic from a realtime thread. We plan to add a basic implementation of a realtime buffer, to make it possible to get data from a (non-realtime) topic callback into the realtime loop. Once the lockfree buffer is created, the realtime publisher will start using it, which will result in major API changes for the realtime publisher (removal of all lock methods).
 
1 2018-07-04 realsense_camera
RealSense Camera package allowing access to Intel 3D cameras and advanced modules
RealSense Camera package allowing access to Intel 3D cameras and advanced modules
 
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
 
1 2019-05-20 rc_visard_driver
The rc_visard_driver provides data from a Roboception rc_visard 3D sensor on several ROS topics.
The rc_visard_driver provides data from a Roboception rc_visard 3D sensor on several ROS topics.
 
1 2019-05-20 rc_visard_description
Visualization package for rc_visard
Visualization package for rc_visard
 
1 2019-05-20 rc_visard
Roboception rc_visard support meta package
Roboception rc_visard support meta package
 
1 2019-05-20 rc_tagdetect_client
The ros client for roboception tag detection modules
The ros client for roboception tag detection modules
 
1 2019-05-20 rc_pick_client
The ros client for roboception grasp generation modules
The ros client for roboception grasp generation modules
 
1 2019-05-20 rc_hand_eye_calibration_client
The rc_hand_eye_calibration_client package
The rc_hand_eye_calibration_client package
 
1 2019-05-20 rc_genicam_api
GenICam/GigE Vision Convenience Layer. This package combines the Roboception convenience layer for images with the GenICam reference implementation and a GigE Vision transport layer. It is a self contained package that permits configuration and image streaming of GenICam / GigE Vision 2.0 compatible cameras like the Roboception rc_visard. This package also provides some tools that can be called from the command line for discovering cameras, changing their configuration and streaming images. Although the tools are meant to be useful when working in a shell or in a script, their main purpose is to serve as example on how to use the API for reading and setting parameters, streaming and synchronizing images. See LICENSE.md for licensing terms of the different parts.
GenICam/GigE Vision Convenience Layer. This package combines the Roboception convenience layer for images with the GenICam reference implementation and a GigE Vision transport layer. It is a self contained package that permits configuration and image streaming of GenICam / GigE Vision 2.0 compatible cameras like the Roboception rc_visard. This package also provides some tools that can be called from the command line for discovering cameras, changing their configuration and streaming images. Although the tools are meant to be useful when working in a shell or in a script, their main purpose is to serve as example on how to use the API for reading and setting parameters, streaming and synchronizing images. See LICENSE.md for licensing terms of the different parts.
 

Packages

Name Description
1 2015-07-28 rocon_devices
rocon devices meta package
rocon devices meta package
 
1 2015-07-08 rocon_device_msgs
Messages used by rocon devices
Messages used by rocon devices
 
1 2015-12-10 rocon_console
Command line python console utilities (mostly for colourisation).
Command line python console utilities (mostly for colourisation).
 
1 2015-08-27 rocon_concert
The concert framework modules.
The concert framework modules.
 
1 2015-12-10 rocon_bubble_icons
Bubble icon library for rocon.
Bubble icon library for rocon.
 
1 2015-07-08 rocon_apps
Core rocon apps for use with the appmanager and rocon concert.
Core rocon apps for use with the appmanager and rocon concert.
 
1 2015-07-08 rocon_app_utilities
The rocon_app_utilities package
The rocon_app_utilities package
 
1 2015-07-08 rocon_app_platform
Robot application platform for ros robots with a default implementation in python.
Robot application platform for ros robots with a default implementation in python.
 
1 2015-07-08 rocon_app_manager_msgs
Messages used by the platform app manager.
Messages used by the platform app manager.
 
1 2015-07-08 rocon_app_manager
The public interface and retaskable interface for a robot.
The public interface and retaskable interface for a robot.
 
1 2016-10-11 rocon
This is a meta package for robotics in concert(a.k.a rocon)
This is a meta package for robotics in concert(a.k.a rocon)
 
1 2018-02-07 roch_viz
Visualization configuration for Soy roch
Visualization configuration for Soy roch
 
1 2018-12-16 roch_teleop
Soy roch controller configurations
Soy roch controller configurations
 
1 2018-02-08 roch_simulator
Metapackage for Soy roch simulation software
Metapackage for Soy roch simulation software
 
1 2018-12-16 roch_sensorpc
Ult/psd/cliff to pointcloud: Publish Ult, cliff, and psd sensors events as points in a pointcloud, so navistack can use them for poor-man navigation. Implemented intended to run together with roch_base.
Ult/psd/cliff to pointcloud: Publish Ult, cliff, and psd sensors events as points in a pointcloud, so navistack can use them for poor-man navigation. Implemented intended to run together with roch_base.
 
1 2018-12-16 roch_safety_controller
A controller ensuring the safe operation of roch. The SafetyController keeps track of ult, psd and cliff events. In case of the first three, roch is commanded to move back. This controller can be enabled/disabled. The safety states (cliff, psd and ult etc.) can be reset. WARNING: Dangerous! Refrence with yujinrobot' kobuki.
A controller ensuring the safe operation of roch. The SafetyController keeps track of ult, psd and cliff events. In case of the first three, roch is commanded to move back. This controller can be enabled/disabled. The safety states (cliff, psd and ult etc.) can be reset. WARNING: Dangerous! Refrence with yujinrobot' kobuki.
 
1 2018-12-16 roch_robot
Metapackage for SawYer roch robot software
Metapackage for SawYer roch robot software
 
1 2018-12-16 roch_navigation
Autonomous mapping and navigation demos for the Soy Roch
Autonomous mapping and navigation demos for the Soy Roch
 
1 2018-12-16 roch_msgs
Messages, serivices and actions for SawYer roch
Messages, serivices and actions for SawYer roch
 
1 2018-02-08 roch_gazebo
Soy roch Simulator bringup
Soy roch Simulator bringup
 
1 2018-12-16 roch_ftdi
Utilities for flashing and enabling roch's USB connection. This package contains tools for flashing the roch's FTDI chip (usually done at the factory). The special firmware for the FTDI chip (USB to serial converter) enables it to appear as /dev/roch on the user's PC.
Utilities for flashing and enabling roch's USB connection. This package contains tools for flashing the roch's FTDI chip (usually done at the factory). The special firmware for the FTDI chip (USB to serial converter) enables it to appear as /dev/roch on the user's PC.
 
1 2018-12-16 roch_follower
Follower for the roch. Follows humans and robots around by following the centroid of a box points in front of the roch.
Follower for the roch. Follows humans and robots around by following the centroid of a box points in front of the roch.
 
1 2018-12-16 roch_description
SawYer Roch URDF description
SawYer Roch URDF description
 
1 2018-12-16 roch_control
SawYer roch controller configurations
SawYer roch controller configurations
 
1 2018-05-27 roch_concert
Concert package for Roch
Concert package for Roch
 
1 2018-12-16 roch_capabilities
Capabilities for Roch
Capabilities for Roch
 
1 2018-12-16 roch_bringup
SawYer roch installation and integration package
SawYer roch installation and integration package
 
1 2018-12-16 roch_base
Sawyer Roch robot driver
Sawyer Roch robot driver
 
1 2018-12-16 roch
roch Project
roch Project
 
1 2017-10-05 robotnik_sensors
Robotnik standard sensors description. URDF and meshses.
Robotnik standard sensors description. URDF and meshses.
 
1 2019-04-15 robotnik_msgs
The robotnik_msgs package. Common messages and services used by some Robotnik's packages.
The robotnik_msgs package. Common messages and services used by some Robotnik's packages.
 
1 2018-03-08 robotino_msgs
Message defintions for the Festo Robotion robot
Message defintions for the Festo Robotion robot
 
1 2018-03-08 robotino_description
The robotino_description package
The robotino_description package
 
1 2015-03-09 roboteq_msgs
Messages for Roboteq motor controller
Messages for Roboteq motor controller
 
1 2015-03-09 roboteq_driver
The roboteq_driver package
The roboteq_driver package
 
1 2015-03-09 roboteq_diagnostics
Republish basic Roboteq motor controller data to the standard ROS diagnostics topic.
Republish basic Roboteq motor controller data to the standard ROS diagnostics topic.
 
1 2014-11-03 robot_web_tools
Robot Web Tools Metapackage and Top Level Launch Files
Robot Web Tools Metapackage and Top Level Launch Files
 
1 2015-12-03 robot_upstart
The robot_upstart package provides scripts which may be used to install and uninstall Ubuntu Linux upstart jobs which launch groups of roslaunch files.
The robot_upstart package provides scripts which may be used to install and uninstall Ubuntu Linux upstart jobs which launch groups of roslaunch files.
 
1 2013-08-16 robot_setup_tf_tutorial
The robot_setup_tf_tutorial package
The robot_setup_tf_tutorial package
 
2 2016-02-18 robot_pose_publisher
A Simple Node to Publish the Robot's Position Relative to the Map using TFs
A Simple Node to Publish the Robot's Position Relative to the Map using TFs
 
1 2019-05-24 robot_navigation
The robot_navigation package
The robot_navigation package
 
1 2017-11-15 robot_model
 
2 2015-02-09 robot_mechanism_controllers
Generic Mechanism Controller Library
Generic Mechanism Controller Library
 
1 2018-06-01 robot_markers
Generates markers for a robot
Generates markers for a robot
 
1 2018-12-19 robot_localization
Provides nonlinear state estimation through sensor fusion of an abritrary number of sensors.
Provides nonlinear state estimation through sensor fusion of an abritrary number of sensors.
 
1 2016-01-13 robot_face
An application to display a talking head on your robot for human robot interaction.
An application to display a talking head on your robot for human robot interaction.
 
1 2018-07-30 robot_controllers_msgs
Messages for use with robot_controllers framework.
Messages for use with robot_controllers framework.
 
1 2018-07-30 robot_controllers_interface
Generic framework for robot controls.
Generic framework for robot controls.
 
1 2018-07-30 robot_controllers
Some basic robot controllers for use with robot_controllers_interface.
Some basic robot controllers for use with robot_controllers_interface.
 
1 2018-02-12 robot_calibration_msgs
Messages for calibrating a robot
Messages for calibrating a robot
 

Packages

Name Description
1 2016-10-14 imagezero
ImageZero is a fast lossless image compression algorithm for RGB color photos.
ImageZero is a fast lossless image compression algorithm for RGB color photos.
 
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-22 image_view2
A simple viewer for ROS image topics with draw-on features
A simple viewer for ROS image topics with draw-on features
 
1 2018-05-10 image_view
A simple viewer for ROS image topics. Includes a specialized viewer for stereo + disparity images.
A simple viewer for ROS image topics. Includes a specialized viewer for stereo + disparity images.
 
1 2016-10-03 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 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 2018-05-10 image_rotate
 
1 2018-05-10 image_publisher
 
1 2018-05-10 image_proc
Single image rectification and color processing.
Single image rectification and color processing.
 
1 2018-05-10 image_pipeline
image_pipeline fills the gap between getting raw images from a camera driver and higher-level vision processing.
image_pipeline fills the gap between getting raw images from a camera driver and higher-level vision processing.
 
2 2017-11-05 image_geometry
`image_geometry` contains C++ and Python libraries for interpreting images geometrically. It interfaces the calibration parameters in sensor_msgs/CameraInfo messages with OpenCV functions such as image rectification, much as cv_bridge interfaces ROS sensor_msgs/Image with OpenCV data types.
`image_geometry` contains C++ and Python libraries for interpreting images geometrically. It interfaces the calibration parameters in sensor_msgs/CameraInfo messages with OpenCV functions such as image rectification, much as cv_bridge interfaces ROS sensor_msgs/Image with OpenCV data types.
 
1 2018-03-27 image_exposure_msgs
Messages related to the Point Grey camera driver.
Messages related to the Point Grey camera driver.
 
1 2017-11-05 image_common
Common code for working with images in ROS.
Common code for working with images in ROS.
 
1 2016-09-25 image_cb_detector
Provide a node that extracts checkerboard corners from ROS images. This package is still experimental and unstable. Expect its APIs to change.
Provide a node that extracts checkerboard corners from ROS images. This package is still experimental and unstable. Expect its APIs to change.
 
1 2017-01-17 idolink_node
This package provides a driver to interface with the Idolink UWB RTLS. It allows reading the distance to the different anchors installed in the environment and publishing the information using the range_msgs::P2PRange message.
This package provides a driver to interface with the Idolink UWB RTLS. It allows reading the distance to the different anchors installed in the environment and publishing the information using the range_msgs::P2PRange message.
 
1 2018-05-22 iai_wsg_50_msgs
Fork of the driver packages for the Weiss Robotics WSG 50 gripper. Maintained by the Institute for Artificial Intelligence, University Bremen.
Fork of the driver packages for the Weiss Robotics WSG 50 gripper. Maintained by the Institute for Artificial Intelligence, University Bremen.
 
1 2018-05-22 iai_urdf_msgs
Service definitions for manipulating the robot description.
Service definitions for manipulating the robot description.
 
1 2018-05-22 iai_pepper_demo_msgs
Message definitions for the Pepper Demo.
Message definitions for the Pepper Demo.
 
1 2018-05-22 iai_kinematics_msgs
Ensemble of messages to communicate/request kinematics-related issues. NOTE/DISCLAIMER: A lot of these messages have been salvaged from now deprecated packages arm_navigation_msgs and kinematics_msgs. We acknowledge original authorship of these messages to all involved people (I, Georg, do not know them by name).
Ensemble of messages to communicate/request kinematics-related issues. NOTE/DISCLAIMER: A lot of these messages have been salvaged from now deprecated packages arm_navigation_msgs and kinematics_msgs. We acknowledge original authorship of these messages to all involved people (I, Georg, do not know them by name).
 
1 2018-05-22 iai_control_msgs
Message defintions to talk to the motion controllers developed in the IAI institute, University Bremen, Germany.
Message defintions to talk to the motion controllers developed in the IAI institute, University Bremen, Germany.
 
1 2018-05-22 iai_content_msgs
Message definitions for transporting multiple grasping-related datasets at the same time.
Message definitions for transporting multiple grasping-related datasets at the same time.
 
1 2018-05-22 iai_common_msgs
Message definitions created and used by the Institute for Artificial Intelligence research group at the University of Bremen
Message definitions created and used by the Institute for Artificial Intelligence research group at the University of Bremen
 
1 2014-01-16 humanoid_nav_msgs
Messages and services for humanoid robot navigation
Messages and services for humanoid robot navigation
 
1 2014-01-16 humanoid_msgs
Messages and services for humanoid robots
Messages and services for humanoid robots
 
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 2019-05-09 hrpsys
 
1 2016-07-19 household_objects_database_msgs
The household_objects_database_msgs package
The household_objects_database_msgs package
 
1 2014-06-01 hokuyo_node
A ROS node to provide access to SCIP 2.0-compliant Hokuyo laser range finders (including 04LX).
A ROS node to provide access to SCIP 2.0-compliant Hokuyo laser range finders (including 04LX).
 
1 2018-03-24 hokuyo3d
ROS driver node for HOKUYO 3D LIDARs
ROS driver node for HOKUYO 3D LIDARs
 
1 2016-06-24 hector_xacro_tools
hector_xacro_tools
hector_xacro_tools
 
1 2016-06-24 hector_worldmodel_msgs
hector_worldmodel_msgs is a message package to comes with the hector_worldmodel stack. The messages can be used to send percepts from images (hector_worldmodel_msgs/ImagePercept) or other sources (hector_worldmodel_msgs/PosePercept) to the hector_object_tracker node. The tracker publishes model updates as hector_worldmodel_msgs/Object messages and latches the whole model state as a hector_worldmodel_msgs/ObjectModel message.
hector_worldmodel_msgs is a message package to comes with the hector_worldmodel stack. The messages can be used to send percepts from images (hector_worldmodel_msgs/ImagePercept) or other sources (hector_worldmodel_msgs/PosePercept) to the hector_object_tracker node. The tracker publishes model updates as hector_worldmodel_msgs/Object messages and latches the whole model state as a hector_worldmodel_msgs/ObjectModel message.
 
1 2016-06-24 hector_worldmodel_geotiff_plugins
hector_worldmodel_geotiff_plugins contains a plugin to visualize worldmodel objects (e.g. victims in a Search and Rescue scenario) in a geotiff map generated by
hector_worldmodel_geotiff_plugins contains a plugin to visualize worldmodel objects (e.g. victims in a Search and Rescue scenario) in a geotiff map generated by
 
1 2016-06-24 hector_worldmodel
The hector_worldmodel stack helps to collect and fuse information about objects in the world. It is used by Team Hector Darmstadt to localize victims and QR codes in the Robocup Rescue scenario. See
The hector_worldmodel stack helps to collect and fuse information about objects in the world. It is used by Team Hector Darmstadt to localize victims and QR codes in the Robocup Rescue scenario. See
 
2 2016-07-08 hector_uav_msgs
hector_uav_msgs is a message package that contains messages for UAV controller inputs and outputs and some sensor readings not covered by sensor_msgs.
hector_uav_msgs is a message package that contains messages for UAV controller inputs and outputs and some sensor readings not covered by sensor_msgs.
 
1 2018-06-07 hector_trajectory_server
hector_trajectory_server keeps track of tf trajectories extracted from tf data and makes this data accessible via a service and topic.
hector_trajectory_server keeps track of tf trajectories extracted from tf data and makes this data accessible via a service and topic.
 
1 2018-06-07 hector_slam_launch
hector_slam_launch contains launch files for launching hector_slam with different robot systems/setups/postprocessing scenarios.
hector_slam_launch contains launch files for launching hector_slam with different robot systems/setups/postprocessing scenarios.
 
1 2018-06-07 hector_slam
The hector_slam metapackage that installs hector_mapping and related packages.
The hector_slam metapackage that installs hector_mapping and related packages.
 
1 2016-06-24 hector_sensors_gazebo
hector_sensors_gazebo depends on the necessary plugins for using the sensors from the hector_models repository.
hector_sensors_gazebo depends on the necessary plugins for using the sensors from the hector_models repository.
 
1 2016-06-24 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 2016-07-08 hector_quadrotor_teleop
hector_quadrotor_teleop enables quadrotor flying with a joystick by processing joy/Joy messages and translating them to geometry_msgs/Twist.
hector_quadrotor_teleop enables quadrotor flying with a joystick by processing joy/Joy messages and translating them to geometry_msgs/Twist.
 
1 2016-07-08 hector_quadrotor_pose_estimation
hector_quadrotor_pose_estimation provides a
hector_quadrotor_pose_estimation provides a
 
1 2016-07-08 hector_quadrotor_model
hector_quadrotor_model provides libraries that model several aspects of quadrotor dynamics.
hector_quadrotor_model provides libraries that model several aspects of quadrotor dynamics.
 
1 2016-07-08 hector_quadrotor_gazebo_plugins
hector_quadrotor_gazebo_plugins provides gazebo plugins for using quadrotors in gazebo. The hector_gazebo_ros_baro sensor plugin simulates an altimeter based on barometric pressure. hector_quadrotor_simple_controller is a simple controller allowing to command the quadrotor's velocity using a geometry_msgs/Twist message for teleoperation just by means of applying forces and torques to the model.
hector_quadrotor_gazebo_plugins provides gazebo plugins for using quadrotors in gazebo. The hector_gazebo_ros_baro sensor plugin simulates an altimeter based on barometric pressure. hector_quadrotor_simple_controller is a simple controller allowing to command the quadrotor's velocity using a geometry_msgs/Twist message for teleoperation just by means of applying forces and torques to the model.
 
1 2016-07-08 hector_quadrotor_gazebo
hector_quadrotor_gazebo provides a quadrotor model for the gazebo simulator. It can be commanded using geometry_msgs/Twist messages.
hector_quadrotor_gazebo provides a quadrotor model for the gazebo simulator. It can be commanded using geometry_msgs/Twist messages.
 
1 2016-07-08 hector_quadrotor_description
hector_quadrotor_description provides an URDF model of a quadrotor UAV.
hector_quadrotor_description provides an URDF model of a quadrotor UAV.
 
1 2016-07-08 hector_quadrotor_controller_gazebo
The hector_quadrotor_controller_gazebo package implements the ros_control RobotHWSim interface for the quadrotor controller in package hector_quadrotor_controller.
The hector_quadrotor_controller_gazebo package implements the ros_control RobotHWSim interface for the quadrotor controller in package hector_quadrotor_controller.
 
1 2016-07-08 hector_quadrotor_controller
hector_quadrotor_controller provides libraries and a node for quadrotor control using
hector_quadrotor_controller provides libraries and a node for quadrotor control using
 
1 2016-07-08 hector_quadrotor
hector_quadrotor contains packages related to modeling, control and simulation of quadrotor UAV systems
hector_quadrotor contains packages related to modeling, control and simulation of quadrotor UAV systems
 
1 2018-06-07 hector_pose_estimation_core
hector_pose_estimation_core is the core package of the hector_localization stack. It contains the Extended Kalman Filter (EKF) that estimates the 6DOF pose of the robot. hector_pose_estimation can be used either as a library, as a nodelet or as a standalone node.
hector_pose_estimation_core is the core package of the hector_localization stack. It contains the Extended Kalman Filter (EKF) that estimates the 6DOF pose of the robot. hector_pose_estimation can be used either as a library, as a nodelet or as a standalone node.
 

Packages

Name Description
1 2015-10-21 maggie_ir_controller_msgs
ir_controller messages and services
ir_controller messages and services
 
1 2015-10-21 maggie_eyelids_msgs
eyelids messages and services
eyelids messages and services
 
1 2015-11-25 maggie_drivers
maggie_drivers metapackage
maggie_drivers metapackage
 
1 2015-10-21 maggie_devices_msgs
maggie_devices_msgs metapackage
maggie_devices_msgs metapackage
 
1 2015-12-08 maggie_description
maggie_description urdf files
maggie_description urdf files
 
1 2015-12-08 maggie_bringup
maggie_bringup launchers
maggie_bringup launchers
 
1 2019-05-23 lpg_planner
lpg_planner: LPGL Planner (http://zeus.ing.unibs.it/lpg/)
lpg_planner: LPGL Planner (http://zeus.ing.unibs.it/lpg/)
 
1 2014-07-09 log4cpp
Log4cpp maintained by Orocos developers This version of log4cpp deviates from the official release by adding custom category factories. Orocos requires this for setting up real-time logging.
Log4cpp maintained by Orocos developers This version of log4cpp deviates from the official release by adding custom category factories. Orocos requires this for setting up real-time logging.
 
1 2015-02-06 lockfree
The lockfree package contains lock-free data structures for use in multithreaded programming. These kinds of data structures are generally not as easy to use as single-threaded equivalents, and are not always faster. If you don't know you need to use one, try another structure with a lock around it first.
The lockfree package contains lock-free data structures for use in multithreaded programming. These kinds of data structures are generally not as easy to use as single-threaded equivalents, and are not always faster. If you don't know you need to use one, try another structure with a lock around it first.
 
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 2015-04-23 lisp_unit
3rd party library: A unit testing framework for common lisp.
3rd party library: A unit testing framework for common lisp.
 
1 2019-02-26 linux_networking
The linux_networking package
The linux_networking package
 
1 2014-05-22 linux_hardware
Simple scripts which help utilise, monitor, interact with computer hardware abstracted by a linux OS.
Simple scripts which help utilise, monitor, interact with computer hardware abstracted by a linux OS.
 
1 2019-02-26 linksys_access_point
A ROS node that controls a Linksys access point with a Linksys WRT610n-compatible web interface.
A ROS node that controls a Linksys access point with a Linksys WRT610n-compatible web interface.
 
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 2014-07-19 libuvc
USB Video Class driver library
USB Video Class driver library
 
1 2019-05-23 libsiftfast
Library to compute SIFT features
Library to compute SIFT features
 
1 2013-12-10 libsegwayrmp
This is a C++ library for interfacing with Segway's RMP line of robotic platforms.
This is a C++ library for interfacing with Segway's RMP line of robotic platforms.
 
1 2015-01-26 librviz_tutorial
Tutorial showing how to compile your own C++ program with RViz displays and features.
Tutorial showing how to compile your own C++ program with RViz displays and features.
 
2 2016-02-18 librms
RMS Data Log Client Library
RMS Data Log Client Library
 
1 2016-02-26 libpointmatcher_ros
Bridge between libpointmatcher and ROS.
Bridge between libpointmatcher and ROS.
 
1 2019-05-09 libpointmatcher
libpointmatcher is a modular ICP library, useful for robotics and computer vision.
libpointmatcher is a modular ICP library, useful for robotics and computer vision.
 
1 2014-05-14 libphidgets
This package wraps the libphidgets to use it as a ros dependency
This package wraps the libphidgets to use it as a ros dependency
 
1 2014-05-14 libpcan
This package wraps the libpcan to use it as a ros dependency
This package wraps the libpcan to use it as a ros dependency
 
1 2014-05-14 libntcan
This package wraps the libntcan to use it as a ros dependency.
This package wraps the libntcan to use it as a ros dependency.
 
1 2019-02-07 libnabo
libnabo is a fast K Nearest Neighbour library for low-dimensional spaces.
libnabo is a fast K Nearest Neighbour library for low-dimensional spaces.
 
1 2015-03-04 libmavconn
MAVLink communication library. This library provide unified connection handling classes and URL to connection object mapper. This library can be used in standalone programs.
MAVLink communication library. This library provide unified connection handling classes and URL to connection object mapper. This library can be used in standalone programs.
 
1 2014-02-05 libfovis
Fast Odometry from VISion
Fast Odometry from VISion
 
1 2019-05-23 libcmt
libCMT ROS Wrapper
libCMT ROS Wrapper
 
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 2015-03-01 leg_detector
Leg Detector using a machine learning approach to find leg-like patterns of laser scanner readings.
Leg Detector using a machine learning approach to find leg-like patterns of laser scanner readings.
 
1 2013-08-16 laser_scan_publisher_tutorial
The laser_scan_publisher_tutorial package
The laser_scan_publisher_tutorial package
 
1 2013-12-13 laser_proc
laser_proc
laser_proc
 
1 2018-04-26 laser_pipeline
Meta-package of libraries for processing laser data, including converting laser data into 3D representations.
Meta-package of libraries for processing laser data, including converting laser data into 3D representations.
 
1 2014-06-08 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 2019-05-23 laser_filters_jsk_patch
laser_filters_jsk_patch
laser_filters_jsk_patch
 
1 2014-03-04 laser_filters
Assorted filters designed to operate on 2D planar laser scanners, which use the sensor_msgs/LaserScan type.
Assorted filters designed to operate on 2D planar laser scanners, which use the sensor_msgs/LaserScan type.
 
1 2016-07-23 laser_filtering
ROS Libraries for filtering specific kinds of laser scans
ROS Libraries for filtering specific kinds of laser scans
 
1 2016-09-25 laser_cb_detector
Extracts checkerboard corners from a dense laser snapshot. This package is experimental and unstable. Expect its APIs to change.
Extracts checkerboard corners from a dense laser snapshot. This package is experimental and unstable. Expect its APIs to change.
 
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 2016-11-12 korg_nanokontrol
ROS driver to use the Korg NanoKontrol MIDI device as a joystick.
ROS driver to use the Korg NanoKontrol MIDI device as a joystick.
 
1 2014-08-19 kobuki_testsuite
Kobuki test suite: this package provides tools to thoroughly test Kobuki's hardware.
Kobuki test suite: this package provides tools to thoroughly test Kobuki's hardware.
 
1 2013-07-11 kobuki_softnode
ROS nodelet for fake Kobuki.
ROS nodelet for fake Kobuki.
 
1 2013-07-11 kobuki_softapps
The kobuki_softapps package
The kobuki_softapps package
 
1 2013-07-11 kobuki_soft
Soft kobuki impementation meta package
Soft kobuki impementation meta package
 
1 2014-08-19 kobuki_safety_controller
A controller ensuring the safe operation of Kobuki. The SafetyController keeps track of bumper, cliff and wheel drop events. In case of the first two, Kobuki is commanded to move back. In the latter case, Kobuki is stopped. This controller can be enabled/disabled. The safety states (bumper pressed etc.) can be reset. WARNING: Dangerous!
A controller ensuring the safe operation of Kobuki. The SafetyController keeps track of bumper, cliff and wheel drop events. In case of the first two, Kobuki is commanded to move back. In the latter case, Kobuki is stopped. This controller can be enabled/disabled. The safety states (bumper pressed etc.) can be reset. WARNING: Dangerous!
 
1 2014-08-04 kobuki_rviz_launchers
The kobuki_rviz_launchers package
The kobuki_rviz_launchers package
 
1 2014-08-19 kobuki_random_walker
Random walker app for Kobuki
Random walker app for Kobuki
 
1 2014-08-04 kobuki_qtestsuite
An rqt plugin that provides a graphical, interactive testsuite for Kobuki.
An rqt plugin that provides a graphical, interactive testsuite for Kobuki.