Packages

Name Description
1 2017-01-12 yocs_virtual_sensor
Virtual sensor that uses semantic map information to "see" obstacles undetectable by robot sensors. Current implementation cannot read obstacles from YAML files. Until this feature gets implemented, we use auxiliary scripts to read and publish files' content. Data directory contains some example files.
Virtual sensor that uses semantic map information to "see" obstacles undetectable by robot sensors. Current implementation cannot read obstacles from YAML files. Until this feature gets implemented, we use auxiliary scripts to read and publish files' content. Data directory contains some example files.
 
1 2017-01-12 yocs_velocity_smoother
Bound incoming velocity messages according to robot velocity and acceleration limits.
Bound incoming velocity messages according to robot velocity and acceleration limits.
 
1 2017-01-12 yocs_safety_controller
A controller ensuring the safe operation of your robot. The SafetyController listens to ranger readings in order to stop (and move back), if obstacles get to close. This controller can be enabled/disabled.
A controller ensuring the safe operation of your robot. The SafetyController listens to ranger readings in order to stop (and move back), if obstacles get to close. This controller can be enabled/disabled.
 
1 2017-01-12 yocs_rapps
Yujin open control system rapps for use with the app manager and rocon concert
Yujin open control system rapps for use with the app manager and rocon concert
 
1 2017-01-12 yocs_navigator
Navigation module for robots
Navigation module for robots
 
1 2017-01-12 yocs_navi_toolkit
Ros navigation utilities.
Ros navigation utilities.
 
1 2017-01-12 yocs_math_toolkit
Math toolkit for Yujin open control system. This package is intended to contain common use functions, mostly for simple mathematics but also for tf-related conversions. By no means it pretends to be an efficient and robust, widely used math library, but a play ground where to put common code that is typically repeated in many robot control programs.
Math toolkit for Yujin open control system. This package is intended to contain common use functions, mostly for simple mathematics but also for tf-related conversions. By no means it pretends to be an efficient and robust, widely used math library, but a play ground where to put common code that is typically repeated in many robot control programs.
 
1 2017-01-12 yocs_keyop
Keyboard teleoperation for your robot
Keyboard teleoperation for your robot
 
1 2017-01-12 yocs_joyop
Joystick teleoperation for your robot robot core
Joystick teleoperation for your robot robot core
 
1 2017-01-12 yocs_diff_drive_pose_controller
A controller for driving a differential drive base to a pose goal or along a path specified by multiple poses. A pose consists of a 2D position (x,y) and a 1D orientation (theta).
A controller for driving a differential drive base to a pose goal or along a path specified by multiple poses. A pose consists of a 2D position (x,y) and a 1D orientation (theta).
 
1 2017-01-12 yocs_controllers
Library for various controller types and algorithms
Library for various controller types and algorithms
 
1 2017-01-12 yocs_cmd_vel_mux
A multiplexer for command velocity inputs. Arbitrates incoming cmd_vel messages from several topics, allowing one topic at a time to command the robot, based on priorities. It also deallocates current allowed topic if no messages are received after a configured timeout. All topics, together with their priority and timeout are configured through a YAML file, that can be reload at runtime.
A multiplexer for command velocity inputs. Arbitrates incoming cmd_vel messages from several topics, allowing one topic at a time to command the robot, based on priorities. It also deallocates current allowed topic if no messages are received after a configured timeout. All topics, together with their priority and timeout are configured through a YAML file, that can be reload at runtime.
 
1 yason
1 yaml_cpp_vendor
1 yaml_cpp_0_3
0 yaml_cpp
1 2017-03-22 xv_11_laser_driver
Neato XV-11 Laser Driver. This driver works with the laser when it is removed from the XV-11 Robot as opposed to reading scans from the Neato's USB port.
Neato XV-11 Laser Driver. This driver works with the laser when it is removed from the XV-11 Robot as opposed to reading scans from the Neato's USB port.
 
0 xsdcxx
1 2019-04-04 xpp_vis
Visualization for the XPP Motion Framework.
Visualization for the XPP Motion Framework.
 
1 2019-04-04 xpp_states
Common definitions (positions, velocities, angular angles, angular rates) and robot definitions in Cartesian and joint state used in the Xpp Motion Framework, as well as conversions to/from xpp_msgs.
Common definitions (positions, velocities, angular angles, angular rates) and robot definitions in Cartesian and joint state used in the Xpp Motion Framework, as well as conversions to/from xpp_msgs.
 
