Packages
Packages
Packages
| Name | Description | ||||
|---|---|---|---|---|---|
| 1 | 2016-05-10 | rocon_console |
Command line python console utilities (mostly for colourisation).
Command line python console utilities (mostly for colourisation).
|
||
| 1 | 2016-05-10 | rocon_bubble_icons |
Bubble icon library for rocon.
Bubble icon library for rocon.
|
||
| 1 | 2016-05-05 | rocon_app_manager_msgs |
Messages used by the platform app manager.
Messages used by the platform app manager.
|
||
| 1 | 2019-02-07 | robotis_manipulator |
This package contains the manipulation API and functions for controlling the manipulator.
This package contains the manipulation API and functions for controlling the manipulator.
|
||
| 1 | 2018-05-23 | 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.
|
||
| 2 | 2019-02-08 | robot_state_publisher |
This package allows you to publish the state of a robot to
This package allows you to publish the state of a robot to
|
||
| 2 | 2018-11-23 | robot_self_filter |
Filters the robot's body out of point clouds.
Filters the robot's body out of point clouds.
|
||
| 3 | 2019-04-03 | 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.
|
||
| 1 | 2019-02-12 | robot_navigation |
The robot_navigation package
The robot_navigation package
|
||
| 2 | 2018-09-20 | robot_mechanism_controllers |
Generic Mechanism Controller Library
Generic Mechanism Controller Library
|
||
| 1 | 2019-04-26 | 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 | 2018-07-11 | robot_controllers_msgs |
Messages for use with robot_controllers framework.
Messages for use with robot_controllers framework.
|
||
| 1 | 2018-07-11 | robot_controllers_interface |
Generic framework for robot controls.
Generic framework for robot controls.
|
||
| 1 | 2018-07-11 | 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-08-06 | 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 | 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 | 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-05-22 | 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 | 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.
|
||
| 1 | 2019-05-08 | rc_dynamics_api |
The rc_dynamics_api provides an API for easy handling of the dynamic-state data
streams provided by Roboception's stereo camera with self-localization.
See http://rc-visard.com
Dynamic-state estimates of the rc_visard relate to its self-localization and
ego-motion estimation. These states refer to rc_visard's current pose,
velocity, or acceleration and are published on demand via several data streams.
For a complete list and descriptions of these dynamics states and the
respective data streams please refer to rc_visard's user manual.
The rc_dynamics_api provides an API for easy handling of the dynamic-state data
streams provided by Roboception's stereo camera with self-localization.
See http://rc-visard.com
Dynamic-state estimates of the rc_visard relate to its self-localization and
ego-motion estimation. These states refer to rc_visard's current pose,
velocity, or acceleration and are published on demand via several data streams.
For a complete list and descriptions of these dynamics states and the
respective data streams please refer to rc_visard's user manual.
|
||
| 1 | 2019-04-26 | rc_common_msgs |
Common msg and srv definitions used by Roboception's ROS packages
Common msg and srv definitions used by Roboception's ROS packages
|
||
| 1 | 2018-07-04 | rc_cloud_accumulator |
A viewer for the SLAM component of roboception based on ROS and PCL
A viewer for the SLAM component of roboception based on ROS and PCL
|
||
| 1 | 2019-05-20 | raw_description |
This package contains the description (mechanical, kinematic, visual,
etc.) of the Care-O-bot robot. The files in this package are parsed and used by
a variety of other components. Most users will not interact directly
with this package.
This package contains the description (mechanical, kinematic, visual,
etc.) of the Care-O-bot robot. The files in this package are parsed and used by
a variety of other components. Most users will not interact directly
with this package.
|
||
| 1 | 2018-08-31 | range_sensor_layer |
Navigation Layer for Range sensors like sonar and IR
Navigation Layer for Range sensors like sonar and IR
|
||
| 1 | 2019-03-28 | random_numbers |
This library contains wrappers for generating floating point values, integers, quaternions using boost libraries.
The constructor of the wrapper is guaranteed to be thread safe and initialize its random number generator to a random seed.
Seeds are obtained using a separate and different random number generator.
This library contains wrappers for generating floating point values, integers, quaternions using boost libraries.
The constructor of the wrapper is guaranteed to be thread safe and initialize its random number generator to a random seed.
Seeds are obtained using a separate and different random number generator.
|
||
| 2 | 2019-04-18 | rail_manipulation_msgs |
Common Manipulation Messages and Services Used in RAIL Manipulation Packages
Common Manipulation Messages and Services Used in RAIL Manipulation Packages
|
||
| 1 | 2018-09-10 | radar_omnipresense |
This is the radar driver package developed for the omnipresense radar module.
This is the radar driver package developed for the omnipresense radar module.
|
Packages
| Name | Description | ||||
|---|---|---|---|---|---|
| 1 | 2018-09-21 | pr2_common_actions |
Various actions which help in moving the arms of the PR2
or getting data from its tilting laser.
Various actions which help in moving the arms of the PR2
or getting data from its tilting laser.
|
||
| 1 | 2018-09-21 | pr2_common_action_msgs |
The pr2_common_action_msgs package
The pr2_common_action_msgs package
|
||
| 2 | 2018-06-07 | pr2_common |
URDF description of the robot kinematics and dynamics, 3D models of robot components, information required for gazebo to simulate the PR2, and messages specific to the PR2 such as detailed information about its power board and fingertip pressure sensors.
URDF description of the robot kinematics and dynamics, 3D models of robot components, information required for gazebo to simulate the PR2, and messages specific to the PR2 such as detailed information about its power board and fingertip pressure sensors.
|
||
| 2 | 2018-09-20 | pr2_calibration_controllers |
The pr2_calibration_controllers package contains the controllers
used to bring all the joints in the PR2 to a calibrated state.
The pr2_calibration_controllers package contains the controllers
used to bring all the joints in the PR2 to a calibrated state.
|
||
| 1 | 2018-09-21 | pr2_arm_move_ik |
Move the pr2 arm using inverse kinematics
Move the pr2 arm using inverse kinematics
|
||
| 1 | 2018-08-29 | pr2_arm_kinematics |
This package provides a kinematics implementation for the PR2 robot. It can be used to compute forward and inverse kinematics.
This package provides a kinematics implementation for the PR2 robot. It can be used to compute forward and inverse kinematics.
|
||
| 1 | 2018-09-26 | pr2_apps |
Basic applications for the PR2 robot
Basic applications for the PR2 robot
|
||
| 1 | 2018-09-26 | pr2_app_manager |
Scripts and tools for running the application manager on the PR2.
Scripts and tools for running the application manager on the PR2.
|
||
| 2 | 2018-12-16 | power_monitor |
The power_monitor collects messages from the ocean_battery_server and
the pr2_power_board, and publishes a summary of their data in a
friendlier message format.
The power_monitor collects messages from the ocean_battery_server and
the pr2_power_board, and publishes a summary of their data in a
friendlier message format.
|
||
| 1 | 2019-04-08 | position_controllers |
position_controllers
position_controllers
|
||
| 1 | 2018-08-08 | posedetection_msgs |
posedetection_msgs provides messages and services to facilitate passing pose detection results and features.
posedetection_msgs provides messages and services to facilitate passing pose detection results and features.
|
||
| 1 | 2019-03-26 | pose_follower |
A implementation of a local planner that attempts to follow a plan as closely as possible.
A implementation of a local planner that attempts to follow a plan as closely as possible.
|
||
| 1 | 2019-03-26 | pose_base_controller |
A node that provides the move_base action server interface, but instead of
planning simply drives towards the target pose using a control-based
approach.
A node that provides the move_base action server interface, but instead of
planning simply drives towards the target pose using a control-based
approach.
|
||
| 1 | 2017-11-05 | polled_camera |
polled_camera contains a service and C++ helper classes for implementing a polled
camera driver node and requesting images from it. The package is currently for
internal use as the API is still under development.
polled_camera contains a service and C++ helper classes for implementing a polled
camera driver node and requesting images from it. The package is currently for
internal use as the API is still under development.
|
||
| 1 | 2018-03-27 | pointgrey_camera_driver |
Point Grey camera driver based on libflycapture2.
Point Grey camera driver based on libflycapture2.
|
||
| 1 | 2018-03-27 | pointgrey_camera_description |
URDF descriptions for Point Grey cameras
URDF descriptions for Point Grey cameras
|
||
| 2 | 2017-04-26 | pointcloud_to_laserscan |
Converts a 3D Point Cloud into a 2D laser scan. This is useful for making devices like the Kinect appear like a laser scanner for 2D-based algorithms (e.g. laser-based SLAM).
Converts a 3D Point Cloud into a 2D laser scan. This is useful for making devices like the Kinect appear like a laser scanner for 2D-based algorithms (e.g. laser-based SLAM).
|
||
| 1 | 2018-03-30 | pluginlib_tutorials |
The pluginlib_tutorials package
The pluginlib_tutorials package
|
||
| 1 | 2018-10-19 | pluginlib |
The pluginlib package provides tools for writing and dynamically loading plugins using the ROS build infrastructure.
To work, these tools require plugin providers to register their plugins in the package.xml of their package.
The pluginlib package provides tools for writing and dynamically loading plugins using the ROS build infrastructure.
To work, these tools require plugin providers to register their plugins in the package.xml of their package.
|
||
| 1 | 2019-05-19 | plotjuggler |
PlotJuggler: juggle with data
PlotJuggler: juggle with data
|
||
| 1 | 2019-05-23 | planner_cspace_msgs |
Message definitions for planner_cspace package
Message definitions for planner_cspace package
|
||
| 1 | 2019-05-24 | planner_cspace |
3-dof configuration space planner for mobile robot
3-dof configuration space planner for mobile robot
|
||
| 1 | 2019-04-14 | pid |
Launch a PID control node.
Launch a PID control node.
|
||
| 2 | 2019-05-06 | phidgets_imu |
Driver for the Phidgets Spatial 3/3/3 devices
Driver for the Phidgets Spatial 3/3/3 devices
|
||
| 1 | 2019-05-06 | phidgets_ik |
Driver for the Phidgets InterfaceKit devices
Driver for the Phidgets InterfaceKit devices
|
||
| 1 | 2019-05-06 | phidgets_high_speed_encoder |
Driver for the Phidgets high speed encoder devices
Driver for the Phidgets high speed encoder devices
|
||
| 2 | 2019-05-06 | phidgets_drivers |
API and ROS drivers for Phidgets devices
API and ROS drivers for Phidgets devices
|
||
| 2 | 2019-05-06 | phidgets_api |
A C++ Wrapper for the Phidgets C API
A C++ Wrapper for the Phidgets C API
|
||
| 1 | 2019-05-23 | pgm_learner |
Parameter/Structure Estimation and Inference for Bayesian Belief Network
Parameter/Structure Estimation and Inference for Bayesian Belief Network
|
||
| 1 | 2018-04-24 | perception_pcl |
PCL (Point Cloud Library) ROS interface stack. PCL-ROS is the preferred
bridge for 3D applications involving n-D Point Clouds and 3D geometry
processing in ROS.
PCL (Point Cloud Library) ROS interface stack. PCL-ROS is the preferred
bridge for 3D applications involving n-D Point Clouds and 3D geometry
processing in ROS.
|
||
| 1 | 2018-04-02 | perception |
A metapackage to aggregate several packages.
A metapackage to aggregate several packages.
|
||
| 1 | 2018-11-15 | people_velocity_tracker |
Track the output of the leg_detector to indicate the velocity of person.
Track the output of the leg_detector to indicate the velocity of person.
|
||
| 1 | 2018-11-15 | people_tracking_filter |
A collection of filtering tools for tracking people's locations
A collection of filtering tools for tracking people's locations
|
||
| 1 | 2018-11-15 | people_msgs |
Messages used by nodes in the people stack.
Messages used by nodes in the people stack.
|
||
| 1 | 2018-11-15 | people |
The people stack holds algorithms for perceiving people from a number of sensors.
The people stack holds algorithms for perceiving people from a number of sensors.
|
||
| 1 | 2018-04-24 | pcl_ros |
PCL (Point Cloud Library) ROS interface stack. PCL-ROS is the preferred
bridge for 3D applications involving n-D Point Clouds and 3D geometry
processing in ROS.
PCL (Point Cloud Library) ROS interface stack. PCL-ROS is the preferred
bridge for 3D applications involving n-D Point Clouds and 3D geometry
processing in ROS.
|
||
| 1 | 2016-10-27 | pcl_msgs |
Package containing PCL (Point Cloud Library)-related ROS messages.
Package containing PCL (Point Cloud Library)-related ROS messages.
|
||
| 3 | 2016-10-27 | pcl_conversions |
Provides conversions from PCL data types and ROS message types
Provides conversions from PCL data types and ROS message types
|
||
| 2 | 2018-09-04 | pcdfilter_pa |
ProAut pointcloud filter package
ProAut pointcloud filter package
|
||
| 1 | 2018-07-29 | parrot_arsdk |
Catkin wrapper for the official ARSDK from Parrot
Catkin wrapper for the official ARSDK from Parrot
|
||
| 2 | 2018-09-04 | parameter_pa |
ProAut parameter package
ProAut parameter package
|
||
| 2 | 2018-08-08 | panda_moveit_config |
A partly automatically generated package with all the configuration and launch files for using Panda research with MoveIt!
A partly automatically generated package with all the configuration and launch files for using Panda research with MoveIt!
|
||
| 1 | 2018-10-04 | pacmod_msgs |
Message definition files for the PACMod driver
Message definition files for the PACMod driver
|
||
| 1 | 2019-05-13 | pacmod_game_control |
ROS Package for controlling the AStuff PACMod with a Joystick
ROS Package for controlling the AStuff PACMod with a Joystick
|
||
| 1 | 2019-05-17 | pacmod3 |
AutonomouStuff PACMod v3 Driver Package
AutonomouStuff PACMod v3 Driver Package
|
||
| 1 | 2018-04-25 | pacmod |
AutonomouStuff PACMod driver package
AutonomouStuff PACMod driver package
|
||
| 1 | 2019-03-25 | p2os_urdf |
URDF file descriptions for P2OS/ARCOS robot
URDF file descriptions for P2OS/ARCOS robot
|
||
| 1 | 2019-03-25 | p2os_teleop |
A teleoperation node for the p2os_driver package.
A teleoperation node for the p2os_driver package.
|
||
| 1 | 2019-03-25 | p2os_msgs |
Defines the messages that are used to communicate with the
p2os_driver package and the ROS infrastructure.
Defines the messages that are used to communicate with the
p2os_driver package and the ROS infrastructure.
|
||
| 1 | 2019-03-25 | p2os_launch |
Launch and config files designed for use with the p2os stack.
Launch and config files designed for use with the p2os stack.
|
Packages
| Name | Description | ||||
|---|---|---|---|---|---|
| 1 | 2019-03-25 | self_test |
self_test
self_test
|
||
| 1 | 2017-12-23 | segway_rmp |
segway_rmp
segway_rmp
|
||
| 1 | 2018-10-21 | scratch4robots |
scratch4robots
scratch4robots
|
||
| 1 | 2017-12-14 | schunk_svh_driver |
SVH Driver wrapper to enable control of the Schunk five finger hand
SVH Driver wrapper to enable control of the Schunk five finger hand
|
||
| 1 | 2019-05-08 | schunk_simulated_tactile_sensors |
This package provides simulated tactile sensors for the Schunk Dextrous
Hand (SDH) which is mounted on the Care-O-bot arm. The node subscribes to
the Gazebo bumper topics of the SDH. It transforms the Gazebo feedback to
the "tactile_data" topic to provide the same tactile sensor interface as
the schunk_sdh package.
The following parameters can be set:
* cells_x: The number of patches on the tactile sensor in the direction
perpendicular to the finger. Defaults to 6.
* cells_y: The number of patches on the tactile sensor along the direction
of the finger. Defaults to 14.
* output_range: The maximum output value of one patch. Defaults to 3500.
* sensitivity: The change of output in one patch per Newton. Defaults to
350. The sensitivity can be approximated by the following
formula: S = output_range / (measurement_range * cell_area)
- The measurement range of the tactile pads is 250 kPa (from
the data sheet).
- The output range can be determined by experiment from the
real SDH. It is about 3500.
- The cell area is the size of one patch. Length and width
of the area are determined by dividing the length/width
of the collision surface by the number of cells in the
respective direction.
Important: In most cases this is NOT the cell area that is
given in the data sheet!
* filter_length: The length of the moving average filter which smoothes
the values from simulation. Defaults to 10.
The node subscribes to the following topics to receive data from the
simulation:
* thumb_2/state
* thumb_3/state
* finger_12/state
* finger_13/state
* finger_22/state
* finger_23/state
The node publishes the processed data on the following topic:
* tactile_data
The simulated bumper must obtain the collision data in the link that the
sensor is attached to. This is achieved by setting the "frameName" property
in the gazebo_ros_bumper controller.
This package provides simulated tactile sensors for the Schunk Dextrous
Hand (SDH) which is mounted on the Care-O-bot arm. The node subscribes to
the Gazebo bumper topics of the SDH. It transforms the Gazebo feedback to
the "tactile_data" topic to provide the same tactile sensor interface as
the schunk_sdh package.
The following parameters can be set:
* cells_x: The number of patches on the tactile sensor in the direction
perpendicular to the finger. Defaults to 6.
* cells_y: The number of patches on the tactile sensor along the direction
of the finger. Defaults to 14.
* output_range: The maximum output value of one patch. Defaults to 3500.
* sensitivity: The change of output in one patch per Newton. Defaults to
350. The sensitivity can be approximated by the following
formula: S = output_range / (measurement_range * cell_area)
- The measurement range of the tactile pads is 250 kPa (from
the data sheet).
- The output range can be determined by experiment from the
real SDH. It is about 3500.
- The cell area is the size of one patch. Length and width
of the area are determined by dividing the length/width
of the collision surface by the number of cells in the
respective direction.
Important: In most cases this is NOT the cell area that is
given in the data sheet!
* filter_length: The length of the moving average filter which smoothes
the values from simulation. Defaults to 10.
The node subscribes to the following topics to receive data from the
simulation:
* thumb_2/state
* thumb_3/state
* finger_12/state
* finger_13/state
* finger_22/state
* finger_23/state
The node publishes the processed data on the following topic:
* tactile_data
The simulated bumper must obtain the collision data in the link that the
sensor is attached to. This is achieved by setting the "frameName" property
in the gazebo_ros_bumper controller.
|
||
| 1 | 2019-05-08 | schunk_sdh |
This package provides an interface for operating the schunk dexterous hand (SDH), including the tactile sensors.
This package provides an interface for operating the schunk dexterous hand (SDH), including the tactile sensors.
|
||
| 1 | 2019-05-08 | schunk_powercube_chain |
This packages provides a configurable driver of a chain
of Schunk powercubes. The powercube chain is configured
through parameters. Most users will not directly interact
with this package but with the corresponding launch files
in other packages, e.g. schunk_bringup, cob_bringup, ...
This packages provides a configurable driver of a chain
of Schunk powercubes. The powercube chain is configured
through parameters. Most users will not directly interact
with this package but with the corresponding launch files
in other packages, e.g. schunk_bringup, cob_bringup, ...
|
||
| 1 | 2019-05-08 | schunk_modular_robotics |
This stack includes packages that provide access to the Schunk hardware through ROS messages, services and actions.
This stack includes packages that provide access to the Schunk hardware through ROS messages, services and actions.
|
||
| 1 | 2019-05-08 | schunk_libm5api |
This package wraps the libm5api to use it as a ros dependency. Original sources from http://www.schunk-modular-robotics.com/fileadmin/user_upload/software/schunk_libm5api_source.zip.
This package wraps the libm5api to use it as a ros dependency. Original sources from http://www.schunk-modular-robotics.com/fileadmin/user_upload/software/schunk_libm5api_source.zip.
|
||
| 1 | 2019-05-08 | schunk_description |
This package contains the description (mechanical, kinematic, visual,
etc.) of different schunk components. The files in this package are parsed and used by
a variety of other components. Most users will not interact directly
with this package.
This package contains the description (mechanical, kinematic, visual,
etc.) of different schunk components. The files in this package are parsed and used by
a variety of other components. Most users will not interact directly
with this package.
|
||
| 1 | 2017-11-02 | schunk_canopen_driver |
The schunk_canopen_driver package
The schunk_canopen_driver package
|
||
| 1 | 2016-05-05 | scheduler_msgs |
Messages used by the rocon scheduler.
Messages used by the rocon scheduler.
|
||
| 1 | 2018-06-03 | scan_tools |
Laser scan processing tools.
Laser scan processing tools.
|
||
| 1 | 2018-06-03 | scan_to_cloud_converter |
Converts LaserScan to PointCloud messages.
Converts LaserScan to PointCloud messages.
|
||
| 1 | 2019-03-26 | sbpl_recovery |
A recovery behavior that uses the sbpl lattice planner and the pose
follower to try to plan in full 3D to get the robot out of really tricky
situations.
A recovery behavior that uses the sbpl lattice planner and the pose
follower to try to plan in full 3D to get the robot out of really tricky
situations.
|
||
| 1 | 2019-03-26 | sbpl_lattice_planner |
The sbpl_lattice_planner is a global planner plugin for move_base and wraps
the SBPL search-based planning library.
The sbpl_lattice_planner is a global planner plugin for move_base and wraps
the SBPL search-based planning library.
|
||
| 1 | 2018-08-06 | sbpl |
Search-based planning library (SBPL).
Search-based planning library (SBPL).
|
||
| 2 | 2019-01-25 | sbg_driver |
The SBG ROS Driver package
The SBG ROS Driver package
|
||
| 1 | 2019-05-14 | sand_island |
The sand_island package
The sand_island package
|
||
| 1 | 2018-10-26 | sainsmart_relay_usb |
SainSmart USB relay driver controller
SainSmart USB relay driver controller
|
||
| 1 | 2019-05-24 | safety_limiter |
Motion limiter package for collision prevention
Motion limiter package for collision prevention
|
||
| 1 | 2019-03-11 | safe_teleop_stage |
Demo of safe_teleop in stage
Demo of safe_teleop in stage
|
||
| 1 | 2019-03-11 | safe_teleop_pr2 |
Launch files for running safe_teleop_base on pr2
Launch files for running safe_teleop_base on pr2
|
||
| 1 | 2019-03-11 | safe_teleop_base |
This package provides automatic collision avoidance and is intended to be used for safer teleoperation of a robot base.
This package provides automatic collision avoidance and is intended to be used for safer teleoperation of a robot base.
|
||
| 1 | 2019-01-24 | rviz_recorder_buttons |
The rviz_recorder_buttons package
The rviz_recorder_buttons package
|
||
| 1 | 2019-01-29 | rviz_python_tutorial |
Tutorials showing how to call into rviz internals from python scripts.
Tutorials showing how to call into rviz internals from python scripts.
|
||
| 1 | 2019-01-29 | rviz_plugin_tutorials |
Tutorials showing how to write plugins for RViz.
Tutorials showing how to write plugins for RViz.
|
||
| 1 | 2019-05-06 | rviz_imu_plugin |
RVIZ plugin for IMU visualization
RVIZ plugin for IMU visualization
|
||
| 1 | 2019-02-25 | rv7fl_moveit_config |
An automatically generated package with all the configuration and launch files for using the rv7fl with the MoveIt! Motion Planning Framework
An automatically generated package with all the configuration and launch files for using the rv7fl with the MoveIt! Motion Planning Framework
|
||
| 1 | 2019-02-25 | rv4fl_moveit_config |
An automatically generated package with all the configuration and launch files for using the rv4fl with the MoveIt! Motion Planning Framework
An automatically generated package with all the configuration and launch files for using the rv4fl with the MoveIt! Motion Planning Framework
|
||
| 1 | 2019-05-15 | rtt_visualization_msgs |
Provides an rtt typekit for ROS visualization_msgs messages.
It allows you to use ROS messages transparently in
RTT components and applications.
This package was automatically generated by the
create_rtt_msgs generator and should not be manually
modified.
See the http://ros.org/wiki/visualization_msgs documentation
for the documentation of the ROS messages in this
typekit.
Provides an rtt typekit for ROS visualization_msgs messages.
It allows you to use ROS messages transparently in
RTT components and applications.
This package was automatically generated by the
create_rtt_msgs generator and should not be manually
modified.
See the http://ros.org/wiki/visualization_msgs documentation
for the documentation of the ROS messages in this
typekit.
|
||
| 1 | 2019-05-15 | rtt_trajectory_msgs |
Provides an rtt typekit for ROS trajectory_msgs messages.
It allows you to use ROS messages transparently in
RTT components and applications.
This package was automatically generated by the
create_rtt_msgs generator and should not be manually
modified.
See the http://ros.org/wiki/trajectory_msgs documentation
for the documentation of the ROS messages in this
typekit.
Provides an rtt typekit for ROS trajectory_msgs messages.
It allows you to use ROS messages transparently in
RTT components and applications.
This package was automatically generated by the
create_rtt_msgs generator and should not be manually
modified.
See the http://ros.org/wiki/trajectory_msgs documentation
for the documentation of the ROS messages in this
typekit.
|
||
| 1 | 2019-05-15 | rtt_tf2_msgs |
Provides an rtt typekit for ROS tf2_msgs messages.
It allows you to use ROS messages transparently in
RTT components and applications.
This package was automatically generated by the
create_rtt_msgs generator and should not be manually
modified.
See the http://ros.org/wiki/tf2_msgs documentation
for the documentation of the ROS messages in this
typekit.
Provides an rtt typekit for ROS tf2_msgs messages.
It allows you to use ROS messages transparently in
RTT components and applications.
This package was automatically generated by the
create_rtt_msgs generator and should not be manually
modified.
See the http://ros.org/wiki/tf2_msgs documentation
for the documentation of the ROS messages in this
typekit.
|
||
| 1 | 2019-05-15 | rtt_tf |
This package contains the components of the rtt_tf package
This package contains the components of the rtt_tf package
|
||
| 1 | 2019-05-15 | rtt_stereo_msgs |
Provides an rtt typekit for ROS stereo_msgs messages.
It allows you to use ROS messages transparently in
RTT components and applications.
This package was automatically generated by the
create_rtt_msgs generator and should not be manually
modified.
See the http://ros.org/wiki/stereo_msgs documentation
for the documentation of the ROS messages in this
typekit.
Provides an rtt typekit for ROS stereo_msgs messages.
It allows you to use ROS messages transparently in
RTT components and applications.
This package was automatically generated by the
create_rtt_msgs generator and should not be manually
modified.
See the http://ros.org/wiki/stereo_msgs documentation
for the documentation of the ROS messages in this
typekit.
|
||
| 1 | 2019-05-15 | rtt_std_srvs |
Provides an rtt typekit for ROS std_msgs messages.
It allows you to use ROS messages transparently in
RTT components and applications.
This package was automatically generated by the
create_rtt_msgs generator and should not be manually
modified.
See the http://ros.org/wiki/std_msgs documentation
for the documentation of the ROS messages in this
typekit.
Provides an rtt typekit for ROS std_msgs messages.
It allows you to use ROS messages transparently in
RTT components and applications.
This package was automatically generated by the
create_rtt_msgs generator and should not be manually
modified.
See the http://ros.org/wiki/std_msgs documentation
for the documentation of the ROS messages in this
typekit.
|
||
| 1 | 2019-05-15 | rtt_std_msgs |
Provides an rtt typekit for ROS std_msgs messages.
It allows you to use ROS messages transparently in
RTT components and applications.
This package was automatically generated by the
create_rtt_msgs generator and should not be manually
modified.
See the http://ros.org/wiki/std_msgs documentation
for the documentation of the ROS messages in this
typekit.
Provides an rtt typekit for ROS std_msgs messages.
It allows you to use ROS messages transparently in
RTT components and applications.
This package was automatically generated by the
create_rtt_msgs generator and should not be manually
modified.
See the http://ros.org/wiki/std_msgs documentation
for the documentation of the ROS messages in this
typekit.
|
||
| 1 | 2019-05-15 | rtt_shape_msgs |
Provides an rtt typekit for ROS shape_msgs messages.
It allows you to use ROS messages transparently in
RTT components and applications.
This package was automatically generated by the
create_rtt_msgs generator and should not be manually
modified.
See the http://ros.org/wiki/shape_msgs documentation
for the documentation of the ROS messages in this
typekit.
Provides an rtt typekit for ROS shape_msgs messages.
It allows you to use ROS messages transparently in
RTT components and applications.
This package was automatically generated by the
create_rtt_msgs generator and should not be manually
modified.
See the http://ros.org/wiki/shape_msgs documentation
for the documentation of the ROS messages in this
typekit.
|
||
| 1 | 2019-05-15 | rtt_sensor_msgs |
Provides an rtt typekit for ROS sensor_msgs messages.
It allows you to use ROS messages transparently in
RTT components and applications.
This package was automatically generated by the
create_rtt_msgs generator and should not be manually
modified.
See the http://ros.org/wiki/sensor_msgs documentation
for the documentation of the ROS messages in this
typekit.
Provides an rtt typekit for ROS sensor_msgs messages.
It allows you to use ROS messages transparently in
RTT components and applications.
This package was automatically generated by the
create_rtt_msgs generator and should not be manually
modified.
See the http://ros.org/wiki/sensor_msgs documentation
for the documentation of the ROS messages in this
typekit.
|
||
| 1 | 2019-05-15 | rtt_rosparam_tests |
The rtt_rosparam_tests package
The rtt_rosparam_tests package
|
||
| 1 | 2019-05-15 | rtt_rosparam |
This package provides an RTT service and service-requester for associating RTT component properties with ROS parameters
This package provides an RTT service and service-requester for associating RTT component properties with ROS parameters
|
||
| 1 | 2019-05-15 | rtt_rospack_tests |
The rtt_ros_tests package
The rtt_ros_tests package
|
||
| 1 | 2019-05-15 | rtt_rospack |
rtt_rospack provides an RTT plugin to use rospack to find packages in your ROS_PACKAGE_PATH
rtt_rospack provides an RTT plugin to use rospack to find packages in your ROS_PACKAGE_PATH
|
||
| 1 | 2019-05-15 | rtt_rosnode |
This package provides an RTT plugin to add a ROS node to the RTT process.
This package provides an RTT plugin to add a ROS node to the RTT process.
|
||
| 1 | 2019-05-15 | rtt_rosgraph_msgs |
Provides an rtt typekit for ROS rosgraph_msgs messages.
It allows you to use ROS messages transparently in
RTT components and applications.
This package was automatically generated by the
create_rtt_msgs generator and should not be manually
modified.
See the http://ros.org/wiki/rosgraph_msgs documentation
for the documentation of the ROS messages in this
typekit.
Provides an rtt typekit for ROS rosgraph_msgs messages.
It allows you to use ROS messages transparently in
RTT components and applications.
This package was automatically generated by the
create_rtt_msgs generator and should not be manually
modified.
See the http://ros.org/wiki/rosgraph_msgs documentation
for the documentation of the ROS messages in this
typekit.
|
||
| 1 | 2019-05-15 | rtt_rosdeployment |
rtt_rosdeployment provides an RTT plugin to control an ocl deployment component over ROS service calls.
rtt_rosdeployment provides an RTT plugin to control an ocl deployment component over ROS service calls.
|
||
| 1 | 2019-05-15 | rtt_roscomm_tests |
The rtt_roscomm_tests package
The rtt_roscomm_tests package
|
||
| 1 | 2019-05-15 | rtt_roscomm |
rtt_roscomm provides the necessary template files and cmake macros for
automatic rtt typekit and transport generation from ROS msg files
rtt_roscomm provides the necessary template files and cmake macros for
automatic rtt typekit and transport generation from ROS msg files
|
||
| 1 | 2019-05-15 | rtt_rosclock |
This package provides an RTT plugin to access different time measurements on a realtime host.
This package provides an RTT plugin to access different time measurements on a realtime host.
|
||
| 1 | 2019-05-15 | rtt_rosbuild_tests |
rtt_ros_rosbuild_test
rtt_ros_rosbuild_test
|
Packages
| Name | Description | ||||
|---|---|---|---|---|---|
| 1 | 2019-02-06 | shadow_robot |
This stack regroups the different ros interfaces developped for Shadow Robot's
Hardware. It provides an interface to both simulated and real hardware.
This stack regroups the different ros interfaces developped for Shadow Robot's
Hardware. It provides an interface to both simulated and real hardware.
|
||
| 1 | 2016-09-25 | settlerlib |
Defines helper functions and routines that greatly help when trying to create a settler
for a specific sensor channel. This package is experimental and unstable.
Expect its APIs to change.
Defines helper functions and routines that greatly help when trying to create a settler
for a specific sensor channel. This package is experimental and unstable.
Expect its APIs to change.
|
||
| 1 | 2017-02-03 | session_tutorials |
session_tutorials
session_tutorials
|
||
| 1 | 2019-04-05 | service_tools |
Service tools
Service tools
|
||
| 1 | 2013-09-18 | serial_utils |
A package which adds useful additions to the serial package.
A package which adds useful additions to the serial package.
|
||
| 1 | 2019-03-25 | serial |
Serial is a cross-platform, simple to use library for using serial ports on computers.
This library provides a C++, object oriented interface for interacting with RS-232
like devices on Linux and Windows.
Serial is a cross-platform, simple to use library for using serial ports on computers.
This library provides a C++, object oriented interface for interacting with RS-232
like devices on Linux and Windows.
|
||
| 2 | 2018-05-03 | sensor_msgs |
This package defines messages for commonly used sensors, including
cameras and scanning laser rangefinders.
This package defines messages for commonly used sensors, including
cameras and scanning laser rangefinders.
|
||
| 2 | 2019-04-02 | semantic_point_annotator |
A node which annotates 3D point cloud data with semantic labels.
A node which annotates 3D point cloud data with semantic labels.
|
||
| 1 | 2019-03-25 | self_test |
self_test
self_test
|
||
| 1 | 2017-12-23 | segway_rmp |
segway_rmp
segway_rmp
|
||
| 2 | 2018-03-09 | segbot_simulation_apps |
Applications designed specifically to be used in a simulation
environment, such as opening and closing doors inside the building
simulation.
Applications designed specifically to be used in a simulation
environment, such as opening and closing doors inside the building
simulation.
|
||
| 1 | 2018-03-09 | segbot_sensors |
Contains sensor specific launch files and all the relevant filters that are
applied on sensor data before being used by the segbot.
Contains sensor specific launch files and all the relevant filters that are
applied on sensor data before being used by the segbot.
|
||
| 2 | 2018-03-09 | segbot_navigation |
Contains launch files for running the ROS navigation stack on the segbot
using the eband_local_planner approach, as well as launch files for amcl
and gmapping.
Contains launch files for running the ROS navigation stack on the segbot
using the eband_local_planner approach, as well as launch files for amcl
and gmapping.
|
||
| 2 | 2018-03-09 | segbot_logical_translator |
High-level navigation application for the segbot allowing the segbot to
approach and gothrough doors. The application can also be used to determine
the segbot's logical location, as well as sense when a door in front of the
robot is open or not.
High-level navigation application for the segbot allowing the segbot to
approach and gothrough doors. The application can also be used to determine
the segbot's logical location, as well as sense when a door in front of the
robot is open or not.
|
||
| 1 | 2018-03-09 | segbot_led |
LED package that provides drivers for communicating with Polulu WS2812B-Based LED Strips
utilizing an Arduino microcontroller. Also action and service calls for standard applications.
LED package that provides drivers for communicating with Polulu WS2812B-Based LED Strips
utilizing an Arduino microcontroller. Also action and service calls for standard applications.
|
||
| 2 | 2018-03-09 | segbot_gui |
Displays a simple GUI to the user. The GUI is capable of displaying a simple
message or image to the user, and ask a question. The message and question
plugins are also written in this package.
Displays a simple GUI to the user. The GUI is capable of displaying a simple
message or image to the user, and ask a question. The message and question
plugins are also written in this package.
|
||
| 2 | 2018-03-09 | segbot_gazebo |
bwi_gazebo
bwi_gazebo
|
||
| 1 | 2018-03-09 | segbot_firmware |
Arduino firmware for BWI segbot sensor array.
Arduino firmware for BWI segbot sensor array.
|
||
| 1 | 2018-03-09 | segbot_description |
Contains URDF descriptions of all robot components and sensors for the
segbot, as well as all the different sensor configurations for a segbot.
Contains URDF descriptions of all robot components and sensors for the
segbot, as well as all the different sensor configurations for a segbot.
|
||
| 1 | 2018-03-09 | segbot_bringup |
Contains launch files and runtime scripts necessary for running
segbots in simulation and in the real world.
Contains launch files and runtime scripts necessary for running
segbots in simulation and in the real world.
|
||
| 1 | 2018-03-09 | segbot |
ROS packages for controlling Segway-based robots at the Learning Agents
Research Group (LARG), AI Laboratory, Department of Computer Science,
University of Texas at Austin.
ROS packages for controlling Segway-based robots at the Learning Agents
Research Group (LARG), AI Laboratory, Department of Computer Science,
University of Texas at Austin.
|
||
| 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 | 2017-12-14 | schunk_svh_driver |
SVH Driver wrapper to enable control of the Schunk five finger hand
SVH Driver wrapper to enable control of the Schunk five finger hand
|
||
| 1 | 2019-05-08 | schunk_simulated_tactile_sensors |
This package provides simulated tactile sensors for the Schunk Dextrous
Hand (SDH) which is mounted on the Care-O-bot arm. The node subscribes to
the Gazebo bumper topics of the SDH. It transforms the Gazebo feedback to
the "tactile_data" topic to provide the same tactile sensor interface as
the schunk_sdh package.
The following parameters can be set:
* cells_x: The number of patches on the tactile sensor in the direction
perpendicular to the finger. Defaults to 6.
* cells_y: The number of patches on the tactile sensor along the direction
of the finger. Defaults to 14.
* output_range: The maximum output value of one patch. Defaults to 3500.
* sensitivity: The change of output in one patch per Newton. Defaults to
350. The sensitivity can be approximated by the following
formula: S = output_range / (measurement_range * cell_area)
- The measurement range of the tactile pads is 250 kPa (from
the data sheet).
- The output range can be determined by experiment from the
real SDH. It is about 3500.
- The cell area is the size of one patch. Length and width
of the area are determined by dividing the length/width
of the collision surface by the number of cells in the
respective direction.
Important: In most cases this is NOT the cell area that is
given in the data sheet!
* filter_length: The length of the moving average filter which smoothes
the values from simulation. Defaults to 10.
The node subscribes to the following topics to receive data from the
simulation:
* thumb_2/state
* thumb_3/state
* finger_12/state
* finger_13/state
* finger_22/state
* finger_23/state
The node publishes the processed data on the following topic:
* tactile_data
The simulated bumper must obtain the collision data in the link that the
sensor is attached to. This is achieved by setting the "frameName" property
in the gazebo_ros_bumper controller.
This package provides simulated tactile sensors for the Schunk Dextrous
Hand (SDH) which is mounted on the Care-O-bot arm. The node subscribes to
the Gazebo bumper topics of the SDH. It transforms the Gazebo feedback to
the "tactile_data" topic to provide the same tactile sensor interface as
the schunk_sdh package.
The following parameters can be set:
* cells_x: The number of patches on the tactile sensor in the direction
perpendicular to the finger. Defaults to 6.
* cells_y: The number of patches on the tactile sensor along the direction
of the finger. Defaults to 14.
* output_range: The maximum output value of one patch. Defaults to 3500.
* sensitivity: The change of output in one patch per Newton. Defaults to
350. The sensitivity can be approximated by the following
formula: S = output_range / (measurement_range * cell_area)
- The measurement range of the tactile pads is 250 kPa (from
the data sheet).
- The output range can be determined by experiment from the
real SDH. It is about 3500.
- The cell area is the size of one patch. Length and width
of the area are determined by dividing the length/width
of the collision surface by the number of cells in the
respective direction.
Important: In most cases this is NOT the cell area that is
given in the data sheet!
* filter_length: The length of the moving average filter which smoothes
the values from simulation. Defaults to 10.
The node subscribes to the following topics to receive data from the
simulation:
* thumb_2/state
* thumb_3/state
* finger_12/state
* finger_13/state
* finger_22/state
* finger_23/state
The node publishes the processed data on the following topic:
* tactile_data
The simulated bumper must obtain the collision data in the link that the
sensor is attached to. This is achieved by setting the "frameName" property
in the gazebo_ros_bumper controller.
|
||
| 1 | 2019-05-08 | schunk_sdh |
This package provides an interface for operating the schunk dexterous hand (SDH), including the tactile sensors.
This package provides an interface for operating the schunk dexterous hand (SDH), including the tactile sensors.
|
||
| 1 | 2019-05-08 | schunk_powercube_chain |
This packages provides a configurable driver of a chain
of Schunk powercubes. The powercube chain is configured
through parameters. Most users will not directly interact
with this package but with the corresponding launch files
in other packages, e.g. schunk_bringup, cob_bringup, ...
This packages provides a configurable driver of a chain
of Schunk powercubes. The powercube chain is configured
through parameters. Most users will not directly interact
with this package but with the corresponding launch files
in other packages, e.g. schunk_bringup, cob_bringup, ...
|
||
| 1 | 2019-05-08 | schunk_modular_robotics |
This stack includes packages that provide access to the Schunk hardware through ROS messages, services and actions.
This stack includes packages that provide access to the Schunk hardware through ROS messages, services and actions.
|
||
| 1 | 2019-05-08 | schunk_libm5api |
This package wraps the libm5api to use it as a ros dependency. Original sources from http://www.schunk-modular-robotics.com/fileadmin/user_upload/software/schunk_libm5api_source.zip.
This package wraps the libm5api to use it as a ros dependency. Original sources from http://www.schunk-modular-robotics.com/fileadmin/user_upload/software/schunk_libm5api_source.zip.
|
||
| 1 | 2015-09-24 | schunk_grippers |
Schunk_grippers stack contains packages for PG70 and EZN64 grippers
Schunk_grippers stack contains packages for PG70 and EZN64 grippers
|
||
| 1 | 2015-09-24 | schunk_ezn64 |
Xacro model and usb driver for basic communication with Schunk EZN64 gripper
Xacro model and usb driver for basic communication with Schunk EZN64 gripper
|
||
| 1 | 2019-05-08 | schunk_description |
This package contains the description (mechanical, kinematic, visual,
etc.) of different schunk components. The files in this package are parsed and used by
a variety of other components. Most users will not interact directly
with this package.
This package contains the description (mechanical, kinematic, visual,
etc.) of different schunk components. The files in this package are parsed and used by
a variety of other components. Most users will not interact directly
with this package.
|
||
| 1 | 2017-11-02 | schunk_canopen_driver |
The schunk_canopen_driver package
The schunk_canopen_driver package
|
||
| 1 | 2015-07-08 | scheduler_msgs |
Messages used by the rocon scheduler.
Messages used by the rocon scheduler.
|
||
| 1 | 2018-06-03 | scan_tools |
Laser scan processing tools.
Laser scan processing tools.
|
||
| 1 | 2018-06-03 | scan_to_cloud_converter |
Converts LaserScan to PointCloud messages.
Converts LaserScan to PointCloud messages.
|
||
| 1 | 2019-03-26 | sbpl_recovery |
A recovery behavior that uses the sbpl lattice planner and the pose
follower to try to plan in full 3D to get the robot out of really tricky
situations.
A recovery behavior that uses the sbpl lattice planner and the pose
follower to try to plan in full 3D to get the robot out of really tricky
situations.
|
||
| 1 | 2019-03-26 | sbpl_lattice_planner |
The sbpl_lattice_planner is a global planner plugin for move_base and wraps
the SBPL search-based planning library.
The sbpl_lattice_planner is a global planner plugin for move_base and wraps
the SBPL search-based planning library.
|
||
| 1 | 2014-08-08 | sbpl |
Search-based planning library (SBPL).
Search-based planning library (SBPL).
|
||
| 1 | 2017-01-11 | samplerobot_moveit_config |
An automatically generated package with all the configuration and launch files for using the SampleRobot with the MoveIt Motion Planning Framework
An automatically generated package with all the configuration and launch files for using the SampleRobot with the MoveIt Motion Planning Framework
|
||
| 1 | 2018-10-26 | sainsmart_relay_usb |
SainSmart USB relay driver controller
SainSmart USB relay driver controller
|
||
| 1 | 2019-05-24 | safety_limiter |
Motion limiter package for collision prevention
Motion limiter package for collision prevention
|
||
| 1 | 2019-03-11 | safe_teleop_stage |
Demo of safe_teleop in stage
Demo of safe_teleop in stage
|
||
| 1 | 2019-03-11 | safe_teleop_pr2 |
Launch files for running safe_teleop_base on pr2
Launch files for running safe_teleop_base on pr2
|
||
| 1 | 2019-03-11 | safe_teleop_base |
This package provides automatic collision avoidance and is intended to be used for safer teleoperation of a robot base.
This package provides automatic collision avoidance and is intended to be used for safer teleoperation of a robot base.
|
||
| 1 | 2016-08-05 | s3000_laser |
The s3000_laser package
The s3000_laser package
|
||
| 1 | 2016-09-30 | rwt_utils_3rdparty |
The rwt_utils_3rdparty package
The rwt_utils_3rdparty package
|
||
| 1 | 2016-09-30 | rwt_speech_recognition |
The rwt_speech_recognition package
The rwt_speech_recognition package
|
||
| 1 | 2016-09-30 | rwt_robot_monitor |
The rwt_robot_monitor package
The rwt_robot_monitor package
|
||
| 1 | 2016-09-30 | rwt_plot |
rwt_plot
rwt_plot
|
||
| 1 | 2016-09-30 | rwt_moveit |
This package provides a web user interface of
This package provides a web user interface of
|
Packages
Packages
| Name | Description | ||||
|---|---|---|---|---|---|
| 2 | 2015-01-19 | pr2_controller_manager |
The controller manager (CM) package provides the infrastructure to run controllers in a hard realtime loop.
The controller manager (CM) package provides the infrastructure to run controllers in a hard realtime loop.
|
||
| 2 | 2015-01-19 | pr2_controller_interface |
This package specifies the interface to a realtime controller. A
controller that implements this interface can be executed by the
This package specifies the interface to a realtime controller. A
controller that implements this interface can be executed by the
|
||
| 2 | 2016-10-11 | pr2_common |
URDF description of the robot kinematics and dynamics, 3D models of robot components, information required for gazebo to simulate the PR2, and messages specific to the PR2 such as detailed information about its power board and fingertip pressure sensors.
URDF description of the robot kinematics and dynamics, 3D models of robot components, information required for gazebo to simulate the PR2, and messages specific to the PR2 such as detailed information about its power board and fingertip pressure sensors.
|
||
| 2 | 2015-02-09 | pr2_calibration_controllers |
The pr2_calibration_controllers package contains the controllers
used to bring all the joints in the PR2 to a calibrated state.
The pr2_calibration_controllers package contains the controllers
used to bring all the joints in the PR2 to a calibrated state.
|
||
| 1 | 2016-08-08 | pr2_arm_kinematics |
This package provides a kinematics implementation for the PR2 robot. It can be used to compute forward and inverse kinematics.
This package provides a kinematics implementation for the PR2 robot. It can be used to compute forward and inverse kinematics.
|
||
| 1 | 2016-08-10 | position_controllers |
position_controllers
position_controllers
|
||
| 1 | 2018-08-08 | posedetection_msgs |
posedetection_msgs provides messages and services to facilitate passing pose detection results and features.
posedetection_msgs provides messages and services to facilitate passing pose detection results and features.
|
||
| 1 | 2019-04-04 | pose_cov_ops |
C++ library for SE(2/3) pose and 2D/3D point
composition operations with uncertainty
C++ library for SE(2/3) pose and 2D/3D point
composition operations with uncertainty
|
||
| 1 | 2017-11-05 | polled_camera |
polled_camera contains a service and C++ helper classes for implementing a polled
camera driver node and requesting images from it. The package is currently for
internal use as the API is still under development.
polled_camera contains a service and C++ helper classes for implementing a polled
camera driver node and requesting images from it. The package is currently for
internal use as the API is still under development.
|
||
| 1 | 2018-06-03 | polar_scan_matcher |
|
||
| 1 | 2018-03-27 | pointgrey_camera_driver |
Point Grey camera driver based on libflycapture2.
Point Grey camera driver based on libflycapture2.
|
||
| 1 | 2018-03-27 | pointgrey_camera_description |
URDF descriptions for Point Grey cameras
URDF descriptions for Point Grey cameras
|
||
| 2 | 2017-04-26 | pointcloud_to_laserscan |
Converts a 3D Point Cloud into a 2D laser scan. This is useful for making devices like the Kinect appear like a laser scanner for 2D-based algorithms (e.g. laser-based SLAM).
Converts a 3D Point Cloud into a 2D laser scan. This is useful for making devices like the Kinect appear like a laser scanner for 2D-based algorithms (e.g. laser-based SLAM).
|
||
| 1 | 2016-03-24 | point_cloud_publisher_tutorial |
The point_cloud_publisher_tutorial package
The point_cloud_publisher_tutorial package
|
||
| 1 | 2015-08-26 | pocketsphinx |
This package is a simple wrapper around the pocketsphinx speech recognizer,
using gstreamer and a Python-based interface.
This package is a simple wrapper around the pocketsphinx speech recognizer,
using gstreamer and a Python-based interface.
|
||
| 1 | 2016-12-09 | pluginlib_tutorials |
The pluginlib_tutorials package
The pluginlib_tutorials package
|
||
| 1 | 2018-10-19 | pluginlib |
The pluginlib package provides tools for writing and dynamically loading plugins using the ROS build infrastructure.
To work, these tools require plugin providers to register their plugins in the package.xml of their package.
The pluginlib package provides tools for writing and dynamically loading plugins using the ROS build infrastructure.
To work, these tools require plugin providers to register their plugins in the package.xml of their package.
|
||
| 1 | 2019-05-19 | plotjuggler |
PlotJuggler: juggle with data
PlotJuggler: juggle with data
|
||
| 1 | 2018-05-22 | planning_msgs |
Plan request and return definitions
Plan request and return definitions
|
||
| 1 | 2019-04-14 | pid |
Launch a PID control node.
Launch a PID control node.
|
||
| 2 | 2017-08-14 | phidgets_imu |
Driver for the Phidgets Spatial 3/3/3 devices
Driver for the Phidgets Spatial 3/3/3 devices
|
||
| 2 | 2017-08-14 | phidgets_drivers |
API and ROS drivers for Phidgets devices
API and ROS drivers for Phidgets devices
|
||
| 2 | 2017-08-14 | phidgets_api |
A C++ Wrapper for the Phidgets C API
A C++ Wrapper for the Phidgets C API
|
||
| 1 | 2019-05-23 | pgm_learner |
Parameter/Structure Estimation and Inference for Bayesian Belief Network
Parameter/Structure Estimation and Inference for Bayesian Belief Network
|
||
| 1 | 2018-05-22 | person_msgs |
Message definitions for detected persons from within RoboSherlock
Message definitions for detected persons from within RoboSherlock
|
||
| 1 | 2016-05-04 | perception_pcl |
PCL (Point Cloud Library) ROS interface stack. PCL-ROS is the preferred
bridge for 3D applications involving n-D Point Clouds and 3D geometry
processing in ROS.
PCL (Point Cloud Library) ROS interface stack. PCL-ROS is the preferred
bridge for 3D applications involving n-D Point Clouds and 3D geometry
processing in ROS.
|
||
| 1 | 2018-04-02 | perception |
A metapackage to aggregate several packages.
A metapackage to aggregate several packages.
|
||
| 1 | 2016-09-15 | pepperl_fuchs_r2000 |
The Pepperl+Fuchs R2000 laser range finder driver package
The Pepperl+Fuchs R2000 laser range finder driver package
|
||
| 1 | 2018-02-11 | pepper_sensors_py |
The pepper_sensors package
The pepper_sensors package
|
||
| 1 | 2018-02-11 | pepper_robot |
The pepper_robot package
The pepper_robot package
|
||
| 1 | 2017-01-18 | pepper_moveit_config |
An automatically generated package with all the configuration and launch files for using the Pepper robot with the MoveIt Motion Planning Framework
An automatically generated package with all the configuration and launch files for using the Pepper robot with the MoveIt Motion Planning Framework
|
||
| 1 | 2017-01-20 | pepper_meshes |
meshes for the Aldebaran Robotics Pepper
meshes for the Aldebaran Robotics Pepper
|
||
| 1 | 2017-11-16 | pepper_gazebo_plugin |
Gazebo plugin for Pepper robot
Gazebo plugin for Pepper robot
|
||
| 1 | 2018-02-11 | pepper_description |
The pepper_description package
The pepper_description package
|
||
| 1 | 2017-11-16 | pepper_dcm_bringup |
Bring-up the dcm driver to control Pepper
Bring-up the dcm driver to control Pepper
|
||
| 1 | 2017-11-16 | pepper_control |
Control for Pepper robot
Control for Pepper robot
|
||
| 1 | 2018-02-11 | pepper_bringup |
The pepper_bringup package
The pepper_bringup package
|
||
| 1 | 2017-04-10 | people_velocity_tracker |
Track the output of the leg_detector to indicate the velocity of person.
Track the output of the leg_detector to indicate the velocity of person.
|
||
| 1 | 2017-04-10 | people_tracking_filter |
A collection of filtering tools for tracking people's locations
A collection of filtering tools for tracking people's locations
|
||
| 1 | 2017-04-10 | people_msgs |
Messages used by nodes in the people stack.
Messages used by nodes in the people stack.
|
||
| 1 | 2017-04-10 | people |
The people stack holds algorithms for perceiving people from a number of sensors.
The people stack holds algorithms for perceiving people from a number of sensors.
|
||
| 1 | 2017-03-03 | pddl_planner_viewer |
a viewer of pddl_planner.
a viewer of pddl_planner.
|
||
| 1 | 2017-03-03 | pddl_planner |
pddl planner wrappers
pddl planner wrappers
|
||
| 1 | 2017-03-03 | pddl_msgs |
message for pddl planner
message for pddl planner
|
||
| 1 | 2016-05-04 | pcl_ros |
PCL (Point Cloud Library) ROS interface stack. PCL-ROS is the preferred
bridge for 3D applications involving n-D Point Clouds and 3D geometry
processing in ROS.
PCL (Point Cloud Library) ROS interface stack. PCL-ROS is the preferred
bridge for 3D applications involving n-D Point Clouds and 3D geometry
processing in ROS.
|
||
| 1 | 2016-10-27 | pcl_msgs |
Package containing PCL (Point Cloud Library)-related ROS messages.
Package containing PCL (Point Cloud Library)-related ROS messages.
|
||
| 3 | 2016-10-27 | pcl_conversions |
Provides conversions from PCL data types and ROS message types
Provides conversions from PCL data types and ROS message types
|
||
| 1 | 2018-07-29 | parrot_arsdk |
Catkin wrapper for the official ARSDK from Parrot
Catkin wrapper for the official ARSDK from Parrot
|
||
| 2 | 2018-09-04 | parameter_pa |
ProAut parameter package
ProAut parameter package
|
||
| 1 | 2019-03-25 | p2os_urdf |
URDF file descriptions for P2OS/ARCOS robot
URDF file descriptions for P2OS/ARCOS robot
|
Packages
| Name | Description | ||||
|---|---|---|---|---|---|
| 1 | 2018-05-22 | qt_gui_py_common |
qt_gui_py_common provides common functionality for GUI plugins written in Python.
qt_gui_py_common provides common functionality for GUI plugins written in Python.
|
||
| 1 | 2018-05-22 | qt_gui_cpp |
qt_gui_cpp provides the foundation for C++-bindings for qt_gui and creates bindings for every generator available.
At least one specific binding must be available in order to use C++-plugins.
qt_gui_cpp provides the foundation for C++-bindings for qt_gui and creates bindings for every generator available.
At least one specific binding must be available in order to use C++-plugins.
|
||
| 1 | 2018-05-22 | qt_gui_core |
Integration of the ROS package system and ROS-specific plugins for a Qt-based GUI.
Integration of the ROS package system and ROS-specific plugins for a Qt-based GUI.
|
||
| 1 | 2018-05-22 | qt_gui_app |
qt_gui_app provides the main to start an instance of the integrated graphical user interface provided by qt_gui.
qt_gui_app provides the main to start an instance of the integrated graphical user interface provided by qt_gui.
|
||
| 1 | 2018-05-22 | qt_gui |
qt_gui provides the infrastructure for an integrated graphical user interface based on Qt.
It is extensible with Python- and C++-based plugins (implemented in separate packages) which can contribute arbitrary widgets.
It requires either PyQt or PySide bindings.
qt_gui provides the infrastructure for an integrated graphical user interface based on Qt.
It is extensible with Python- and C++-based plugins (implemented in separate packages) which can contribute arbitrary widgets.
It requires either PyQt or PySide bindings.
|
||
| 1 | 2018-05-22 | qt_dotgraph |
qt_dotgraph provides helpers to work with dot graphs.
qt_dotgraph provides helpers to work with dot graphs.
|
||
| 1 | 2014-06-28 | qt_create |
Provides templates and scripts for creating qt-ros packages
(similar to roscreate-pkg).
Provides templates and scripts for creating qt-ros packages
(similar to roscreate-pkg).
|
||
| 1 | 2014-06-28 | qt_build |
Currently just maintains a cmake api for simplifying the building
of qt apps within the ros framework.
Currently just maintains a cmake api for simplifying the building
of qt apps within the ros framework.
|
||
| 1 | 2015-05-04 | python_trep |
Trep: Mechanical Simulation and Optimal Control Software
Trep: Mechanical Simulation and Optimal Control Software
|
||
| 1 | 2016-03-31 | python_qt_binding |
This stack provides Python bindings for Qt.
There are two providers: pyside and pyqt. PySide is released under
the LGPL. PyQt is released under the GPL.
Both the bindings and tools to build bindings are included from each
available provider. For PySide, it is called "Shiboken". For PyQt,
this is called "SIP".
Also provided is adapter code to make the user's Python code
independent of which binding provider was actually used which makes
it very easy to switch between these.
This stack provides Python bindings for Qt.
There are two providers: pyside and pyqt. PySide is released under
the LGPL. PyQt is released under the GPL.
Both the bindings and tools to build bindings are included from each
available provider. For PySide, it is called "Shiboken". For PyQt,
this is called "SIP".
Also provided is adapter code to make the user's Python code
independent of which binding provider was actually used which makes
it very easy to switch between these.
|
||
| 1 | 2019-03-04 | python_orocos_kdl |
This package contains the python bindings PyKDL for the Kinematics and Dynamics
Library (KDL), distributed by the Orocos Project.
This package contains the python bindings PyKDL for the Kinematics and Dynamics
Library (KDL), distributed by the Orocos Project.
|
||
| 1 | 2014-07-25 | ptu_control |
Actionlib interface for PTUs which listen for JointState messages (such as PTU46)
Actionlib interface for PTUs which listen for JointState messages (such as PTU46)
|
||
| 1 | 2014-07-25 | ptu46 |
Driver for the Directed Perception ptu46 pan/tilt driver, forked from player
Driver for the Directed Perception ptu46 pan/tilt driver, forked from player
|
||
| 1 | 2017-06-08 | ps4eye |
The ps4eye package
The ps4eye package
|
||
| 1 | 2014-07-28 | prosilica_gige_sdk |
AVT GigE SDK version 1.26 for ROS
AVT GigE SDK version 1.26 for ROS
|
||
| 1 | 2017-08-14 | prosilica_camera |
A ROS driver node for AVT/Prosilica Gigabit Ethernet (GigE) cameras.
A ROS driver node for AVT/Prosilica Gigabit Ethernet (GigE) cameras.
|
||
| 1 | 2015-02-10 | program_queue |
program_queue
program_queue
|
||
| 1 | 2015-05-27 | prace_gripper_driver |
prace_gripper_driver
prace_gripper_driver
|
||
| 1 | 2015-05-27 | prace_common |
prace_common substitude package
prace_common substitude package
|
||
| 1 | 2019-04-27 | pr2eus_tutorials |
pr2eus_tutorials
pr2eus_tutorials
|
||
| 1 | 2019-04-27 | pr2eus_openrave |
pr2eus_openrave
pr2eus_openrave
|
||
| 1 | 2019-04-27 | pr2eus_moveit |
pr2eus_moveit
pr2eus_moveit
|
||
| 1 | 2019-04-27 | pr2eus_impedance |
pr2eus_impedance
pr2eus_impedance
|
||
| 1 | 2019-04-27 | pr2eus_armnavigation |
pr2eus_armnavigation
pr2eus_armnavigation
|
||
| 1 | 2019-04-27 | pr2eus |
pr2eus
pr2eus
|
||
| 1 | 2016-03-23 | pr2_tuckarm |
Tucks the arms of the PR2 robot into a safe position for moving the base of the robot.
This also moves the arms out of the view of the tilting laser scanner, as much as possible.
Tucks the arms of the PR2 robot into a safe position for moving the base of the robot.
This also moves the arms out of the view of the tilting laser scanner, as much as possible.
|
||
| 1 | 2013-12-04 | pr2_tuck_arms_action |
The pr2_tuck_arms_action package
The pr2_tuck_arms_action package
|
||
| 1 | 2015-12-05 | pr2_trajectory_execution_tests |
pr2_trajectory_execution_tests
pr2_trajectory_execution_tests
|
||
| 1 | 2013-12-04 | pr2_tilt_laser_interface |
Provides a set of tools/actions for manipulating the pr2's tilting
laser. Simplifies previously complex tasks, such as fetching
a single sweep, given a set of desired parameters for both the laser
driver and tilting platform.
Provides a set of tools/actions for manipulating the pr2's tilting
laser. Simplifies previously complex tasks, such as fetching
a single sweep, given a set of desired parameters for both the laser
driver and tilting platform.
|
||
| 1 | 2015-12-05 | pr2_test_sbpl_planner |
pr2_test_sbpl_planner
pr2_test_sbpl_planner
|
||
| 1 | 2015-12-05 | pr2_test_kinematic_constraints |
pr2_test_kinematic_constraints
pr2_test_kinematic_constraints
|
||
| 1 | 2015-12-05 | pr2_test_collision_distance_field |
pr2_test_collision_distance_field
pr2_test_collision_distance_field
|
||
| 1 | 2015-12-05 | pr2_test_collision_detection |
pr2_test_collision_detection
pr2_test_collision_detection
|
||
| 1 | 2015-12-05 | pr2_test_chomp_planner |
pr2_test_chomp_planner
pr2_test_chomp_planner
|
||
| 1 | 2016-03-23 | pr2_teleop_general |
pr2_teleop_general
pr2_teleop_general
|
||
| 1 | 2016-03-23 | pr2_teleop |
The pr2_teleop package
The pr2_teleop package
|
||
| 1 | 2015-02-11 | pr2_surrogate |
The pr2_surrogate package allows you to make a PR2
into a surrogate for your physical body using the Oculus RIFT HMD
and Razer Hydra controller.
The pr2_surrogate package allows you to make a PR2
into a surrogate for your physical body using the Oculus RIFT HMD
and Razer Hydra controller.
|
||
| 1 | 2014-10-15 | pr2_sith |
An extension of the PR2 props demo, but instead of high fives, the PR2 swings a lightsaber until it detects an impact.
An extension of the PR2 props demo, but instead of high fives, the PR2 swings a lightsaber until it detects an impact.
|
||
| 1 | 2015-12-23 | pr2_simulator |
The pr2_simulator package
The pr2_simulator package
|
||
| 1 | 2015-02-10 | pr2_simple_interface |
pr2_simple_interface
pr2_simple_interface
|
||
| 1 | 2015-12-05 | pr2_simple_benchmark_test |
pr2_simple_benchmark_test
pr2_simple_benchmark_test
|
||
| 1 | 2015-02-11 | pr2_shield_teleop |
pr2_shield_teleop
pr2_shield_teleop
|
||
| 1 | 2019-04-24 | pr2_self_test_msgs |
Messages used in PR2 hardware testing.
Messages used in PR2 hardware testing.
|
||
| 1 | 2019-04-24 | pr2_self_test |
The pr2_self_test package
The pr2_self_test package
|
||
| 1 | 2015-02-10 | pr2_ps3_joystick_app |
Teleop PS3 joystick application for the pr2
Teleop PS3 joystick application for the pr2
|
||
| 1 | 2015-02-10 | pr2_props_app |
Application files for running PR2 props
Application files for running PR2 props
|
||
| 1 | 2015-02-19 | pr2_precise_trajectory |
This does some precise trajectory stuff, I'm not really sure though. :D
This does some precise trajectory stuff, I'm not really sure though. :D
|
||
| 1 | 2016-03-23 | pr2_position_scripts |
This package contains a number of scripts to set various components of the PR2. They are used in the apps to improve usablity.
This package contains a number of scripts to set various components of the PR2. They are used in the apps to improve usablity.
|
||
| 1 | 2016-02-17 | pr2_plugs_msgs |
pr2_plugs_msgs provides the msgs and action definitions required for plugging in.
pr2_plugs_msgs provides the msgs and action definitions required for plugging in.
|
||
| 1 | 2016-02-17 | pr2_plugs_common |
pr2_plugs_common contains common utilies for plugging in the PR2 robot.
pr2_plugs_common contains common utilies for plugging in the PR2 robot.
|