Packages
Packages
Packages
| Name | Description | ||||
|---|---|---|---|---|---|
| 1 | 2019-02-15 | test_nodelet |
A package for nodelet unit tests
A package for nodelet unit tests
|
||
| 1 | 2019-02-15 | nodelet_topic_tools |
This package contains common nodelet tools such as a mux, demux and throttle.
This package contains common nodelet tools such as a mux, demux and throttle.
|
||
| 1 | 2019-02-15 | nodelet_core |
Nodelet Core Metapackage
Nodelet Core Metapackage
|
||
| 1 | 2019-02-15 | nodelet |
The nodelet package is designed to provide a way to run multiple
algorithms in the same process with zero copy transport between
algorithms.
This package provides both the nodelet base class needed for
implementing a nodelet, as well as the NodeletLoader class used
for instantiating nodelets.
The nodelet package is designed to provide a way to run multiple
algorithms in the same process with zero copy transport between
algorithms.
This package provides both the nodelet base class needed for
implementing a nodelet, as well as the NodeletLoader class used
for instantiating nodelets.
|
||
| 1 | 2019-02-15 | actionlib |
The actionlib stack provides a standardized interface for
interfacing with preemptable tasks. Examples of this include moving
the base to a target location, performing a laser scan and returning
the resulting point cloud, detecting the handle of a door, etc.
The actionlib stack provides a standardized interface for
interfacing with preemptable tasks. Examples of this include moving
the base to a target location, performing a laser scan and returning
the resulting point cloud, detecting the handle of a door, etc.
|
||
| 1 | 2019-02-15 | abseil_cpp |
The abseil_cpp package
The abseil_cpp package
|
||
| 1 | 2019-02-13 | fetch_open_auto_dock |
An open-source version of the Fetch charge docking system.
An open-source version of the Fetch charge docking system.
|
||
| 1 | 2019-02-13 | fetch_driver_msgs |
Messages for the fetch_drivers package
Messages for the fetch_drivers package
|
||
| 1 | 2019-02-13 | fetch_auto_dock_msgs |
Messages for fetch_auto_dock package
Messages for fetch_auto_dock package
|
||
| 1 | 2019-02-12 | simple_message |
simple_message defines a simple messaging connection and protocol for communicating
with an industrial robot controller. Additional handler and manager classes are
included for handling connection limited systems. This package is part of the ROS-Industrial
program.
simple_message defines a simple messaging connection and protocol for communicating
with an industrial robot controller. Additional handler and manager classes are
included for handling connection limited systems. This package is part of the ROS-Industrial
program.
|
||
| 1 | 2019-02-12 | robot_navigation |
The robot_navigation package
The robot_navigation package
|
||
| 1 | 2019-02-12 | nav_grid_pub_sub |
Publishers and Subscribers for nav_grid data.
Publishers and Subscribers for nav_grid data.
|
||
| 1 | 2019-02-12 | nav_grid_iterators |
Iterator implementations for moving around the cells of a nav_grid in a number of common patterns.
Iterator implementations for moving around the cells of a nav_grid in a number of common patterns.
|
||
| 1 | 2019-02-12 | nav_grid |
A templatized interface for overlaying a two dimensional grid on the world.
A templatized interface for overlaying a two dimensional grid on the world.
|
||
| 1 | 2019-02-12 | nav_core_adapter |
This package contains adapters for using `nav_core` plugins as `nav_core2` plugins and vice versa (more or less).
See README.md for more information.
This package contains adapters for using `nav_core` plugins as `nav_core2` plugins and vice versa (more or less).
See README.md for more information.
|
||
| 1 | 2019-02-12 | nav_core2 |
Interfaces for Costmap, LocalPlanner and GlobalPlanner. Replaces nav_core.
Interfaces for Costmap, LocalPlanner and GlobalPlanner. Replaces nav_core.
|
||
| 2 | 2019-02-12 | nav_2d_utils |
A handful of useful utility functions for nav_core2 packages.
A handful of useful utility functions for nav_core2 packages.
|
||
| 2 | 2019-02-12 | nav_2d_msgs |
Basic message types for two dimensional navigation, extending from geometry_msgs::Pose2D.
Basic message types for two dimensional navigation, extending from geometry_msgs::Pose2D.
|
||
| 1 | 2019-02-12 | locomove_base |
Extension of locomotor that implements move_base's functionality.
Extension of locomotor that implements move_base's functionality.
|
||
| 1 | 2019-02-12 | locomotor_msgs |
Action definition for Locomotor
Action definition for Locomotor
|
||
| 1 | 2019-02-12 | locomotor |
Locomotor is an extensible path planning coordination engine that replaces move_base. The goal is to provide a mechanism for controlling what happens when the global and local planners succeed and fail. It leverages ROS callback queues to coordinate multiple threads.
Locomotor is an extensible path planning coordination engine that replaces move_base. The goal is to provide a mechanism for controlling what happens when the global and local planners succeed and fail. It leverages ROS callback queues to coordinate multiple threads.
|
||
| 1 | 2019-02-12 | industrial_utils |
Industrial utils is a library package that captures common funcitonality for the ROS-Industrial distribution.
Industrial utils is a library package that captures common funcitonality for the ROS-Industrial distribution.
|
||
| 1 | 2019-02-12 | industrial_trajectory_filters |
|
||
| 1 | 2019-02-12 | industrial_robot_simulator |
The industrial robot simulator is a stand in for industrial robot driver node(s). It adheres to the driver specification for industrial robot controllers.
The industrial robot simulator is a stand in for industrial robot driver node(s). It adheres to the driver specification for industrial robot controllers.
|
||
| 1 | 2019-02-12 | industrial_robot_client |
industrial robot client contains generic clients for connecting
to industrial robot controllers with servers that adhere to the
simple message protocol.
industrial robot client contains generic clients for connecting
to industrial robot controllers with servers that adhere to the
simple message protocol.
|
||
| 1 | 2019-02-12 | industrial_msgs |
The industrial message package containes industrial specific messages
definitions. This package is part of the ROS-Industrial program.
The industrial message package containes industrial specific messages
definitions. This package is part of the ROS-Industrial program.
|
||
| 1 | 2019-02-12 | industrial_deprecated |
The Industrial deprecated package contains nodes, launch files, etc... that are slated for
deprecation. This package is the last place something will end up before being deleted.
If you are missing a package/node and find it's contents here, then you should consider
a replacement.
The Industrial deprecated package contains nodes, launch files, etc... that are slated for
deprecation. This package is the last place something will end up before being deleted.
If you are missing a package/node and find it's contents here, then you should consider
a replacement.
|
||
| 1 | 2019-02-12 | industrial_core |
ROS-Industrial core stack contains packages and libraries for supporing industrial systems
ROS-Industrial core stack contains packages and libraries for supporing industrial systems
|
||
| 1 | 2019-02-12 | global_planner_tests |
A collection of tests for checking the validity and completeness of global planners.
A collection of tests for checking the validity and completeness of global planners.
|
||
| 2 | 2019-02-12 | dwb_plugins |
Standard implementations of the GoalChecker
and TrajectoryGenerators for dwb_local_planner
Standard implementations of the GoalChecker
and TrajectoryGenerators for dwb_local_planner
|
||
| 2 | 2019-02-12 | dwb_msgs |
Message/Service definitions specifically for the dwb_local_planner
Message/Service definitions specifically for the dwb_local_planner
|
||
| 1 | 2019-02-12 | dwb_local_planner |
Plugin based local planner implementing the nav_core2::LocalPlanner interface.
Plugin based local planner implementing the nav_core2::LocalPlanner interface.
|
||
| 2 | 2019-02-12 | dwb_critics |
Implementations for dwb_local_planner TrajectoryCritic interface
Implementations for dwb_local_planner TrajectoryCritic interface
|
||
| 1 | 2019-02-12 | dlux_plugins |
Implementation of dlux_global_planner plugin interfaces.
Implementation of dlux_global_planner plugin interfaces.
|
||
| 1 | 2019-02-12 | dlux_global_planner |
Plugin based global planner implementing the nav_core2::GlobalPlanner interface.
Plugin based global planner implementing the nav_core2::GlobalPlanner interface.
|
||
| 2 | 2019-02-12 | costmap_queue |
Tool for iterating through the cells of a costmap to find the closest distance to a subset of cells.
Tool for iterating through the cells of a costmap to find the closest distance to a subset of cells.
|
||
| 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
|
||
| 1 | 2019-02-08 | open_manipulator_with_tb3_simulations |
Simulation packages for OpenManipulator with TurtleBot3
Simulation packages for OpenManipulator with TurtleBot3
|
||
| 1 | 2019-02-08 | open_manipulator_with_tb3_msgs |
Messages and services package for OpenManipulator with TurtleBot3
Messages and services package for OpenManipulator with TurtleBot3
|
||
| 1 | 2019-02-08 | open_manipulator_with_tb3_gazebo |
Simulation package using gazebo for OpenManipulator with TurtleBot3
Simulation package using gazebo for OpenManipulator with TurtleBot3
|
||
| 1 | 2019-02-08 | bfl |
This package contains a recent version of the Bayesian Filtering
Library (BFL), distributed by the Orocos Project. For stability
reasons, this package is currently locked to revision 31655 (April
19, 2010), but this revision will be updated on a regular basis to
the latest available BFL trunk. This ROS package does not modify
BFL in any way, it simply provides a convenient way to download and
compile the library, because BFL is not available from an OS package
manager. This ROS package compiles BFL with the Boost library for
matrix operations and random number generation.
This package contains a recent version of the Bayesian Filtering
Library (BFL), distributed by the Orocos Project. For stability
reasons, this package is currently locked to revision 31655 (April
19, 2010), but this revision will be updated on a regular basis to
the latest available BFL trunk. This ROS package does not modify
BFL in any way, it simply provides a convenient way to download and
compile the library, because BFL is not available from an OS package
manager. This ROS package compiles BFL with the Boost library for
matrix operations and random number generation.
|
||
| 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 | 2019-02-07 | open_manipulator_simulations |
Simulation packages for OpenManipulator
Simulation packages for OpenManipulator
|
||
| 1 | 2019-02-07 | open_manipulator_msgs |
Messages and services package for OpenManipulator to send information about state or pose
Messages and services package for OpenManipulator to send information about state or pose
|
||
| 1 | 2019-02-07 | open_manipulator_gazebo |
Gazebo configurations package for OpenManipulator
Gazebo configurations package for OpenManipulator
|
||
| 1 | 2019-02-07 | laser_geometry |
This package contains a class for converting from a 2D laser scan as defined by
sensor_msgs/LaserScan into a point cloud as defined by sensor_msgs/PointCloud
or sensor_msgs/PointCloud2. In particular, it contains functionality to account
for the skew resulting from moving robots or tilting laser scanners.
This package contains a class for converting from a 2D laser scan as defined by
sensor_msgs/LaserScan into a point cloud as defined by sensor_msgs/PointCloud
or sensor_msgs/PointCloud2. In particular, it contains functionality to account
for the skew resulting from moving robots or tilting laser scanners.
|
||
| 2 | 2019-02-07 | depthimage_to_laserscan |
depthimage_to_laserscan
depthimage_to_laserscan
|
||
| 1 | 2019-02-06 | turtlebot3_autorace_detect |
AutoRace ROS packages for feature detection with TurtleBot3 Auto
AutoRace ROS packages for feature detection with TurtleBot3 Auto
|
||
| 1 | 2019-02-06 | turtlebot3_autorace_core |
TurtleBot3 AutoRace ROS package that TurtleBot3 Auto's core
TurtleBot3 AutoRace ROS package that TurtleBot3 Auto's core
|
||
| 1 | 2019-02-06 | turtlebot3_autorace_control |
TurtleBot3 AutoRace ROS package that controls TurtleBot3 Auto
TurtleBot3 AutoRace ROS package that controls TurtleBot3 Auto
|
Packages
| Name | Description | ||||
|---|---|---|---|---|---|
| 1 | 2018-04-02 | desktop_full |
A metapackage to aggregate several packages.
A metapackage to aggregate several packages.
|
||
| 2 | 2018-04-02 | desktop |
A metapackage to aggregate several packages.
A metapackage to aggregate several packages.
|
||
| 1 | 2018-03-30 | turtle_actionlib |
turtle_actionlib demonstrates how to write an action server and client with the turtlesim. The shape_server provides and action interface for drawing regular polygons with the turtlesim.
turtle_actionlib demonstrates how to write an action server and client with the turtlesim. The shape_server provides and action interface for drawing regular polygons with the turtlesim.
|
||
| 1 | 2018-03-30 | pluginlib_tutorials |
The pluginlib_tutorials package
The pluginlib_tutorials package
|
||
| 1 | 2018-03-30 | nodelet_tutorial_math |
Package for Nodelet tutorial.
Package for Nodelet tutorial.
|
||
| 1 | 2018-03-30 | common_tutorials |
Metapackage that contains common tutorials
Metapackage that contains common tutorials
|
||
| 1 | 2018-03-30 | actionlib_tutorials |
The actionlib_tutorials package
The actionlib_tutorials package
|
||
| 1 | 2018-03-27 | wfov_camera_msgs |
Messages related to the Point Grey camera driver.
Messages related to the Point Grey camera driver.
|
||
| 1 | 2018-03-27 | statistics_msgs |
Messages related to the Point Grey camera driver.
Messages related to the Point Grey camera driver.
|
||
| 1 | 2018-03-27 | pointgrey_camera_driver |
Point Grey camera driver based on libflycapture2.
Point Grey camera driver based on libflycapture2.
|
||
| 1 | 2018-03-27 | pointgrey_camera_description |
URDF descriptions for Point Grey cameras
URDF descriptions for Point Grey cameras
|
||
| 1 | 2018-03-27 | image_exposure_msgs |
Messages related to the Point Grey camera driver.
Messages related to the Point Grey camera driver.
|
||
| 1 | 2018-03-27 | geographic_msgs |
ROS messages for Geographic Information Systems.
ROS messages for Geographic Information Systems.
|
||
| 1 | 2018-03-27 | geographic_info |
Geographic information metapackage.
Not needed for wet packages, use only to resolve dry stack
dependencies.
Geographic information metapackage.
Not needed for wet packages, use only to resolve dry stack
dependencies.
|
||
| 1 | 2018-03-27 | geodesy |
Python and C++ interfaces for manipulating geodetic coordinates.
Python and C++ interfaces for manipulating geodetic coordinates.
|
||
| 2 | 2018-03-06 | rosparam_shortcuts |
Quickly load variables from rosparam with good command line error checking.
Quickly load variables from rosparam with good command line error checking.
|
||
| 2 | 2018-02-22 | rqt_robot_steering |
rqt_robot_steering provides a GUI plugin for steering a robot using Twist messages.
rqt_robot_steering provides a GUI plugin for steering a robot using Twist messages.
|
||
| 1 | 2018-02-19 | mqtt_bridge |
The mqtt_bridge package
The mqtt_bridge package
|
||
| 1 | 2018-02-16 | rosbag_direct_write |
C++ API for (potentially) faster writing of rosbag's using O_DIRECT or F_NOCACHE with memory alignment.
C++ API for (potentially) faster writing of rosbag's using O_DIRECT or F_NOCACHE with memory alignment.
|
||
| 1 | 2018-02-13 | willow_maps |
Holds maps of Willow Garage that can be used for a number of different applications.
Holds maps of Willow Garage that can be used for a number of different applications.
|
||
| 2 | 2018-02-13 | pr2_mechanism_msgs |
This package defines services that are used to communicate with
the realtime control loop. It also defines messages
that represent the state of the realtime controllers, the joints
and the actuators.
This package defines services that are used to communicate with
the realtime control loop. It also defines messages
that represent the state of the realtime controllers, the joints
and the actuators.
|
||
| 2 | 2018-02-13 | pr2_mechanism_model |
|
||
| 2 | 2018-02-13 | pr2_mechanism_diagnostics |
The `pr2_mechanism_diagnostics` node subscribes to `mechanism_statistics` and publishes diagnostics data for joints and controllers on `/diagnostics`.
The `pr2_mechanism_diagnostics` node subscribes to `mechanism_statistics` and publishes diagnostics data for joints and controllers on `/diagnostics`.
|
||
| 2 | 2018-02-13 | pr2_mechanism |
The pr2_mechanism stack contains the infrastructure to control the PR2 robot in a hard realtime control loop.
The pr2_mechanism stack contains the infrastructure to control the PR2 robot in a hard realtime control loop.
|
||
| 2 | 2018-02-13 | pr2_hardware_interface |
This package contains the C++ interfaces to the PR2 hardware
components that are controlled over EtherCAT. This includes the
motors and encoders needed to control the PR2 mechanism, as well as
components like the pressure sensors in the fingertips, camera
triggers, etc... All of the hardware components in this interface are
directly available to the controllers inside the hard realtime
control loop.
This package contains the C++ interfaces to the PR2 hardware
components that are controlled over EtherCAT. This includes the
motors and encoders needed to control the PR2 mechanism, as well as
components like the pressure sensors in the fingertips, camera
triggers, etc... All of the hardware components in this interface are
directly available to the controllers inside the hard realtime
control loop.
|
||
| 2 | 2018-02-13 | 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 | 2018-02-13 | 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
|
||
| 1 | 2018-02-07 | angles |
This package provides a set of simple math utilities to work
with angles. The utilities cover simple things like
normalizing an angle and conversion between degrees and
radians. But even if you're trying to calculate things like
the shortest angular distance between two joint space
positions of your robot, but the joint motion is constrained
by joint limits, this package is what you need. The code in
this package is stable and well tested. There are no plans for
major changes in the near future.
This package provides a set of simple math utilities to work
with angles. The utilities cover simple things like
normalizing an angle and conversion between degrees and
radians. But even if you're trying to calculate things like
the shortest angular distance between two joint space
positions of your robot, but the joint motion is constrained
by joint limits, this package is what you need. The code in
this package is stable and well tested. There are no plans for
major changes in the near future.
|
||
| 1 | 2018-02-02 | dynpick_driver |
Driver package for Wacohtech dynpick force sensor. This contains
Driver package for Wacohtech dynpick force sensor. This contains
|
||
| 1 | 2018-01-31 | velodyne_gazebo_plugin |
Gazebo plugin to provide simulated data from Velodyne laser scanners.
Gazebo plugin to provide simulated data from Velodyne laser scanners.
|
||
| 1 | 2018-01-31 | velo2cam_gazebo |
Metapackage allowing easy installation of velo2cam_gazebo components.
Metapackage allowing easy installation of velo2cam_gazebo components.
|
||
| 1 | 2018-01-23 | uuid_msgs |
ROS messages for universally unique identifiers.
ROS messages for universally unique identifiers.
|
||
| 1 | 2018-01-23 | unique_identifier |
ROS messages and interfaces for universally unique identifiers.
Not needed for wet packages, use only to resolve dry stack
dependencies.
ROS messages and interfaces for universally unique identifiers.
Not needed for wet packages, use only to resolve dry stack
dependencies.
|
||
| 1 | 2018-01-23 | unique_id |
ROS Python and C++ interfaces for universally unique identifiers.
ROS Python and C++ interfaces for universally unique identifiers.
|
||
| 1 | 2018-01-23 | slam_gmapping |
slam_gmapping contains a wrapper around gmapping which provides SLAM capabilities.
slam_gmapping contains a wrapper around gmapping which provides SLAM capabilities.
|
||
| 1 | 2018-01-23 | gmapping |
This package contains a ROS wrapper for OpenSlam's Gmapping.
The gmapping package provides laser-based SLAM (Simultaneous Localization and Mapping),
as a ROS node called slam_gmapping. Using slam_gmapping, you can create a 2-D occupancy
grid map (like a building floorplan) from laser and pose data collected by a mobile robot.
This package contains a ROS wrapper for OpenSlam's Gmapping.
The gmapping package provides laser-based SLAM (Simultaneous Localization and Mapping),
as a ROS node called slam_gmapping. Using slam_gmapping, you can create a 2-D occupancy
grid map (like a building floorplan) from laser and pose data collected by a mobile robot.
|
||
| 1 | 2017-12-16 | multirobot_map_merge |
Merging multiple maps without knowledge of initial
positions of robots.
Merging multiple maps without knowledge of initial
positions of robots.
|
||
| 1 | 2017-12-16 | explore_lite |
Lightweight frontier-based exploration.
Lightweight frontier-based exploration.
|
||
| 2 | 2017-12-14 | zbar_ros |
Lightweight ROS wrapper for Zbar barcode/qrcode reader library (http://zbar.sourceforge
.net/)
Lightweight ROS wrapper for Zbar barcode/qrcode reader library (http://zbar.sourceforge
.net/)
|
||
| 1 | 2017-12-07 | nmea_msgs |
The nmea_msgs package contains messages related to data in the NMEA format.
The nmea_msgs package contains messages related to data in the NMEA format.
|
||
| 1 | 2017-12-06 | test_osm |
These are regression tests for the osm_cartography and
route_network packages. They are packaged separately to avoid
unnecessary implementation dependencies.
These are regression tests for the osm_cartography and
route_network packages. They are packaged separately to avoid
unnecessary implementation dependencies.
|
||
| 1 | 2017-12-06 | route_network |
Route network graphing and path planning.
Route network graphing and path planning.
|
||
| 1 | 2017-12-06 | osm_cartography |
Geographic mapping using Open Street Map data.
Geographic mapping using Open Street Map data.
|
||
| 2 | 2017-11-29 | vrpn_client_ros |
ROS client nodes for the
ROS client nodes for the
|
||
| 1 | 2017-11-29 | auv_msgs |
This package provides message types commonly used with Autonomous Underwater Vehicles
This package provides message types commonly used with Autonomous Underwater Vehicles
|
||
| 1 | 2017-11-23 | urdf_geometry_parser |
Extract geometry value of a vehicle from urdf
Extract geometry value of a vehicle from urdf
|
||
| 1 | 2017-11-20 | tf2_web_republisher |
Republishing of Selected TFs
Republishing of Selected TFs
|
||
| 1 | 2017-11-15 | robot_model |
|
||
| 1 | 2017-11-14 | vision_msgs |
Messages for interfacing with various computer vision pipelines, such as
object detectors.
Messages for interfacing with various computer vision pipelines, such as
object detectors.
|
||
| 1 | 2017-11-07 | find_object_2d |
The find_object_2d package
The find_object_2d package
|
Packages
| Name | Description | ||||
|---|---|---|---|---|---|
| 2 | 2019-04-03 | pr2_calibration_launch |
Launch files and configuration files needed to run the calibration pipeline on PR2. This package is
still experimental. Expect large changes tp occur.
Launch files and configuration files needed to run the calibration pipeline on PR2. This package is
still experimental. Expect large changes tp occur.
|
||
| 2 | 2019-04-03 | pr2_calibration |
The pr2_calibration package
The pr2_calibration package
|
||
| 1 | 2019-04-03 | multisense_ros |
multisense_ros
multisense_ros
|
||
| 1 | 2019-04-03 | multisense_lib |
multisense_lib
multisense_lib
|
||
| 1 | 2019-04-03 | multisense_description |
multisense_description
multisense_description
|
||
| 1 | 2019-04-03 | multisense_cal_check |
multisense_cal_check
multisense_cal_check
|
||
| 1 | 2019-04-03 | multisense_bringup |
multisense_bringup
multisense_bringup
|
||
| 1 | 2019-04-03 | multisense |
multisense catkin driver
multisense catkin driver
|
||
| 1 | 2019-04-03 | moveit_resources |
Resources used for MoveIt! testing
Resources used for MoveIt! testing
|
||
| 2 | 2019-04-03 | laser_joint_projector |
Projects laser readings into a point cloud, based on a set of recorded joint angles
This package is experimental and unstable.
Expect its APIs to change.
Projects laser readings into a point cloud, based on a set of recorded joint angles
This package is experimental and unstable.
Expect its APIs to change.
|
||
| 2 | 2019-04-03 | laser_joint_processor |
Computes joint angles associated with a specific set of detected checkerboard corners.
This package is experimental and unstable.
Expect its APIs to change.
Computes joint angles associated with a specific set of detected checkerboard corners.
This package is experimental and unstable.
Expect its APIs to change.
|
||
| 2 | 2019-04-03 | dense_laser_assembler |
Stores streaming data from a laser sensor in a
dense representation. This allows the user to do 'image-like'
processing on the data, and can also be used for very fast approx
neighborhood searches. This package is still experimental and unstable.
Expect its APIs to change.
Stores streaming data from a laser sensor in a
dense representation. This allows the user to do 'image-like'
processing on the data, and can also be used for very fast approx
neighborhood searches. This package is still experimental and unstable.
Expect its APIs to change.
|
||
| 1 | 2019-04-03 | cpp_common |
cpp_common contains C++ code for doing things that are not necessarily ROS
related, but are useful for multiple packages. This includes things like
the ROS_DEPRECATED and ROS_FORCE_INLINE macros, as well as code for getting
backtraces.
This package is a component of
cpp_common contains C++ code for doing things that are not necessarily ROS
related, but are useful for multiple packages. This includes things like
the ROS_DEPRECATED and ROS_FORCE_INLINE macros, as well as code for getting
backtraces.
This package is a component of
|
||
| 1 | 2019-04-03 | codec_image_transport |
The codec_image_transport package
The codec_image_transport package
|
||
| 1 | 2019-04-02 | roseus_tutorials |
roseus_tutorials
roseus_tutorials
|
||
| 1 | 2019-04-02 | roseus_smach |
roseus_smach
* Euslisp state machine class. it will be moved.
* Message publisher for visualizing current state by smach_viewer.
* Simple pickle dump script for debugging state machine.
* Execute state machine as a action server.
roseus_smach
* Euslisp state machine class. it will be moved.
* Message publisher for visualizing current state by smach_viewer.
* Simple pickle dump script for debugging state machine.
* Execute state machine as a action server.
|
||
| 1 | 2019-04-02 | roseus_mongo |
The roseus_mongo package
The roseus_mongo package
|
||
| 1 | 2019-04-02 | roseus |
EusLisp client for ROS Robot Operating System.
EusLisp client for ROS Robot Operating System.
|
||
| 2 | 2019-04-02 | pr2_run_stop_auto_restart |
This package provides a node that monitors the state of the run stops of the pr2_robot. When the state of the
run stop changes from off to on, this node will automatically enable the power to the motors, and reset
the motors. This allows you to use the run stop as a 'pause' button. By using the run stop as a tool to
power up the robot, the run stop is also in reach of the user once the robot starts moving.
This package provides a node that monitors the state of the run stops of the pr2_robot. When the state of the
run stop changes from off to on, this node will automatically enable the power to the motors, and reset
the motors. This allows you to use the run stop as a 'pause' button. By using the run stop as a tool to
power up the robot, the run stop is also in reach of the user once the robot starts moving.
|
||
| 2 | 2019-04-02 | pr2_robot |
This stack collects PR2-specific components that are used in bringing up
a robot.
This stack collects PR2-specific components that are used in bringing up
a robot.
|
||
| 1 | 2019-04-02 | pr2_navigation_apps |
The pr2_navigation_apps package
The pr2_navigation_apps package
|
||
| 2 | 2019-04-02 | pr2_ethercat |
Main loop that runs the robot.
Main loop that runs the robot.
|
||
| 2 | 2019-04-02 | pr2_controller_configuration |
Configuration files for PR2 controllers.
Configuration files for PR2 controllers.
|
||
| 2 | 2019-04-02 | pr2_computer_monitor |
Monitors the computer's processor and hard drives of the PR2 and publishes data to diagnostics.
Monitors the computer's processor and hard drives of the PR2 and publishes data to diagnostics.
|
||
| 2 | 2019-04-02 | pr2_camera_synchronizer |
|
||
| 2 | 2019-04-02 | pr2_bringup |
Launch files and scripts needed to bring a PR2 up into a running state.
Launch files and scripts needed to bring a PR2 up into a running state.
|
||
| 1 | 2019-04-02 | pr2_2dnav_slam |
This application allows the PR2 to navigate autonomously while also building a map of its environment as it drives along.
This application allows the PR2 to navigate autonomously while also building a map of its environment as it drives along.
|
||
| 1 | 2019-04-02 | pr2_2dnav_local |
This application allows the PR2 to navigate autonomously in an odometric frame.
This application allows the PR2 to navigate autonomously in an odometric frame.
|
||
| 1 | 2019-04-02 | pr2_2dnav |
This application allows the PR2 robot to navigate autonomously with a pre-specified static map.
This application allows the PR2 robot to navigate autonomously with a pre-specified static map.
|
||
| 1 | 2019-04-02 | localizer_dwm1001 |
The localizer_dwm1001 package
The localizer_dwm1001 package
|
||
| 1 | 2019-04-02 | jsk_roseus |
|
||
| 2 | 2019-04-02 | imu_monitor |
This package contains a single node that monitors the drift of the IMU
gyroscopes. The results are published to the '/diagnostics' topic and
are aggregated in the PR2 dashboard.
This package contains a single node that monitors the drift of the IMU
gyroscopes. The results are published to the '/diagnostics' topic and
are aggregated in the PR2 dashboard.
|
||
| 2 | 2019-04-01 | mrpt_bridge |
C++ library to convert between ROS messages and MRPT classes
C++ library to convert between ROS messages and MRPT classes
|
||
| 1 | 2019-04-01 | hls_lfom_tof_driver |
ROS package for HLDS(Hitachi-LG Data Storage,Inc.) HLS-LFOM 3D LiDAR(TOF)
ROS package for HLDS(Hitachi-LG Data Storage,Inc.) HLS-LFOM 3D LiDAR(TOF)
|
||
| 1 | 2019-04-01 | dataspeed_pds_scripts |
Test scripts to interface to the Dataspeed Inc. Power Distribution System (PDS)
Test scripts to interface to the Dataspeed Inc. Power Distribution System (PDS)
|
||
| 1 | 2019-04-01 | dataspeed_pds_rqt |
ROS rqt GUI for the Dataspeed Inc. Power Distribution System (PDS)
ROS rqt GUI for the Dataspeed Inc. Power Distribution System (PDS)
|
||
| 1 | 2019-04-01 | dataspeed_pds_msgs |
Messages for the Dataspeed Inc. Power Distribution System (PDS)
Messages for the Dataspeed Inc. Power Distribution System (PDS)
|
||
| 1 | 2019-04-01 | dataspeed_pds_lcm |
Interface to the Dataspeed Inc. Power Distribution System (PDS) via CAN
Interface to the Dataspeed Inc. Power Distribution System (PDS) via CAN
|
||
| 1 | 2019-04-01 | dataspeed_pds_can |
Interface to the Dataspeed Inc. Power Distribution System (PDS) via CAN
Interface to the Dataspeed Inc. Power Distribution System (PDS) via CAN
|
||
| 1 | 2019-04-01 | dataspeed_pds |
Interface to the Dataspeed Inc. Power Distribution System (PDS)
Interface to the Dataspeed Inc. Power Distribution System (PDS)
|
||
| 1 | 2019-04-01 | app_manager |
app_manager
app_manager
|
||
| 1 | 2019-03-31 | roboteq_diff_msgs |
The roboteq_diff_msgs package
The roboteq_diff_msgs package
|
||
| 1 | 2019-03-31 | roboteq_diff_driver |
The roboteq_diff_driver package
The roboteq_diff_driver package
|
||
| 1 | 2019-03-31 | pr2_trajectory_execution_tests |
pr2_trajectory_execution_tests
pr2_trajectory_execution_tests
|
||
| 1 | 2019-03-31 | pr2_test_sbpl_planner |
pr2_test_sbpl_planner
pr2_test_sbpl_planner
|
||
| 1 | 2019-03-31 | pr2_test_kinematic_constraints |
pr2_test_kinematic_constraints
pr2_test_kinematic_constraints
|
||
| 1 | 2019-03-31 | pr2_test_collision_distance_field |
pr2_test_collision_distance_field
pr2_test_collision_distance_field
|
||
| 1 | 2019-03-31 | pr2_test_collision_detection |
pr2_test_collision_detection
pr2_test_collision_detection
|
||
| 1 | 2019-03-31 | pr2_test_chomp_planner |
pr2_test_chomp_planner
pr2_test_chomp_planner
|
||
| 1 | 2019-03-31 | pr2_simple_benchmark_test |
pr2_simple_benchmark_test
pr2_simple_benchmark_test
|
Packages
| Name | Description | ||||
|---|---|---|---|---|---|
| 1 | 2018-10-19 | marti_can_msgs |
marti_can_msgs
marti_can_msgs
|
||
| 1 | 2018-10-19 | class_loader |
The class_loader package is a ROS-independent package for loading plugins during runtime and the foundation of the higher level ROS "pluginlib" library. class_loader utilizes the host operating system's runtime loader to open runtime libraries (e.g. .so/.dll files), introspect the library for exported plugin classes, and allows users to instantiate objects of said exported classes without the explicit declaration (i.e. header file) for those classes.
The class_loader package is a ROS-independent package for loading plugins during runtime and the foundation of the higher level ROS "pluginlib" library. class_loader utilizes the host operating system's runtime loader to open runtime libraries (e.g. .so/.dll files), introspect the library for exported plugin classes, and allows users to instantiate objects of said exported classes without the explicit declaration (i.e. header file) for those classes.
|
||
| 1 | 2018-10-18 | bta_tof_driver |
The BTA ROS driver
The BTA ROS driver
|
||
| 1 | 2018-10-16 | slime_wrapper |
ROS wrapper for slime
ROS wrapper for slime
|
||
| 1 | 2018-10-16 | slime_ros |
Extensions for slime to assist in working with ROS packages
Extensions for slime to assist in working with ROS packages
|
||
| 2 | 2018-10-16 | roslisp_repl |
This package provides a script that launches Emacs with Slime (the
Superior Lisp Interaction Mode) ready for Lisp development and
roslisp.
This package provides a script that launches Emacs with Slime (the
Superior Lisp Interaction Mode) ready for Lisp development and
roslisp.
|
||
| 1 | 2018-10-16 | rosemacs |
ROS tools for those who live in Emacs.
ROS tools for those who live in Emacs.
|
||
| 1 | 2018-10-16 | ros_emacs_utils |
A metapackage of Emacs utils for ROS.
Only there for simplifying the release process.
A metapackage of Emacs utils for ROS.
Only there for simplifying the release process.
|
||
| 1 | 2018-10-16 | robodyn_utilities |
The robodyn_utilities package
The robodyn_utilities package
|
||
| 1 | 2018-10-16 | robodyn_ros |
The ros implementation of robodyn
The ros implementation of robodyn
|
||
| 1 | 2018-10-16 | robodyn_controllers |
The robodyn_controllers package
The robodyn_controllers package
|
||
| 1 | 2018-10-16 | iss_taskboard_gazebo |
The iss_taskboard_gazebo package
The iss_taskboard_gazebo package
|
||
| 1 | 2018-10-15 | roslisp |
Lisp client library for ROS, the Robot Operating System.
Lisp client library for ROS, the Robot Operating System.
|
||
| 1 | 2018-10-15 | robot_instance |
The robot_instance package
The robot_instance package
|
||
| 1 | 2018-10-15 | r2_supervisors_control |
The r2_supervisors_control package
The r2_supervisors_control package
|
||
| 1 | 2018-10-15 | r2_gazebo_gripper |
The r2_gazebo_gripper package
The r2_gazebo_gripper package
|
||
| 2 | 2018-10-15 | r2_gazebo |
The r2_gazebo package
The r2_gazebo package
|
||
| 2 | 2018-10-15 | r2_description |
The r2_description package
The r2_description package
|
||
| 1 | 2018-10-15 | fsm_utils |
fsm_utils package
fsm_utils package
|
||
| 2 | 2018-10-12 | async_web_server_cpp |
Asynchronous Web/WebSocket Server in C++
Asynchronous Web/WebSocket Server in C++
|
||
| 1 | 2018-10-10 | swri_console |
A rosout GUI viewer developed at Southwest Research Insititute as an
alternative to rqt_console.
A rosout GUI viewer developed at Southwest Research Insititute as an
alternative to rqt_console.
|
||
| 1 | 2018-10-10 | robodyn_mechanisms |
The robodyn_mechanisms package
The robodyn_mechanisms package
|
||
| 1 | 2018-10-10 | r2_upperbody_moveit_config |
An automatically generated package with all the configuration and launch files for using the r2 with the MoveIt Motion Planning Framework
An automatically generated package with all the configuration and launch files for using the r2 with the MoveIt Motion Planning Framework
|
||
| 2 | 2018-10-10 | r2_msgs |
The r2_msgs package
The r2_msgs package
|
||
| 1 | 2018-10-10 | hayai |
The hayai catkin package
The hayai catkin package
|
||
| 1 | 2018-10-09 | test_bond |
Contains tests for [[bond]], including tests for [[bondpy]] and [[bondcpp]].
Contains tests for [[bond]], including tests for [[bondpy]] and [[bondcpp]].
|
||
| 1 | 2018-10-09 | smclib |
The State Machine Compiler (SMC) from http://smc.sourceforge.net/
converts a language-independent description of a state machine
into the source code to support that state machine.
This package contains the libraries that a compiled state machine
depends on, but it does not contain the compiler itself.
The State Machine Compiler (SMC) from http://smc.sourceforge.net/
converts a language-independent description of a state machine
into the source code to support that state machine.
This package contains the libraries that a compiled state machine
depends on, but it does not contain the compiler itself.
|
||
| 1 | 2018-10-09 | bondpy |
Python implementation of bond, a mechanism for checking when
another process has terminated.
Python implementation of bond, a mechanism for checking when
another process has terminated.
|
||
| 1 | 2018-10-09 | bondcpp |
C++ implementation of bond, a mechanism for checking when
another process has terminated.
C++ implementation of bond, a mechanism for checking when
another process has terminated.
|
||
| 1 | 2018-10-09 | bond_core |
A bond allows two processes, A and B, to know when the other has
terminated, either cleanly or by crashing. The bond remains
connected until it is either broken explicitly or until a
heartbeat times out.
A bond allows two processes, A and B, to know when the other has
terminated, either cleanly or by crashing. The bond remains
connected until it is either broken explicitly or until a
heartbeat times out.
|
||
| 1 | 2018-10-09 | bond |
A bond allows two processes, A and B, to know when the other has
terminated, either cleanly or by crashing. The bond remains
connected until it is either broken explicitly or until a
heartbeat times out.
A bond allows two processes, A and B, to know when the other has
terminated, either cleanly or by crashing. The bond remains
connected until it is either broken explicitly or until a
heartbeat times out.
|
||
| 1 | 2018-10-08 | raspicam_node |
Package to access the Raspberry Pi Camera from ROS.
Package to access the Raspberry Pi Camera from ROS.
|
||
| 1 | 2018-10-07 | flatbuffers |
Google flatbuffers.
Google flatbuffers.
|
||
| 1 | 2018-10-04 | radar_msgs |
Generic Radar Messages
Generic Radar Messages
|
||
| 1 | 2018-10-04 | pacmod_msgs |
Message definition files for the PACMod driver
Message definition files for the PACMod driver
|
||
| 1 | 2018-10-04 | neobotix_usboard_msgs |
neobotix_usboard package
neobotix_usboard package
|
||
| 1 | 2018-10-04 | mobileye_560_660_msgs |
Message definitions for the Mobileye 560/660
Message definitions for the Mobileye 560/660
|
||
| 1 | 2018-10-04 | kartech_linear_actuator_msgs |
The kartech_linear_actuator_msgs package
The kartech_linear_actuator_msgs package
|
||
| 1 | 2018-10-04 | ibeo_msgs |
Package containing messages for Ibeo sensors.
Package containing messages for Ibeo sensors.
|
||
| 1 | 2018-10-04 | derived_object_msgs |
Abstracted Messages from Perception Modalities
Abstracted Messages from Perception Modalities
|
||
| 1 | 2018-10-04 | delphi_srr_msgs |
Message definitions for the Delphi SRR
Message definitions for the Delphi SRR
|
||
| 1 | 2018-10-04 | delphi_mrr_msgs |
Message definitions for the Delphi MRR
Message definitions for the Delphi MRR
|
||
| 1 | 2018-10-04 | delphi_esr_msgs |
Message definitions for the Delphi ESR
Message definitions for the Delphi ESR
|
||
| 1 | 2018-10-04 | astuff_sensor_msgs |
Messages specific to AStuff-provided sensors.
Messages specific to AStuff-provided sensors.
|
||
| 1 | 2018-10-03 | gazebo_ros_pkgs |
Interface for using ROS with the
Interface for using ROS with the
|
||
| 1 | 2018-10-03 | gazebo_ros_control |
gazebo_ros_control
gazebo_ros_control
|
||
| 1 | 2018-10-03 | gazebo_ros |
Provides ROS plugins that offer message and service publishers for interfacing with
Provides ROS plugins that offer message and service publishers for interfacing with
|
||
| 1 | 2018-10-03 | gazebo_plugins |
Robot-independent Gazebo plugins for sensors, motors and dynamic reconfigurable components.
Robot-independent Gazebo plugins for sensors, motors and dynamic reconfigurable components.
|
||
| 1 | 2018-10-03 | gazebo_msgs |
Message and service data structures for interacting with Gazebo from ROS.
Message and service data structures for interacting with Gazebo from ROS.
|
||
| 1 | 2018-10-02 | pioneer_bringup |
pioneer_bringup provides roslaunch scripts for starting the core functionnalities of Adept MobileRobots Pioneer and Pioneer-compatible robots (Including Pioneer 2, Pioneer 3, Pioneer LX, AmigoBot, PeopleBot, PatrolBot, PowerBot, Seekur and Seekur Jr.)
pioneer_bringup provides roslaunch scripts for starting the core functionnalities of Adept MobileRobots Pioneer and Pioneer-compatible robots (Including Pioneer 2, Pioneer 3, Pioneer LX, AmigoBot, PeopleBot, PatrolBot, PowerBot, Seekur and Seekur Jr.)
|
Packages
Packages
| Name | Description | ||||
|---|---|---|---|---|---|
| 1 | 2017-04-24 | master_sync_fkie |
Synchronize the local ROS master to the remote masters
discovered by master_discovery_fkie node. The registration
of topics and services is only perform by local ROS master.
Synchronize the local ROS master to the remote masters
discovered by master_discovery_fkie node. The registration
of topics and services is only perform by local ROS master.
|
||
| 1 | 2017-04-24 | master_discovery_fkie |
Discover the running ROS Masters in local network. The
discovering is done by sending an echo heartbeat messages to a defined
multicast group.
The alternative is to use a zeroconf/avahi daemon to register the ROS
master as service and discover other ROS masters.
Discover the running ROS Masters in local network. The
discovering is done by sending an echo heartbeat messages to a defined
multicast group.
The alternative is to use a zeroconf/avahi daemon to register the ROS
master as service and discover other ROS masters.
|
||
| 1 | 2017-04-24 | default_cfg_fkie |
The configuration node loads a given launch configuration and offers services to
list or start the contained nodes. It provides additional description
extracted from launch file. This is used by node_manager_fkie.
The configuration node loads a given launch configuration and offers services to
list or start the contained nodes. It provides additional description
extracted from launch file. This is used by node_manager_fkie.
|
||
| 2 | 2017-04-23 | pyros_interfaces_ros |
Dynamic ROS interface for Pyros
Dynamic ROS interface for Pyros
|
||
| 2 | 2017-04-19 | pyros_common |
Common interfaces packages for Pyros framework
Common interfaces packages for Pyros framework
|
||
| 1 | 2017-04-14 | webkit_dependency |
This encapsulates the WebKit dependency for a specific ROS distribution and its Qt version
This encapsulates the WebKit dependency for a specific ROS distribution and its Qt version
|
||
| 1 | 2017-04-10 | rplidar_python |
The rplidar_python package
The rplidar_python 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-04-10 | leg_detector |
Leg Detector using a machine learning approach to find leg-like patterns of laser scanner readings.
Leg Detector using a machine learning approach to find leg-like patterns of laser scanner readings.
|
||
| 1 | 2017-04-10 | face_detector |
Face detection in images.
Face detection in images.
|
||
| 1 | 2017-04-04 | rqt_launchtree |
An RQT plugin for hierarchical launchfile configuration introspection.
An RQT plugin for hierarchical launchfile configuration introspection.
|
||
| 1 | 2017-03-28 | romeo_sensors_py |
Package that adds the depth camera to Romeo
Package that adds the depth camera to Romeo
|
||
| 1 | 2017-03-28 | romeo_robot |
The romeo_robot metapackage
The romeo_robot metapackage
|
||
| 1 | 2017-03-28 | romeo_description |
The romeo_description package
The romeo_description package
|
||
| 1 | 2017-03-28 | romeo_bringup |
The romeo_bringup package
contains launch and configuration files required to bring ROS interfaces for Romeo up into a running state.
The romeo_bringup package
contains launch and configuration files required to bring ROS interfaces for Romeo up into a running state.
|
||
| 1 | 2017-03-28 | robot_localization |
The robot_localization package provides nonlinear state estimation through sensor fusion of an abritrary number of sensors.
The robot_localization package provides nonlinear state estimation through sensor fusion of an abritrary number of sensors.
|
||
| 1 | 2017-03-28 | nav2d_tutorials |
Contains a set of tutorials that run 2D-Navigation within Stage-Simulator.
Contains a set of tutorials that run 2D-Navigation within Stage-Simulator.
|
||
| 1 | 2017-03-28 | nav2d_remote |
This package is used to manually control a robot that uses the operator and
navigator node from navigation_2d. Currently there is one node to control one
robot with a joystick and one to control multiple robots in simulation.
It can send commands directly to the operator or start and stop navigator actions.
This package is used to manually control a robot that uses the operator and
navigator node from navigation_2d. Currently there is one node to control one
robot with a joystick and one to control multiple robots in simulation.
It can send commands directly to the operator or start and stop navigator actions.
|
||
| 1 | 2017-03-28 | nav2d_operator |
The operator is a lightweight, purely reactive obstacle-avoidance
module for mobile robots moving in a planar environment. The operator node
works by evaluating a set of predefined motion primitives based on a local
costmap and a desired direction. The best evaluated motion command will be
send to the mobile base.
The operator is a lightweight, purely reactive obstacle-avoidance
module for mobile robots moving in a planar environment. The operator node
works by evaluating a set of predefined motion primitives based on a local
costmap and a desired direction. The best evaluated motion command will be
send to the mobile base.
|
||
| 1 | 2017-03-28 | nav2d_navigator |
This package provides a node for higher level navigation of a mobile
robot in a planar environment. It needs a map and the robot's position
within this map to create a plan for navigation. When used together with
a SLAM module it can also be used to perform autonomous exploration of
the robot's workspace.
This package provides a node for higher level navigation of a mobile
robot in a planar environment. It needs a map and the robot's position
within this map to create a plan for navigation. When used together with
a SLAM module it can also be used to perform autonomous exploration of
the robot's workspace.
|
||
| 1 | 2017-03-28 | nav2d_msgs |
Messages used for 2D-Navigation.
Messages used for 2D-Navigation.
|
||
| 1 | 2017-03-28 | nav2d_localizer |
Wrapper around Particle Filter implementation.
The SelfLocalizer can be used as library or as a ros-node.
Wrapper around Particle Filter implementation.
The SelfLocalizer can be used as library or as a ros-node.
|
||
| 1 | 2017-03-28 | nav2d_karto |
Graph-based Simultaneous Localization and Mapping module.
Includes OpenKarto GraphSLAM library by "SRI International".
Graph-based Simultaneous Localization and Mapping module.
Includes OpenKarto GraphSLAM library by "SRI International".
|
||
| 1 | 2017-03-28 | nav2d_exploration |
This package holds a collection of plugins for the RobotNavigator, that provide
different cooperative exploration strategies for a team of mobile robots.
This package holds a collection of plugins for the RobotNavigator, that provide
different cooperative exploration strategies for a team of mobile robots.
|
||
| 1 | 2017-03-28 | nav2d |
Meta-Package containing modules for 2D-Navigation
Meta-Package containing modules for 2D-Navigation
|
||
| 1 | 2017-03-28 | eigen_stl_containers |
This package provides a set of typedef's that allow
using Eigen datatypes in STL containers
This package provides a set of typedef's that allow
using Eigen datatypes in STL containers
|
||
| 2 | 2017-03-27 | 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 | 2017-03-25 | multirobot_map_merge |
Merging multiple maps without knowledge of initial
positions of robots.
Merging multiple maps without knowledge of initial
positions of robots.
|
||
| 1 | 2017-03-25 | explore_lite |
Lightweight frontier-based exploration.
Lightweight frontier-based exploration.
|
||
| 2 | 2017-03-23 | pyros_utils |
Miscellaneous tools for pyROS
Miscellaneous tools for pyROS
|
||
| 2 | 2017-03-22 | webtest |
Wraps any WSGI application and makes it easy to send test requests to that application, without starting up an HTTP server. http://webtest.readthedocs.io/en/latest/
Wraps any WSGI application and makes it easy to send test requests to that application, without starting up an HTTP server. http://webtest.readthedocs.io/en/latest/
|
||
| 2 | 2017-03-22 | catkin_pip |
Catkin macros to allow using pure python packages in usual catkin workspaces with normal python workflow.
Catkin macros to allow using pure python packages in usual catkin workspaces with normal python workflow.
|
||
| 1 | 2017-03-16 | filters |
This library provides a standardized interface for processing data as a sequence
of filters. This package contains a base class upon which to build specific implementations
as well as an interface which dynamically loads filters based on runtime parameters.
This library provides a standardized interface for processing data as a sequence
of filters. This package contains a base class upon which to build specific implementations
as well as an interface which dynamically loads filters based on runtime parameters.
|
||
| 2 | 2017-03-10 | fawkes_msgs |
Messages used by Fawkes to interact with ROS.
Messages used by Fawkes to interact with ROS.
|
||
| 1 | 2017-03-09 | vigir_pluginlib_msgs |
The vigir_pluginlib_msgs package
The vigir_pluginlib_msgs package
|
||
| 1 | 2017-03-09 | vigir_pluginlib_manager |
The vigir_pluginlib_manager package
The vigir_pluginlib_manager package
|
||
| 1 | 2017-03-09 | vigir_pluginlib |
The vigir_pluginlib package
The vigir_pluginlib package
|
||
| 2 | 2017-03-06 | xmlrpcpp |
XmlRpc++ is a C++ implementation of the XML-RPC protocol. This version is
heavily modified from the package available on SourceForge in order to
support roscpp's threading model. As such, we are maintaining our
own fork.
XmlRpc++ is a C++ implementation of the XML-RPC protocol. This version is
heavily modified from the package available on SourceForge in order to
support roscpp's threading model. As such, we are maintaining our
own fork.
|
||
| 2 | 2017-03-06 | topic_tools |
Tools for directing, throttling, selecting, and otherwise messing with
ROS topics at a meta level. None of the programs in this package actually
know about the topics whose streams they are altering; instead, these
tools deal with messages as generic binary blobs. This means they can be
applied to any ROS topic.
Tools for directing, throttling, selecting, and otherwise messing with
ROS topics at a meta level. None of the programs in this package actually
know about the topics whose streams they are altering; instead, these
tools deal with messages as generic binary blobs. This means they can be
applied to any ROS topic.
|
||
| 1 | 2017-03-06 | test_rostopic |
Tests for rostopic.
Tests for rostopic.
|
||
| 2 | 2017-03-06 | test_rosservice |
Tests for the rosservice tool.
Tests for the rosservice tool.
|
||
| 2 | 2017-03-06 | test_rospy |
rospy unit and integration test framework.
rospy unit and integration test framework.
|
||
| 2 | 2017-03-06 | test_rosparam |
A package containing the unit tests for rosparam.
A package containing the unit tests for rosparam.
|
||
| 2 | 2017-03-06 | test_rosmaster |
Tests for rosmaster which depend on rostest.
Tests for rosmaster which depend on rostest.
|
||
| 2 | 2017-03-06 | test_roslib_comm |
Unit tests verifying that roslib is operating as expected.
Unit tests verifying that roslib is operating as expected.
|
||
| 2 | 2017-03-06 | test_roslaunch |
Tests for roslaunch which depend on rostest.
Tests for roslaunch which depend on rostest.
|
||
| 2 | 2017-03-06 | test_rosgraph |
Tests for rosgraph which depend on rostest.
Tests for rosgraph which depend on rostest.
|
Packages
| Name | Description | ||||
|---|---|---|---|---|---|
| 1 | 2015-08-19 | calvin_pick_server |
Server for calvin's PickAndStore action
Server for calvin's PickAndStore action
|
||
| 1 | 2015-08-19 | calvin_pick_n_place |
A pick and place behavior for Calvin.
A pick and place behavior for Calvin.
|
||
| 1 | 2015-08-19 | calvin_msgs |
Messages, services and actions used with calvin
Messages, services and actions used with calvin
|
||
| 1 | 2015-08-19 | calvin_moveit_config |
An automatically generated package with all the configuration and launch files for using the calvin with the MoveIt Motion Planning Framework
An automatically generated package with all the configuration and launch files for using the calvin with the MoveIt Motion Planning Framework
|
||
| 1 | 2015-08-19 | calvin_joint_commander |
A joint commander for the not actively actuated parts of Calvin.
A joint commander for the not actively actuated parts of Calvin.
|
||
| 1 | 2015-08-19 | calvin_gazebo |
Configs and launch files for starting up Calvin in Gazebo.
Configs and launch files for starting up Calvin in Gazebo.
|
||
| 1 | 2015-08-19 | calvin_description |
URDF descriptions of the Calvin robot.
URDF descriptions of the Calvin robot.
|
||
| 1 | 2015-08-19 | calvin_bringup |
Config and launch files to start the Calvin robot's hardware.
Config and launch files to start the Calvin robot's hardware.
|
||
| 1 | 2015-08-06 | test_diagnostic_aggregator |
Basic diagnostic_aggregator tests are in the
Basic diagnostic_aggregator tests are in the
|
||
| 1 | 2015-08-06 | self_test |
self_test
self_test
|
||
| 1 | 2015-08-06 | diagnostics |
diagnostics
diagnostics
|
||
| 1 | 2015-08-06 | diagnostic_updater |
diagnostic_updater contains tools for easily updating diagnostics. it is commonly used in device drivers to keep track of the status of output topics, device status, etc.
diagnostic_updater contains tools for easily updating diagnostics. it is commonly used in device drivers to keep track of the status of output topics, device status, etc.
|
||
| 1 | 2015-08-06 | diagnostic_common_diagnostics |
diagnostic_common_diagnostics
diagnostic_common_diagnostics
|
||
| 1 | 2015-08-06 | diagnostic_analysis |
The diagnostic_analysis package can convert a log of diagnostics data
into a series of CSV files. Robot logs are recorded with rosbag, and
can be processed offline using the scripts in this package.
The diagnostic_analysis package can convert a log of diagnostics data
into a series of CSV files. Robot logs are recorded with rosbag, and
can be processed offline using the scripts in this package.
|
||
| 1 | 2015-08-06 | diagnostic_aggregator |
diagnostic_aggregator
diagnostic_aggregator
|
||
| 1 | 2015-08-05 | actionlib |
The actionlib stack provides a standardized interface for
interfacing with preemptable tasks. Examples of this include moving
the base to a target location, performing a laser scan and returning
the resulting point cloud, detecting the handle of a door, etc.
The actionlib stack provides a standardized interface for
interfacing with preemptable tasks. Examples of this include moving
the base to a target location, performing a laser scan and returning
the resulting point cloud, detecting the handle of a door, etc.
|
||
| 1 | 2015-08-04 | staubli_rx160_support |
|
||
| 1 | 2015-08-04 | staubli_rx160_moveit_plugins |
|
||
| 1 | 2015-08-04 | staubli_rx160_moveit_config |
|
||
| 1 | 2015-08-04 | staubli_resources |
|
||
| 1 | 2015-08-04 | staubli |
ROS-Industrial support for Staubli manipulators (metapackage).
ROS-Industrial support for Staubli manipulators (metapackage).
|
||
| 1 | 2015-07-31 | ubiquity_motor |
Provides a ROS interface to Ubiquity Robotics motor controllers
Provides a ROS interface to Ubiquity Robotics motor controllers
|
||
| 1 | 2015-07-30 | phantomx_gazebo |
Provides Gazebo plugins to expose phantomx model to ROS
Provides Gazebo plugins to expose phantomx model to ROS
|
||
| 1 | 2015-07-29 | phantomx_description |
Describes Phantom X robot model for Gazebo
Describes Phantom X robot model for Gazebo
|
||
| 1 | 2015-07-29 | phantomx_control |
The phantomx_control package
The phantomx_control package
|
||
| 1 | 2015-07-21 | 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 | 2015-07-21 | 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 | 2015-07-21 | rtt_tf |
This package contains the components of the rtt_tf package
This package contains the components of the rtt_tf package
|
||
| 1 | 2015-07-21 | 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 | 2015-07-21 | 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 | 2015-07-21 | 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 | 2015-07-21 | 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 | 2015-07-21 | 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 | 2015-07-21 | 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 | 2015-07-21 | rtt_rospack_tests |
The rtt_ros_tests package
The rtt_ros_tests package
|
||
| 1 | 2015-07-21 | 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 | 2015-07-21 | 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 | 2015-07-21 | 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 | 2015-07-21 | 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 | 2015-07-21 | rtt_roscomm_tests |
The rtt_roscomm_tests package
The rtt_roscomm_tests package
|
||
| 1 | 2015-07-21 | 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 | 2015-07-21 | 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 | 2015-07-21 | rtt_rosbuild_tests |
rtt_ros_rosbuild_test
rtt_ros_rosbuild_test
|
||
| 1 | 2015-07-21 | rtt_ros_tests |
The rtt_ros_tests package
The rtt_ros_tests package
|
||
| 1 | 2015-07-21 | rtt_ros_msgs |
This package provides .msg and .srv files for use with the rtt_ros_integration packages.
This package provides .msg and .srv files for use with the rtt_ros_integration packages.
|
||
| 1 | 2015-07-21 | rtt_ros_integration |
This stack contains all software necessary to build systems using both Orocos and ROS infrastructures
This stack contains all software necessary to build systems using both Orocos and ROS infrastructures
|
||
| 1 | 2015-07-21 | rtt_ros_comm |
The rtt_ros_comm package
The rtt_ros_comm package
|
||
| 1 | 2015-07-21 | rtt_ros |
This package provides an RTT plugin to add a ROS node to the RTT process,
as well as several wrapper scripts to enable roslaunching of orocos
programs.
This package provides an RTT plugin to add a ROS node to the RTT process,
as well as several wrapper scripts to enable roslaunching of orocos
programs.
|
||
| 1 | 2015-07-21 | rtt_nav_msgs |
Provides an rtt typekit for ROS nav_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/nav_msgs documentation
for the documentation of the ROS messages in this
typekit.
Provides an rtt typekit for ROS nav_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/nav_msgs documentation
for the documentation of the ROS messages in this
typekit.
|
||
| 1 | 2015-07-21 | rtt_kdl_conversions |
This package contains the components of the kdl_conversions package
This package contains the components of the kdl_conversions package
|