1 2019-04-04 xpp_quadrotor
The URDF file for a quadrotor to be used with the xpp packages and a simple rviz publisher of quadrotor tfs. Adapted from Daniel Mellinger, Nathan Michael, Vijay Kumar, "Trajectory Generation and Control for Precise Aggressive Maneuvers with Quadrotors".
The URDF file for a quadrotor to be used with the xpp packages and a simple rviz publisher of quadrotor tfs. Adapted from Daniel Mellinger, Nathan Michael, Vijay Kumar, "Trajectory Generation and Control for Precise Aggressive Maneuvers with Quadrotors".
 
1 2019-04-04 xpp_msgs
ROS messages used in the XPP framework.
ROS messages used in the XPP framework.
 
1 2019-04-04 xpp_hyq
HyQ-robot specific functions for visualization in the XPP Motion Framework. These include inverse kinematics as well as urdf files for a one-legged, two-legged and four legged robot with
HyQ-robot specific functions for visualization in the XPP Motion Framework. These include inverse kinematics as well as urdf files for a one-legged, two-legged and four legged robot with
 
1 2019-04-04 xpp_examples
Examples of how to use the xpp framework.
Examples of how to use the xpp framework.
 
1 2019-04-04 xpp
Visualization of motion-plans for legged robots. It draws support areas, contact forces and motion trajectories in RVIZ and displays URDFs for specific robots, including a one-legged, a two-legged hopper and
Visualization of motion-plans for legged robots. It draws support areas, contact forces and motion trajectories in RVIZ and displays URDFs for specific robots, including a one-legged, a two-legged hopper and
 
1 xl_terabot_description
1 ximea_camera
1 2018-06-13 xiaoqiang_navigation_example
xiaoqiang navigation stack examples
xiaoqiang navigation stack examples
 
1 2018-06-13 xiaoqiang_navigation
xiaoqiang navigaion related
xiaoqiang navigaion related
 
1 2018-06-13 xiaoqiang_freenect_launch
Launch files for xiaoqiang_freenect_camera to produce rectified, registered or disparity images. Also produce point clouds and registered point clouds. Based on the openni_launch package. Modified version of xiaoqiang_freenect_stack, add tilt angle control support
Launch files for xiaoqiang_freenect_camera to produce rectified, registered or disparity images. Also produce point clouds and registered point clouds. Based on the openni_launch package. Modified version of xiaoqiang_freenect_stack, add tilt angle control support
 
1 2018-06-13 xiaoqiang_freenect_camera
A libfreenect-based ROS driver for the Microsoft Kinect. This is a port of the OpenNI driver that uses libfreenect instead, because on some systems with some devices it works better. Modified version of xiaoqiang_freenect_stack, add tilt angle control support
A libfreenect-based ROS driver for the Microsoft Kinect. This is a port of the OpenNI driver that uses libfreenect instead, because on some systems with some devices it works better. Modified version of xiaoqiang_freenect_stack, add tilt angle control support
 
1 2018-06-13 xiaoqiang_freenect
A libfreenect-based ROS driver for the Microsoft Kinect Modified version of xiaoqiang_freenect_stack, add tilt angle control support
A libfreenect-based ROS driver for the Microsoft Kinect Modified version of xiaoqiang_freenect_stack, add tilt angle control support
 
1 2018-06-13 xiaoqiang_depth_image_proc
Modified version of depth image process, add occupancy xyz Contains nodelets for processing depth images such as those produced by OpenNI camera. Functions include creating disparity images and point clouds, as well as registering (reprojecting) a depth image into another camera frame.
Modified version of depth image process, add occupancy xyz Contains nodelets for processing depth images such as those produced by OpenNI camera. Functions include creating disparity images and point clouds, as well as registering (reprojecting) a depth image into another camera frame.
 
1 2018-06-13 xiaoqiang
Drivers, description, and utilities for xiaoqiang.
Drivers, description, and utilities for xiaoqiang.
 
1 xdot
1 2019-03-08 xacro
Xacro (XML Macros) Xacro is an XML macro language. With xacro, you can construct shorter and more readable XML files by using macros that expand to larger XML expressions.
Xacro (XML Macros) Xacro is an XML macro language. With xacro, you can construct shorter and more readable XML files by using macros that expand to larger XML expressions.
 
1 x_wam_moveit
0 wxWidgets
1 2016-07-23 wu_ros_tools
A collection of tools for making a variety of generic ROS-related tasks easier.
A collection of tools for making a variety of generic ROS-related tasks easier.
 
1 wts_driver
1 wsg_32_description
1 wpi_jaco_wrapper
1 wpi_jaco_msgs
1 wpi_jaco
1 worldlib
0 world_model
1 world_item_search
1 world_item_observer
2 world_canvas_utils
2 world_canvas_server

Packages

