Packages

Name Description
1 2016-12-29 ethercat_grant
Makes it possible to run the ros_ethercat_loop without using sudo. Forked from pr2-grant
Makes it possible to run the ros_ethercat_loop without using sudo. Forked from pr2-grant
 
1 2016-12-25 rosjava
This is a meta package for the official rosjava repositories.
This is a meta package for the official rosjava repositories.
 
1 2016-12-24 rosjava_messages
Message generation for rosjava.
Message generation for rosjava.
 
1 2016-12-19 ros_wild
The ros_wild package
The ros_wild package
 
2 2016-12-19 nmea_comms
The nmea_comms package provides helper nodes for transmitting and receiving the NMEA sentences.
The nmea_comms package provides helper nodes for transmitting and receiving the NMEA sentences.
 
1 2016-12-14 rosjava_test_msgs
Test messages for rosjava.
Test messages for rosjava.
 
2 2016-12-06 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.
 
2 2016-12-06 rotate_recovery
This package provides a recovery behavior for the navigation stack that attempts to clear space by performing a 360 degree rotation of the robot.
This package provides a recovery behavior for the navigation stack that attempts to clear space by performing a 360 degree rotation of the robot.
 
3 2016-12-06 robot_pose_ekf
The Robot Pose EKF package is used to estimate the 3D pose of a robot, based on (partial) pose measurements coming from different sources. It uses an extended Kalman filter with a 6D model (3D position and 3D orientation) to combine measurements from wheel odometry, IMU sensor and visual odometry. The basic idea is to offer loosely coupled integration with different sensors, where sensor signals are received as ROS messages.
The Robot Pose EKF package is used to estimate the 3D pose of a robot, based on (partial) pose measurements coming from different sources. It uses an extended Kalman filter with a 6D model (3D position and 3D orientation) to combine measurements from wheel odometry, IMU sensor and visual odometry. The basic idea is to offer loosely coupled integration with different sensors, where sensor signals are received as ROS messages.
 
2 2016-12-06 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.
 
2 2016-12-06 navfn
navfn provides a fast interpolated navigation function that can be used to create plans for a mobile base. The planner assumes a circular robot and operates on a costmap to find a minimum cost plan from a start point to an end point in a grid. The navigation function is computed with Dijkstra's algorithm, but support for an A* heuristic may also be added in the near future. navfn also provides a ROS wrapper for the navfn planner that adheres to the nav_core::BaseGlobalPlanner interface specified in
navfn provides a fast interpolated navigation function that can be used to create plans for a mobile base. The planner assumes a circular robot and operates on a costmap to find a minimum cost plan from a start point to an end point in a grid. The navigation function is computed with Dijkstra's algorithm, but support for an A* heuristic may also be added in the near future. navfn also provides a ROS wrapper for the navfn planner that adheres to the nav_core::BaseGlobalPlanner interface specified in
 
2 2016-12-06 nav_core
This package provides common interfaces for navigation specific robot actions. Currently, this package provides the BaseGlobalPlanner, BaseLocalPlanner, and RecoveryBehavior interfaces, which can be used to build actions that can easily swap their planner, local controller, or recovery behavior for new versions adhering to the same interface.
This package provides common interfaces for navigation specific robot actions. Currently, this package provides the BaseGlobalPlanner, BaseLocalPlanner, and RecoveryBehavior interfaces, which can be used to build actions that can easily swap their planner, local controller, or recovery behavior for new versions adhering to the same interface.
 
2 2016-12-06 move_slow_and_clear
move_slow_and_clear
move_slow_and_clear
 