Name Description
1 waypoint_meta
1 waypoint_generator
1 warthog_viz
1 warthog_simulator
1 warthog_msgs
1 warthog_gazebo
1 warthog_desktop
1 warthog_description
1 warthog_control
2 wamv_gazebo
2 wamv_description
1 wam_description
0 walking_utils
0 walking_controller
1 vtec_tracker
1 vtec_ros
1 vtec_msgs
1 vs060_moveit_config
1 vs060_gazebo
1 vs060
1 vrx_gazebo
2 2017-11-29 vrpn_client_ros
ROS client nodes for the
ROS client nodes for the
 
0 vrpn
1 vrmagic_ros_bridge_server
1 vrep_ros_plugin
1 vrep_ros_bridge
0 vrep_common
2 2019-02-28 voxel_grid
voxel_grid provides an implementation of an efficient 3D voxel grid. The occupancy grid can support 3 different representations for the state of a cell: marked, free, or unknown. Due to the underlying implementation relying on bitwise and and or integer operations, the voxel grid only supports 16 different levels per voxel column. However, this limitation yields raytracing and cell marking performance in the grid comparable to standard 2D structures making it quite fast compared to most 3D structures.
voxel_grid provides an implementation of an efficient 3D voxel grid. The occupancy grid can support 3 different representations for the state of a cell: marked, free, or unknown. Due to the underlying implementation relying on bitwise and and or integer operations, the voxel grid only supports 16 different levels per voxel column. However, this limitation yields raytracing and cell marking performance in the grid comparable to standard 2D structures making it quite fast compared to most 3D structures.
 
1 voronoi_planner
1 vmrc_gazebo
1 2018-04-02 viz
A metapackage to aggregate several packages.
A metapackage to aggregate several packages.
 
1 visualstates
1 2019-01-29 visualization_tutorials
Metapackage referencing tutorials related to rviz and visualization.
Metapackage referencing tutorials related to rviz and visualization.
 
1 visualization_rwt
1 visualization_osg
2 2018-11-08 visualization_msgs
visualization_msgs is a set of messages used by higher level packages, such as
visualization_msgs is a set of messages used by higher level packages, such as
 
1 2019-01-29 visualization_marker_tutorials
The visulalization_marker_tutorials package
The visulalization_marker_tutorials package
 
1 visual_pose_estimation
1 visp_ros
0 visp
1 viso2_ros
1 viso2
1 2017-10-31 vision_visp
Virtual package providing ViSP related packages.
Virtual package providing ViSP related packages.
 
2 2018-04-16 vision_opencv
Packages for interfacing ROS with OpenCV, a library of programming functions for real time computer vision.
Packages for interfacing ROS with OpenCV, a library of programming functions for real time computer vision.
 
1 virtual_force_publisher
1 viodom
1 vigir_walk_monitor
0 vigir_terrain_classifier
1 vigir_step_control
1 vigir_pluginlib_msgs

Packages

Name Description
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 2017-12-13 mtig_driver
ROS driver for Xsens MTI-G-700 series motion trackers - modified to publish GPS messages
ROS driver for Xsens MTI-G-700 series motion trackers - modified to publish GPS messages
 
1 2019-04-29 msp
Implementation of the MultiWii Serial Protocol (MSP)
Implementation of the MultiWii Serial Protocol (MSP)
 
1 2019-04-11 mrpt_navigation
Tools related to the Mobile Robot Programming Toolkit (MRPT). Refer to http://wiki.ros.org/mrpt_navigation for further documentation.
Tools related to the Mobile Robot Programming Toolkit (MRPT). Refer to http://wiki.ros.org/mrpt_navigation for further documentation.
 
2 2018-06-09 mrpt_msgs
ROS messages for MRPT classes and objects
ROS messages for MRPT classes and objects
 
1 2019-04-13 mrpt_graphslam_2d
Implement graphSLAM using the mrpt-graphslam library, in an online fashion by directly reading measurements off ROS Topics.
Implement graphSLAM using the mrpt-graphslam library, in an online fashion by directly reading measurements off ROS Topics.
 
2 2019-04-01 mrpt_bridge
C++ library to convert between ROS messages and MRPT classes
C++ library to convert between ROS messages and MRPT classes
 
1 2019-05-03 mrpt1
Mobile Robot Programming Toolkit (MRPT) version 1.5.x
Mobile Robot Programming Toolkit (MRPT) version 1.5.x
 
1 2018-02-19 mqtt_bridge
The mqtt_bridge package
The mqtt_bridge package
 
1 2019-03-17 movie_publisher
Node for using a video file as video topic source.
Node for using a video file as video topic source.
 
2 2018-11-14 moveit_visual_tools
Helper functions for displaying and debugging MoveIt! data in Rviz via published markers
Helper functions for displaying and debugging MoveIt! data in Rviz via published markers
 
1 2019-02-22 moveit_tutorials
The moveit_tutorials package
The moveit_tutorials package
 
1 2016-10-31 moveit_simple_grasps
A basic grasp generator for simple objects such as blocks or cylinders for use with the MoveIt! pick and place pipeline. Does not consider friction cones or other dynamics.
A basic grasp generator for simple objects such as blocks or cylinders for use with the MoveIt! pick and place pipeline. Does not consider friction cones or other dynamics.
 
2 2017-01-04 moveit_sim_controller
A simulation interface for a hardware interface for ros_control, and loads default joint values from SRDF
A simulation interface for a hardware interface for ros_control, and loads default joint values from SRDF
 
2 2016-08-05 moveit_setup_assistant
Generates a configuration package that makes it easy to use MoveIt!
Generates a configuration package that makes it easy to use MoveIt!
 
2 2016-08-05 moveit_ros_control_interface
ros_control controller manager interface for MoveIt!
ros_control controller manager interface for MoveIt!
 
1 2019-04-03 moveit_resources
Resources used for MoveIt! testing
Resources used for MoveIt! testing
 
1 2018-08-13 moveit_python
A pure-python interaface to the MoveIt! ROS API.
A pure-python interaface to the MoveIt! ROS API.
 
1 2016-11-16 moveit_msgs
Messages, services and actions used by MoveIt
Messages, services and actions used by MoveIt
 
1 2016-08-05 moveit_ikfast
Generates a IKFast kinematics plugin for MoveIt using OpenRave generated cpp files.
Generates a IKFast kinematics plugin for MoveIt using OpenRave generated cpp files.
 
2 2016-08-05 moveit_fake_controller_manager
A fake controller manager plugin for MoveIt.
A fake controller manager plugin for MoveIt.
 
1 2019-05-16 moveit_experimental
Experimental packages for moveit.
Experimental packages for moveit.
 
2 2016-08-05 moveit_core
Core libraries used by MoveIt!
Core libraries used by MoveIt!
 
2 2016-08-05 moveit_commander
Python interfaces to MoveIt
Python interfaces to MoveIt
 
1 2019-02-22 move_basic
Simple navigation package
Simple navigation package
 
1 2017-09-19 move_base_to_manip
Move the robot base until a desired end-effector pose can be reached.
Move the robot base until a desired end-effector pose can be reached.
 
2 2018-04-06 mouse_teleop
A mouse teleop tool for holonomic mobile robots.
A mouse teleop tool for holonomic mobile robots.
 
1 2019-05-21 mongodb_store
A package to support MongoDB-based storage and analysis for data from a ROS system, eg. saved messages, configurations etc
A package to support MongoDB-based storage and analysis for data from a ROS system, eg. saved messages, configurations etc
 
1 2019-05-21 mongodb_log
The mongodb_log package
The mongodb_log package
 
1 2018-07-04 modelica_bridge
ROS package for bridging ROS with Modelica tools via TCP/IP sockets. Meant for use along with the ROS_Bridge Modelica package, made by the same developer.
ROS package for bridging ROS with Modelica tools via TCP/IP sockets. Meant for use along with the ROS_Bridge Modelica package, made by the same developer.
 
1 2016-10-23 mm_mux_demux
Multiplexing many packet types across a single connection. Great for embedded connections by serial or ethernet types.
Multiplexing many packet types across a single connection. Great for embedded connections by serial or ethernet types.
 
3 2019-05-13 ml_classifiers
ml_classifiers
ml_classifiers
 
1 2019-05-23 mini_maxwell
mini_maxwell
mini_maxwell
 
1 2018-09-12 micros_swarm_gazebo
micros_swarm_gazebo package.
micros_swarm_gazebo package.
 
1 2018-08-18 mh5_anomaly_detector
ROS Anomaly Detector for Motoman MH5 robot arm
ROS Anomaly Detector for Motoman MH5 robot arm
 
1 2019-02-25 melfa_description
The melfa_description package
The melfa_description package
 
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-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_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_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.
 

Packages

Name Description
1 2019-05-24 neonavigation_launch
Demonstration and sample launch files for neonavigation meta-package
Demonstration and sample launch files for neonavigation meta-package
 
1 2019-05-24 neonavigation_common
Common headers for neonavigation meta-package
Common headers for neonavigation meta-package
 
1 2018-06-03 ncd_parser
The ncd_parser package reads in .alog data files from the New College Dataset and broadcasts scan and odometry messages to ROS.
The ncd_parser package reads in .alog data files from the New College Dataset and broadcasts scan and odometry messages to ROS.
 