2 2016-12-06 move_base
The move_base package provides an implementation of an action (see the
The move_base package provides an implementation of an action (see the
 
2 2016-12-06 map_server
map_server provides the
map_server provides the
 
2 2016-12-06 global_planner
A path planner library and node.
A path planner library and node.
 
2 2016-12-06 fake_localization
A ROS node that simply forwards odometry information.
A ROS node that simply forwards odometry information.
 
2 2016-12-06 dwa_local_planner
This package provides an implementation of the Dynamic Window Approach to local robot navigation on a plane. Given a global plan to follow and a costmap, the local planner produces velocity commands to send to a mobile base. This package supports any robot who's footprint can be represented as a convex polygon or cicrle, and exposes its configuration as ROS parameters that can be set in a launch file. The parameters for this planner are also dynamically reconfigurable. This package's ROS wrapper adheres to the BaseLocalPlanner interface specified in the
This package provides an implementation of the Dynamic Window Approach to local robot navigation on a plane. Given a global plan to follow and a costmap, the local planner produces velocity commands to send to a mobile base. This package supports any robot who's footprint can be represented as a convex polygon or cicrle, and exposes its configuration as ROS parameters that can be set in a launch file. The parameters for this planner are also dynamically reconfigurable. This package's ROS wrapper adheres to the BaseLocalPlanner interface specified in the
 
2 2016-12-06 costmap_2d
This package provides an implementation of a 2D costmap that takes in sensor data from the world, builds a 2D or 3D occupancy grid of the data (depending on whether a voxel based implementation is used), and inflates costs in a 2D costmap based on the occupancy grid and a user specified inflation radius. This package also provides support for map_server based initialization of a costmap, rolling window based costmaps, and parameter based subscription to and configuration of sensor topics.
This package provides an implementation of a 2D costmap that takes in sensor data from the world, builds a 2D or 3D occupancy grid of the data (depending on whether a voxel based implementation is used), and inflates costs in a 2D costmap based on the occupancy grid and a user specified inflation radius. This package also provides support for map_server based initialization of a costmap, rolling window based costmaps, and parameter based subscription to and configuration of sensor topics.
 
2 2016-12-06 clear_costmap_recovery
This package provides a recovery behavior for the navigation stack that attempts to clear space by reverting the costmaps used by the navigation stack to the static map outside of a given area.
This package provides a recovery behavior for the navigation stack that attempts to clear space by reverting the costmaps used by the navigation stack to the static map outside of a given area.
 
2 2016-12-06 carrot_planner
This planner attempts to find a legal place to put a carrot for the robot to follow. It does this by moving back along the vector between the robot and the goal point.
This planner attempts to find a legal place to put a carrot for the robot to follow. It does this by moving back along the vector between the robot and the goal point.
 
2 2016-12-06 base_local_planner
This package provides implementations of the Trajectory Rollout and Dynamic Window approaches to local robot navigation on a plane. Given a plan to follow and a costmap, the controller produces velocity commands to send to a mobile base. This package supports both holonomic and non-holonomic robots, any robot footprint that can be represented as a convex polygon or circle, and exposes its configuration as ROS parameters that can be set in a launch file. This package's ROS wrapper adheres to the BaseLocalPlanner interface specified in the
This package provides implementations of the Trajectory Rollout and Dynamic Window approaches to local robot navigation on a plane. Given a plan to follow and a costmap, the controller produces velocity commands to send to a mobile base. This package supports both holonomic and non-holonomic robots, any robot footprint that can be represented as a convex polygon or circle, and exposes its configuration as ROS parameters that can be set in a launch file. This package's ROS wrapper adheres to the BaseLocalPlanner interface specified in the
 
1 2016-12-06 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 2016-12-06 amcl
 
1 2016-11-28 jaguar_navigation
Navigation package for DrRobot's Jaguar 4X4
Navigation package for DrRobot's Jaguar 4X4
 
1 2016-11-28 jaguar_msgs
Messages for DrRobot's Jaguar 4X4
Messages for DrRobot's Jaguar 4X4
 
1 2016-11-28 jaguar_description
A robot description package for Dr Robot's Jaguar 4x4
A robot description package for Dr Robot's Jaguar 4x4
 
1 2016-11-28 jaguar_control
DrRobot's Jaguar 4X4 controller configurations
DrRobot's Jaguar 4X4 controller configurations
 
1 2016-11-24 rqt_arni_gui_overview
The ARNI rqt_gui overview plugin.
The ARNI rqt_gui overview plugin.
 
1 2016-11-24 rqt_arni_gui_detail
The ARNI rqt_gui detail plugin.
The ARNI rqt_gui detail plugin.
 
1 2016-11-24 fzi_icl_comm
The fzi_icl_comm package
The fzi_icl_comm package
 
1 2016-11-24 arni_processing
The ARNI processing node, which rates statistics against their specifications.
The ARNI processing node, which rates statistics against their specifications.
 
1 2016-11-24 arni_nodeinterface
The ARNI host manager, which collects host/node statistics and enables the ARNI countermeasure node to run remote commands.
The ARNI host manager, which collects host/node statistics and enables the ARNI countermeasure node to run remote commands.
 
1 2016-11-24 arni_msgs
ARNI message types, i.e. host, node and rated statistics.
ARNI message types, i.e. host, node and rated statistics.
 
1 2016-11-24 arni_gui
Common functionality for the ARNI rqt_gui overview and detail plugins.
Common functionality for the ARNI rqt_gui overview and detail plugins.
 
1 2016-11-24 arni_countermeasure
The ARNI countermeasure node.
The ARNI countermeasure node.
 
1 2016-11-24 arni_core
This package contains common ARNI functionality. Furthermore, generic launch files and integration tests.
This package contains common ARNI functionality. Furthermore, generic launch files and integration tests.
 
1 2016-11-22 simple_voice
The simple_voice package
The simple_voice package
 
1 2016-11-16 moveit_msgs
Messages, services and actions used by MoveIt
Messages, services and actions used by MoveIt
 
1 2016-11-13 tuw_uvc
The tuw_uvc package is a USB-Camera driver with a dynamic reconfigure interface optimized for logitech cameras.
The tuw_uvc package is a USB-Camera driver with a dynamic reconfigure interface optimized for logitech cameras.
 
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 2016-11-09 tuw_marker_slam
The tuw_marker_slam package provides a framework for feature based SLAM implementations in ROS. Meanwhile a variant of EKF-SLAM is implemented.
The tuw_marker_slam package provides a framework for feature based SLAM implementations in ROS. Meanwhile a variant of EKF-SLAM is implemented.
 
1 2016-11-09 tuw_marker_server
The tuw_marker_server package contains a map server for saving and providing marker maps based on MarkerWithCovarianceArray messages from the marker_msgs package.
The tuw_marker_server package contains a map server for saving and providing marker maps based on MarkerWithCovarianceArray messages from the marker_msgs package.
 
1 2016-11-09 tuw_marker_noise
The tuw_marker_noise package provides nodes for adding artificial noise to MarkerDetection messages from the marker_msgs package and for recording MarkerDetection messages in order to obtain a measurement noise model.
The tuw_marker_noise package provides nodes for adding artificial noise to MarkerDetection messages from the marker_msgs package and for recording MarkerDetection messages in order to obtain a measurement noise model.
 
1 2016-11-09 tuw_marker_filter
The tuw_marker_filter package
The tuw_marker_filter package
 
1 2016-11-08 ecl_navigation
This stack aims to bring the common tools and algorithms needed to develop navigation algorithms, in particular slam. It does not focus on the end-point solution, rather the tools needed to create a variety of end-point solutions.
This stack aims to bring the common tools and algorithms needed to develop navigation algorithms, in particular slam. It does not focus on the end-point solution, rather the tools needed to create a variety of end-point solutions.
 
2 2016-11-08 ecl_mobile_robot
Contains transforms (e.g. differential drive inverse kinematics) for the various types of mobile robot platforms.
Contains transforms (e.g. differential drive inverse kinematics) for the various types of mobile robot platforms.
 
1 2016-11-06 marker_rviz_plugin
The marker_rviz_plugin package contains RViz plugins to visualize messages of the marker_msgs package using RViz.
The marker_rviz_plugin package contains RViz plugins to visualize messages of the marker_msgs package using RViz.
 
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.
 
1 2016-10-27 pcl_msgs
Package containing PCL (Point Cloud Library)-related ROS messages.
Package containing PCL (Point Cloud Library)-related ROS messages.
 

Packages

Name Description
1 2015-12-10 rocon_python_redis
Locally patched version of the python redis client (https://github.com/andymccurdy/redis-py).
Locally patched version of the python redis client (https://github.com/andymccurdy/redis-py).
 
1 2015-12-10 rocon_python_comms
Service pair libraries for pub/sub non-blocking services.
Service pair libraries for pub/sub non-blocking services.
 
1 2015-12-10 rocon_master_info
Publish master information - name, description, icon.
Publish master information - name, description, icon.
 
1 2015-12-10 rocon_launch
A multi-roslaunch (for single and multi-master systems).
A multi-roslaunch (for single and multi-master systems).
 
1 2015-12-10 rocon_interactions
Interaction management for human interactive agents in the concert.
Interaction management for human interactive agents in the concert.
 
1 2015-12-10 rocon_icons
Icons for rocon.
Icons for rocon.
 
1 2015-12-10 rocon_ebnf
Internal packaging of the 0.91 version of the simple python
Internal packaging of the 0.91 version of the simple python
 
1 2015-12-10 rocon_console
Command line python console utilities (mostly for colourisation).
Command line python console utilities (mostly for colourisation).
 
1 2015-12-10 rocon_bubble_icons
Bubble icon library for rocon.
Bubble icon library for rocon.
 
1 2015-12-10 iav_depthimage_to_laserscan
depthimage_to_laserscan
depthimage_to_laserscan
 
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 2015-12-10 cartesian_msgs
Stream cartesian commands
Stream cartesian commands
 
1 2015-12-08 or_nodes
or_nodes
or_nodes
 
1 2015-12-08 or_msgs
or_msgs
or_msgs
 
1 2015-12-08 or_libs
or_libs
or_libs
 
1 2015-12-05 robbie_architecture
robbie_architecture
robbie_architecture
 
1 2015-12-04 spur_gazebo
3D simulation package for SPUR omni-directional mobile manipulator robot made at Tamagawa University.
3D simulation package for SPUR omni-directional mobile manipulator robot made at Tamagawa University.
 
1 2015-12-04 spur_description
A package for storing 3D model of SPUR omni-directional mobile manipulator robot made at Tamagawa University.
A package for storing 3D model of SPUR omni-directional mobile manipulator robot made at Tamagawa University.
 
1 2015-12-04 spur_controller
A package for mobile base control for SPUR omni-directional mobile manipulator robot made at Tamagawa University.
A package for mobile base control for SPUR omni-directional mobile manipulator robot made at Tamagawa University.
 
1 2015-12-04 spur_bringup
This package provides starting scripts for Spur robot
This package provides starting scripts for Spur robot
 
1 2015-12-04 spur_2dnav
The spur_2dnav package holds common configuration options for running SPUR in 2D environment.
The spur_2dnav package holds common configuration options for running SPUR in 2D environment.
 
1 2015-12-04 spur
Meta package for SPUR omni-directional mobile manipulator robot made at Tamagawa University.
Meta package for SPUR omni-directional mobile manipulator robot made at Tamagawa University.
 
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 2015-11-30 ohm_tsd_slam
The ohm_tsd_slam package provides a 2D SLAM approach for laser scanners.
The ohm_tsd_slam package provides a 2D SLAM approach for laser scanners.
 
1 2015-11-30 certifi
(Python Distribution) A carefully curated collection of Root Certificates for validating the trustworthiness of SSL certificates while verifying the identity of TLS hosts. http://certifi.io
(Python Distribution) A carefully curated collection of Root Certificates for validating the trustworthiness of SSL certificates while verifying the identity of TLS hosts. http://certifi.io
 
1 2015-11-28 skeleton_markers
Skeleton Markers: Publish a list of joint markers for viewing in RViz.
Skeleton Markers: Publish a list of joint markers for viewing in RViz.
 
1 2015-11-28 pi_tracker
Skeleton Tracker Teleop Package for the Pi Robot Project
Skeleton Tracker Teleop Package for the Pi Robot Project
 
1 2015-11-27 numatac_can_driver
The numatac_can_driver package
The numatac_can_driver package
 
1 2015-11-22 rangeonly_msgs
The rangeonly_msgs package constains generic ROS messages for range-only sensors.
The rangeonly_msgs package constains generic ROS messages for range-only sensors.
 
1 2015-11-22 nanotron_swarm
Driver for Nanotron radio ranging sensors which uses the Swarm API firmware. This driver will publish range measurements between the host node and other nodes available in the wireless sensor network.
Driver for Nanotron radio ranging sensors which uses the Swarm API firmware. This driver will publish range measurements between the host node and other nodes available in the wireless sensor network.
 
1 2015-11-16 screenrun
screenrun is a small tool that pushes commands into a screen window. Use \015 after a command for ENTER, i.e. executing it.
screenrun is a small tool that pushes commands into a screen window. Use \015 after a command for ENTER, i.e. executing it.
 
1 2015-11-14 rosR
The rosR package
The rosR package
 
1 2015-11-12 nlj_dummy
The nlj_dummy package
The nlj_dummy package
 
1 2015-11-12 nj_escape_crossing
The nj_escape_crossing package is a navigating jockey used to move a robot from away from a crossing
The nj_escape_crossing package is a navigating jockey used to move a robot from away from a crossing
 
1 2015-11-12 map_ray_caster
The map_ray_caster package provides a class for cached ray casting on maps. The origin of all rays is fixed relative to the map, it is the map center.
The map_ray_caster package provides a class for cached ray casting on maps. The origin of all rays is fixed relative to the map, it is the map center.
 
1 2015-11-12 local_map
The local_map package The local_map package takes as input a LaserScan message and outputs a local map as OccupancyGrid. The local map orientation is the same as the one of the global frame.
The local_map package The local_map package takes as input a LaserScan message and outputs a local map as OccupancyGrid. The local map orientation is the same as the one of the global frame.
 
1 2015-11-12 lama_common
Utilities for the LaMa package
Utilities for the LaMa package
 
1 2015-11-12 goto_crossing
The goto_crossing package provides a goToGoal behavior to a crossing center if the crossing has at least three frontiers and some kind of move forward behavior if it has two or less frontiers.
The goto_crossing package provides a goToGoal behavior to a crossing center if the crossing has at least three frontiers and some kind of move forward behavior if it has two or less frontiers.
 
1 2015-11-12 dfs_explorer
An explorer with depth-first search for finite worlds for the Large Maps Framework (LaMa).
An explorer with depth-first search for finite worlds for the Large Maps Framework (LaMa).
 
1 2015-11-12 crossing_detector
The crossing_detector package recognize frontiers from a LaserScan
The crossing_detector package recognize frontiers from a LaserScan
 
1 2015-11-11 cit_adis_imu
cit_adis_imu for ADIS IMUs with the interface board made by Chiba Institute of Technology.
cit_adis_imu for ADIS IMUs with the interface board made by Chiba Institute of Technology.
 
1 2015-11-10 micros_dynamic_objects_filter
The dynamic_objects_filter package
The dynamic_objects_filter package
 
1 2015-11-06 grizzly_teleop
Nodes to republish joystick messages as a cmd_vel topic suitable for use with real or simulated Grizzly.
Nodes to republish joystick messages as a cmd_vel topic suitable for use with real or simulated Grizzly.
 
1 2015-11-06 grizzly_navigation
The grizzly_navigation package
The grizzly_navigation package
 
1 2015-11-06 grizzly_msgs
Common messages for Grizzly.
Common messages for Grizzly.
 
1 2015-11-06 grizzly_motion
Low-level motion control nodes for Grizzly which are common to simulated and non-simulated Grizzly.
Low-level motion control nodes for Grizzly which are common to simulated and non-simulated Grizzly.
 
1 2015-11-06 grizzly_description
grizzly_description package to hold urdf and related model files
grizzly_description package to hold urdf and related model files
 
1 2015-11-06 genty
Genty, pronounced "gen-tee", stands for "generate tests". It promotes generative testing, where a single test can execute over a variety of input.
Genty, pronounced "gen-tee", stands for "generate tests". It promotes generative testing, where a single test can execute over a variety of input.
 
1 2015-11-04 riskrrt
riskrrt is a risk-based rapidly exploring random tree algorithm for human aware navigation
riskrrt is a risk-based rapidly exploring random tree algorithm for human aware navigation
 
1 2015-11-04 new_riskrrt
The riskrrt metapackage
The riskrrt metapackage