2 2017-01-22 navigation
A 2D navigation stack that takes in information from odometry, sensor streams, and a goal pose and outputs safe velocity commands that are sent to a mobile base.
A 2D navigation stack that takes in information from odometry, sensor streams, and a goal pose and outputs safe velocity commands that are sent to a mobile base.
 
1 2019-05-24 nav_grid_pub_sub
Publishers and Subscribers for nav_grid data.
Publishers and Subscribers for nav_grid data.
 
1 2019-05-24 nav_grid_iterators
Iterator implementations for moving around the cells of a nav_grid in a number of common patterns.
Iterator implementations for moving around the cells of a nav_grid in a number of common patterns.
 
1 2019-05-24 nav_grid
A templatized interface for overlaying a two dimensional grid on the world.
A templatized interface for overlaying a two dimensional grid on the world.
 
1 2019-05-24 nav_core_adapter
This package contains adapters for using `nav_core` plugins as `nav_core2` plugins and vice versa (more or less). See README.md for more information.
This package contains adapters for using `nav_core` plugins as `nav_core2` plugins and vice versa (more or less). See README.md for more information.
 
1 2019-05-24 nav_core2
Interfaces for Costmap, LocalPlanner and GlobalPlanner. Replaces nav_core.
Interfaces for Costmap, LocalPlanner and GlobalPlanner. Replaces nav_core.
 
2 2019-05-24 nav_2d_utils
A handful of useful utility functions for nav_core2 packages.
A handful of useful utility functions for nav_core2 packages.
 
2 2019-05-24 nav_2d_msgs
Basic message types for two dimensional navigation, extending from geometry_msgs::Pose2D.
Basic message types for two dimensional navigation, extending from geometry_msgs::Pose2D.
 
1 2019-01-31 nasa_common_logging
nasa_common_logging package
nasa_common_logging package
 
1 2018-06-04 nasa_common_cmake
The nasa_common_cmake package
The nasa_common_cmake package
 
1 2019-05-23 naoqieus
The naoqieus package
The naoqieus package
 
1 2018-11-15 naoqi_tools
Set of tools provided by Aldebaran to convert Aldebaran files (URDF, blender...)
Set of tools provided by Aldebaran to convert Aldebaran files (URDF, blender...)
 
1 2018-11-15 naoqi_sensors_py
ROS driver for miscellaneous sensors on NAO. Python bindings for camera, sonar and octomap C++: bindings for camera only (requires NAOqi to build)
ROS driver for miscellaneous sensors on NAO. Python bindings for camera, sonar and octomap C++: bindings for camera only (requires NAOqi to build)
 
1 2019-05-10 naoqi_driver
Driver module between Aldebaran's NAOqiOS and ROS. It publishes all sensor and actuator data as well as basic diagnostic for battery, temperature. It subscribes also to RVIZ simple goal and cmd_vel for teleop.
Driver module between Aldebaran's NAOqiOS and ROS. It publishes all sensor and actuator data as well as basic diagnostic for battery, temperature. It subscribes also to RVIZ simple goal and cmd_vel for teleop.
 
1 2017-11-16 naoqi_dcm_driver
Package containing the hardware interface to connect to Nao, Romeo, or Pepper robots.
Package containing the hardware interface to connect to Nao, Romeo, or Pepper robots.
 
2 2015-10-06 naoqi_dashboard
naoqi_dashboard is a GUI for monitoring the state of an ALdebaran robot. It is a port of pr2_dashboard and shows status information like battery status, joint temperatures, and joint stiffness, as well as integrating ROS tools like rqt_console and rqt_robot_monitor.
naoqi_dashboard is a GUI for monitoring the state of an ALdebaran robot. It is a port of pr2_dashboard and shows status information like battery status, joint temperatures, and joint stiffness, as well as integrating ROS tools like rqt_console and rqt_robot_monitor.
 
1 2019-05-23 naoeus
The naoeus package
The naoeus package
 
1 2017-01-20 nao_moveit_config
An automatically generated package with all the configuration and launch files for using the NAO robot with the MoveIt Motion Planning Framework
An automatically generated package with all the configuration and launch files for using the NAO robot with the MoveIt Motion Planning Framework
 
1 2017-01-20 nao_meshes
meshes for the Aldebaran Robotics NAO
meshes for the Aldebaran Robotics NAO
 
1 2018-05-03 nao_gazebo_plugin
The nao_gazebo_plugin package
The nao_gazebo_plugin package
 
1 2015-10-09 nanomsg
The nanomsg package
The nanomsg package
 
1 2015-01-07 myo_ros
The myo_ros package
The myo_ros package
 
1 2018-11-25 myahrs_driver
myahrs_driver is a driver package for the WITHROBOT's myAHRS+. The myAHRS+ is a low cost high performance AHRS(Attitude Heading Reference System) with USB/UART/I2C interface. The myAHRS+ board contains a 3-axis 16-bit gyroscope, a 3-axis 16-bit accelerometer and a 3-axis 13-bit magnetometer. The driver should also work with USB port.
myahrs_driver is a driver package for the WITHROBOT's myAHRS+. The myAHRS+ is a low cost high performance AHRS(Attitude Heading Reference System) with USB/UART/I2C interface. The myAHRS+ board contains a 3-axis 16-bit gyroscope, a 3-axis 16-bit accelerometer and a 3-axis 13-bit magnetometer. The driver should also work with USB port.
 
1 2019-04-11 mvsim
Node for the "multivehicle simulator" framework.
Node for the "multivehicle simulator" framework.
 
1 2017-08-25 muse_bldc_motor_drive
The muse_bldc_motor_drive package
The muse_bldc_motor_drive package
 
1 2019-04-03 multisense_cal_check
multisense_cal_check
multisense_cal_check
 
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 2017-12-27 mtig_driver
ROS driver for Xsens MTI-G-700 series motion trackers - modified to publish GPS messages
ROS driver for Xsens MTI-G-700 series motion trackers - modified to publish GPS messages
 
1 2019-04-29 msp
Implementation of the MultiWii Serial Protocol (MSP)
Implementation of the MultiWii Serial Protocol (MSP)
 
1 2019-04-11 mrpt_navigation
Tools related to the Mobile Robot Programming Toolkit (MRPT). Refer to http://wiki.ros.org/mrpt_navigation for further documentation.
Tools related to the Mobile Robot Programming Toolkit (MRPT). Refer to http://wiki.ros.org/mrpt_navigation for further documentation.
 
1 2019-04-13 mrpt_graphslam_2d
Implement graphSLAM using the mrpt-graphslam library, in an online fashion by directly reading measurements off ROS Topics.
Implement graphSLAM using the mrpt-graphslam library, in an online fashion by directly reading measurements off ROS Topics.
 
1 2019-03-17 movie_publisher
Node for using a video file as video topic source.
Node for using a video file as video topic source.
 
2 2016-02-09 moveit_visual_tools
Helper functions for displaying and debugging MoveIt! data in Rviz via published markers
Helper functions for displaying and debugging MoveIt! data in Rviz via published markers
 
1 2017-10-18 moveit_tutorials
The moveit_tutorials package
The moveit_tutorials package
 
1 2016-10-31 moveit_simple_grasps
A basic grasp generator for simple objects such as blocks or cylinders for use with the MoveIt! pick and place pipeline. Does not consider friction cones or other dynamics.
A basic grasp generator for simple objects such as blocks or cylinders for use with the MoveIt! pick and place pipeline. Does not consider friction cones or other dynamics.
 
2 2016-01-13 moveit_sim_controller
A simulation interface for a hardware interface for ros_control, and loads default joint values from SRDF
A simulation interface for a hardware interface for ros_control, and loads default joint values from SRDF
 
2 2016-08-05 moveit_setup_assistant
Generates a configuration package that makes it easy to use MoveIt!
Generates a configuration package that makes it easy to use MoveIt!
 
2 2016-08-05 moveit_ros_control_interface
ros_control controller manager interface for MoveIt!
ros_control controller manager interface for MoveIt!
 
1 2019-04-03 moveit_resources
Resources used for MoveIt! testing
Resources used for MoveIt! testing
 
1 2018-08-13 moveit_python
A pure-python interaface to the MoveIt! ROS API.
A pure-python interaface to the MoveIt! ROS API.
 
1 2019-02-28 moveit_object_handling
Package which helps generate the MoveIt! moveit_msgs/CollisionObject messages for existing objects in the scene, described by object_msgs/Object. Also provides helper classes for MoveIt! in relation to objects.
Package which helps generate the MoveIt! moveit_msgs/CollisionObject messages for existing objects in the scene, described by object_msgs/Object. Also provides helper classes for MoveIt! in relation to objects.
 
1 2016-11-15 moveit_msgs
Messages, services and actions used by MoveIt
Messages, services and actions used by MoveIt
 
1 2016-08-05 moveit_ikfast
Generates a IKFast kinematics plugin for MoveIt using OpenRave generated cpp files.
Generates a IKFast kinematics plugin for MoveIt using OpenRave generated cpp files.
 
1 2017-08-05 moveit_goal_builder
The moveit_goal_builder package
The moveit_goal_builder package
 
2 2016-08-05 moveit_fake_controller_manager
A fake controller manager plugin for MoveIt.
A fake controller manager plugin for MoveIt.
 
1 2018-12-11 moveit_experimental
Experimental packages for moveit.
Experimental packages for moveit.
 
2 2016-08-05 moveit_core
Core libraries used by MoveIt!
Core libraries used by MoveIt!
 

Packages

Name Description
1 yocs_safety_controller
1 yocs_rapps
1 yocs_navigator
1 yocs_navi_toolkit
1 yocs_msgs
1 yocs_math_toolkit
1 yocs_localization_manager
1 yocs_keyop
1 yocs_joyop
1 yocs_diff_drive_pose_controller
1 yocs_controllers
1 yocs_cmd_vel_mux
1 yocs_ar_pair_tracking
1 yocs_ar_pair_approach
1 yocs_ar_marker_tracking
1 2015-04-23 yason
3rd party library: YASON
3rd party library: YASON
 
1 yaml_cpp_vendor
1 yaml_cpp_0_3
0 yaml_cpp
1 xv_11_laser_driver
0 xsdcxx
1 xpp_vis
1 xpp_states
1 xpp_quadrotor
1 xpp_msgs
1 xpp_hyq
1 xpp_examples
1 xpp
1 xl_terabot_description
1 ximea_camera
1 xiaoqiang_server
1 xiaoqiang_navigation_example
1 xiaoqiang_navigation
1 xiaoqiang_msgs
1 xiaoqiang_monitor
1 xiaoqiang_freenect_launch
1 xiaoqiang_freenect_camera
1 xiaoqiang_freenect
1 xiaoqiang_driver
1 xiaoqiang_description
1 xiaoqiang_depth_image_proc
1 xiaoqiang_controller
1 xiaoqiang_bringup
1 xiaoqiang
1 xdot
1 2016-06-22 xacro
Xacro (XML Macros) Xacro is an XML macro language. With xacro, you can construct shorter and more readable XML files by using macros that expand to larger XML expressions.
Xacro (XML Macros) Xacro is an XML macro language. With xacro, you can construct shorter and more readable XML files by using macros that expand to larger XML expressions.
 
1 x_wam_moveit
0 wxWidgets
1 2015-07-11 wu_ros_tools
A collection of tools for making a variety of generic ROS-related tasks easier.
A collection of tools for making a variety of generic ROS-related tasks easier.
 
1 wsg_32_description

Packages

Name Description
2 2018-05-24 axis_camera
Python ROS drivers for accessing an Axis camera's MJPG stream. Also provides control for PTZ cameras.
Python ROS drivers for accessing an Axis camera's MJPG stream. Also provides control for PTZ cameras.
 
2 2015-01-06 async_web_server_cpp
Asynchronous Web/WebSocket Server in C++
Asynchronous Web/WebSocket Server in C++
 
1 2016-10-27 artoolkit
Artoolkit Library (wrapper)
Artoolkit Library (wrapper)
 
1 2016-05-30 argos3d_p100
The argos3D P100 ROS package
The argos3D P100 ROS package
 
1 2015-10-17 ardrone_autonomy
ardrone_autonomy is a ROS driver for Parrot AR-Drone 1.0 and 2.0 quadrocopters. This driver is based on official AR-Drone SDK version 2.0.1.
ardrone_autonomy is a ROS driver for Parrot AR-Drone 1.0 and 2.0 quadrocopters. This driver is based on official AR-Drone SDK version 2.0.1.
 
2 2015-01-23 ar_track_alvar
This package is a ROS wrapper for Alvar, an open source AR tag tracking library.
This package is a ROS wrapper for Alvar, an open source AR tag tracking library.
 
1 2016-10-27 ar_pose
Augmented Reality Marker Pose Estimation using ARToolkit
Augmented Reality Marker Pose Estimation using ARToolkit
 
1 2013-05-06 ar_kinect
This package extends the ar_pose package to handle point clouds + images generated from the kinect for improved AR marker localization.
This package extends the ar_pose package to handle point clouds + images generated from the kinect for improved AR marker localization.
 
1 2014-11-08 apriltags
A catkin version of the C++ apriltags library
A catkin version of the C++ apriltags library
 
1 2013-10-30 android_remocons
Remote controllers for rocon appable robots.
Remote controllers for rocon appable robots.
 
1 2014-03-19 android_core
Android support packages for rosjava.
Android support packages for rosjava.
 
1 2019-05-23 aeroeus
The aeroeus package
The aeroeus package
 
1 2016-01-19 ackermann_msgs
ROS messages for robots using Ackermann steering.
ROS messages for robots using Ackermann steering.
 
2 2015-03-16 acado
ACADO Toolkit
ACADO Toolkit
 
1 2013-09-30 zeroconf_avahi_suite
Suite of packages supporing the avahi implementation of zeroconf for ros.
Suite of packages supporing the avahi implementation of zeroconf for ros.
 
1 2013-09-30 zeroconf_avahi_demos
Several demos and launch-tests for the avahi based zero-configuration.
Several demos and launch-tests for the avahi based zero-configuration.
 
1 2013-09-30 zeroconf_avahi
Provides zeroconf services on avahi for ros systems. This is a c++ implementation.
Provides zeroconf services on avahi for ros systems. This is a c++ implementation.
 
1 yumi_support
1 yumi_moveit_config
1 yumi_launch
1 yumi_hw
1 yumi_description
1 yumi_control
1 2014-03-23 yujin_ocs
Yujin Robot's open-source control software
Yujin Robot's open-source control software
 
1 ypspur_ros
1 ypspur
1 2014-02-21 youbot_simulation
Packages to run the KUKA youBot in the Gazebo simulation with ROS
Packages to run the KUKA youBot in the Gazebo simulation with ROS
 
1 2014-02-21 youbot_gazebo_worlds
Gazebo worlds configurations
Gazebo worlds configurations
 
1 2014-02-21 youbot_gazebo_robot
Launch the KUKA youBot in the Gazebo simulation
Launch the KUKA youBot in the Gazebo simulation
 
1 2014-02-21 youbot_gazebo_control
Controller
Controller
 
1 yosemite_valley
1 yoctopuce_altimeter
1 2014-03-23 yocs_waypoints_navi
Simple tool for waypoints navigation with two functions:
Simple tool for waypoints navigation with two functions:
 
1 yocs_waypoint_provider
1 2014-03-23 yocs_virtual_sensor
Virtual sensor that uses semantic map information to "see" obstacles undetectable by robot sensors. Current implementation cannot read obstacles from YAML files. Until this feature gets implemented, we use auxiliary scripts to read and publish files' content. Data directory contains some example files.
Virtual sensor that uses semantic map information to "see" obstacles undetectable by robot sensors. Current implementation cannot read obstacles from YAML files. Until this feature gets implemented, we use auxiliary scripts to read and publish files' content. Data directory contains some example files.
 
1 2014-03-23 yocs_velocity_smoother
Bound incoming velocity messages according to robot velocity and acceleration limits.
Bound incoming velocity messages according to robot velocity and acceleration limits.
 
1 yocs_safety_controller
1 yocs_rapps
1 yocs_navigator
1 yocs_navi_toolkit
1 yocs_msgs
1 2014-03-23 yocs_math_toolkit
Math toolkit for Yujin open control system. This package is intended to contain common use functions, mostly for simple mathematics but also for tf-related conversions. By no means it pretends to be an efficient and robust, widely used math library, but a play ground where to put common code that is typically repeated in many robot control programs.
Math toolkit for Yujin open control system. This package is intended to contain common use functions, mostly for simple mathematics but also for tf-related conversions. By no means it pretends to be an efficient and robust, widely used math library, but a play ground where to put common code that is typically repeated in many robot control programs.
 
1 yocs_localization_manager
1 yocs_keyop
1 yocs_joyop
1 2014-03-23 yocs_diff_drive_pose_controller
A controller for driving a differential drive base to a pose goal or along a path specified by multiple poses. A pose consists of a 2D position (x,y) and a 1D orientation (theta).
A controller for driving a differential drive base to a pose goal or along a path specified by multiple poses. A pose consists of a 2D position (x,y) and a 1D orientation (theta).
 
1 2014-03-23 yocs_controllers
Library for various controller types and algorithms
Library for various controller types and algorithms
 
1 2014-03-23 yocs_cmd_vel_mux
A multiplexer for command velocity inputs. Arbitrates incoming cmd_vel messages from several topics, allowing one topic at a time to command the robot, based on priorities. It also deallocates current allowed topic if no messages are received after a configured timeout. All topics, together with their priority and timeout are configured through a YAML file, that can be reload at runtime.
A multiplexer for command velocity inputs. Arbitrates incoming cmd_vel messages from several topics, allowing one topic at a time to command the robot, based on priorities. It also deallocates current allowed topic if no messages are received after a configured timeout. All topics, together with their priority and timeout are configured through a YAML file, that can be reload at runtime.
 
1 yocs_ar_pair_tracking
1 yocs_ar_pair_approach