Packages
Packages
Packages
| Name | Description | ||||
|---|---|---|---|---|---|
| 1 | 2019-04-29 | jsk_visualization |
|
||
| 1 | 2019-04-29 | jsk_rviz_plugins |
The jsk_rviz_plugins package
The jsk_rviz_plugins package
|
||
| 1 | 2019-04-29 | jsk_rqt_plugins |
The jsk_rqt_plugins package
The jsk_rqt_plugins package
|
||
| 1 | 2019-04-29 | jsk_interactive_test |
jsk_interactive_test
jsk_interactive_test
|
||
| 1 | 2019-04-29 | jsk_interactive_marker |
jsk interactive markers
jsk interactive markers
|
||
| 1 | 2019-04-29 | jsk_interactive |
jsk_interactive
jsk_interactive
|
||
| 2 | 2019-04-28 | voxel_grid |
voxel_grid provides an implementation of an efficient 3D voxel grid. The occupancy grid can support 3 different representations for the state of a cell: marked, free, or unknown. Due to the underlying implementation relying on bitwise and and or integer operations, the voxel grid only supports 16 different levels per voxel column. However, this limitation yields raytracing and cell marking performance in the grid comparable to standard 2D structures making it quite fast compared to most 3D structures.
voxel_grid provides an implementation of an efficient 3D voxel grid. The occupancy grid can support 3 different representations for the state of a cell: marked, free, or unknown. Due to the underlying implementation relying on bitwise and and or integer operations, the voxel grid only supports 16 different levels per voxel column. However, this limitation yields raytracing and cell marking performance in the grid comparable to standard 2D structures making it quite fast compared to most 3D structures.
|
||
| 2 | 2019-04-28 | rotate_recovery |
This package provides a recovery behavior for the navigation stack that attempts to clear space by performing a 360 degree rotation of the robot.
This package provides a recovery behavior for the navigation stack that attempts to clear space by performing a 360 degree rotation of the robot.
|
||
| 1 | 2019-04-28 | pr2_simulator |
The pr2_simulator package
The pr2_simulator package
|
||
| 1 | 2019-04-28 | pr2_gazebo_plugins |
Gazebo Plugins for various PR2-specific sensors and actuators on the robot.
Gazebo Plugins for various PR2-specific sensors and actuators on the robot.
|
||
| 1 | 2019-04-28 | pr2_gazebo |
Launch scripts for simulating the PR2 in
Launch scripts for simulating the PR2 in
|
||
| 1 | 2019-04-28 | pr2_controller_configuration_gazebo |
A copy of the pr2_controller_configuration package, for use in
the PR2 simulator. We maintain two copies to allow for controller
gains to be set differently between hardware and simulation.
A copy of the pr2_controller_configuration package, for use in
the PR2 simulator. We maintain two copies to allow for controller
gains to be set differently between hardware and simulation.
|
||
| 2 | 2019-04-28 | navigation |
A 2D navigation stack that takes in information from odometry, sensor
streams, and a goal pose and outputs safe velocity commands that are sent
to a mobile base.
A 2D navigation stack that takes in information from odometry, sensor
streams, and a goal pose and outputs safe velocity commands that are sent
to a mobile base.
|
||
| 2 | 2019-04-28 | navfn |
navfn provides a fast interpolated navigation function that can be used to create plans for
a mobile base. The planner assumes a circular robot and operates on a costmap to find a
minimum cost plan from a start point to an end point in a grid. The navigation function is
computed with Dijkstra's algorithm, but support for an A* heuristic may also be added in the
near future. navfn also provides a ROS wrapper for the navfn planner that adheres to the
nav_core::BaseGlobalPlanner interface specified in
navfn provides a fast interpolated navigation function that can be used to create plans for
a mobile base. The planner assumes a circular robot and operates on a costmap to find a
minimum cost plan from a start point to an end point in a grid. The navigation function is
computed with Dijkstra's algorithm, but support for an A* heuristic may also be added in the
near future. navfn also provides a ROS wrapper for the navfn planner that adheres to the
nav_core::BaseGlobalPlanner interface specified in
|
||
| 2 | 2019-04-28 | nav_core |
This package provides common interfaces for navigation specific robot actions. Currently, this package provides the BaseGlobalPlanner, BaseLocalPlanner, and RecoveryBehavior interfaces, which can be used to build actions that can easily swap their planner, local controller, or recovery behavior for new versions adhering to the same interface.
This package provides common interfaces for navigation specific robot actions. Currently, this package provides the BaseGlobalPlanner, BaseLocalPlanner, and RecoveryBehavior interfaces, which can be used to build actions that can easily swap their planner, local controller, or recovery behavior for new versions adhering to the same interface.
|
||
| 2 | 2019-04-28 | move_slow_and_clear |
move_slow_and_clear
move_slow_and_clear
|
||
| 2 | 2019-04-28 | move_base |
The move_base package provides an implementation of an action (see the
The move_base package provides an implementation of an action (see the
|
||
| 2 | 2019-04-28 | map_server |
map_server provides the
map_server provides the
|
||
| 2 | 2019-04-28 | global_planner |
A path planner library and node.
A path planner library and node.
|
||
| 2 | 2019-04-28 | fake_localization |
A ROS node that simply forwards odometry information.
A ROS node that simply forwards odometry information.
|
||
| 2 | 2019-04-28 | dwa_local_planner |
This package provides an implementation of the Dynamic Window Approach to
local robot navigation on a plane. Given a global plan to follow and a
costmap, the local planner produces velocity commands to send to a mobile
base. This package supports any robot who's footprint can be represented as
a convex polygon or cicrle, and exposes its configuration as ROS parameters
that can be set in a launch file. The parameters for this planner are also
dynamically reconfigurable. This package's ROS wrapper adheres to the
BaseLocalPlanner interface specified in the
This package provides an implementation of the Dynamic Window Approach to
local robot navigation on a plane. Given a global plan to follow and a
costmap, the local planner produces velocity commands to send to a mobile
base. This package supports any robot who's footprint can be represented as
a convex polygon or cicrle, and exposes its configuration as ROS parameters
that can be set in a launch file. The parameters for this planner are also
dynamically reconfigurable. This package's ROS wrapper adheres to the
BaseLocalPlanner interface specified in the
|
||
| 2 | 2019-04-28 | costmap_2d |
This package provides an implementation of a 2D costmap that takes in sensor
data from the world, builds a 2D or 3D occupancy grid of the data (depending
on whether a voxel based implementation is used), and inflates costs in a
2D costmap based on the occupancy grid and a user specified inflation radius.
This package also provides support for map_server based initialization of a
costmap, rolling window based costmaps, and parameter based subscription to
and configuration of sensor topics.
This package provides an implementation of a 2D costmap that takes in sensor
data from the world, builds a 2D or 3D occupancy grid of the data (depending
on whether a voxel based implementation is used), and inflates costs in a
2D costmap based on the occupancy grid and a user specified inflation radius.
This package also provides support for map_server based initialization of a
costmap, rolling window based costmaps, and parameter based subscription to
and configuration of sensor topics.
|
||
| 2 | 2019-04-28 | clear_costmap_recovery |
This package provides a recovery behavior for the navigation stack that attempts to clear space by reverting the costmaps used by the navigation stack to the static map outside of a given area.
This package provides a recovery behavior for the navigation stack that attempts to clear space by reverting the costmaps used by the navigation stack to the static map outside of a given area.
|
||
| 2 | 2019-04-28 | carrot_planner |
This planner attempts to find a legal place to put a carrot for the robot to follow. It does this by moving back along the vector between the robot and the goal point.
This planner attempts to find a legal place to put a carrot for the robot to follow. It does this by moving back along the vector between the robot and the goal point.
|
||
| 2 | 2019-04-28 | base_local_planner |
This package provides implementations of the Trajectory Rollout and Dynamic Window approaches to local robot navigation on a plane. Given a plan to follow and a costmap, the controller produces velocity commands to send to a mobile base. This package supports both holonomic and non-holonomic robots, any robot footprint that can be represented as a convex polygon or circle, and exposes its configuration as ROS parameters that can be set in a launch file. This package's ROS wrapper adheres to the BaseLocalPlanner interface specified in the
This package provides implementations of the Trajectory Rollout and Dynamic Window approaches to local robot navigation on a plane. Given a plan to follow and a costmap, the controller produces velocity commands to send to a mobile base. This package supports both holonomic and non-holonomic robots, any robot footprint that can be represented as a convex polygon or circle, and exposes its configuration as ROS parameters that can be set in a launch file. This package's ROS wrapper adheres to the BaseLocalPlanner interface specified in the
|
||
| 2 | 2019-04-28 | amcl |
|
||
| 1 | 2019-04-26 | tf_conversions |
This package contains a set of conversion functions to convert
common tf datatypes (point, vector, pose, etc) into semantically
identical datatypes used by other libraries. The conversion functions
make it easier for users of the transform library (tf) to work with
the datatype of their choice. Currently this package has support for
the Kinematics and Dynamics Library (KDL) and the Eigen matrix
library. This package is stable, and will get integrated into tf in
the next major release cycle (see roadmap).
This package contains a set of conversion functions to convert
common tf datatypes (point, vector, pose, etc) into semantically
identical datatypes used by other libraries. The conversion functions
make it easier for users of the transform library (tf) to work with
the datatype of their choice. Currently this package has support for
the Kinematics and Dynamics Library (KDL) and the Eigen matrix
library. This package is stable, and will get integrated into tf in
the next major release cycle (see roadmap).
|
||
| 1 | 2019-04-26 | tf |
tf is a package that lets the user keep track of multiple coordinate
frames over time. tf maintains the relationship between coordinate
frames in a tree structure buffered in time, and lets the user
transform points, vectors, etc between any two coordinate frames at
any desired point in time.
tf is a package that lets the user keep track of multiple coordinate
frames over time. tf maintains the relationship between coordinate
frames in a tree structure buffered in time, and lets the user
transform points, vectors, etc between any two coordinate frames at
any desired point in time.
|
||
| 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 | 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 | 2019-04-26 | 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 | 2019-04-26 | 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.
|
||
| 3 | 2019-04-26 | pcl_conversions |
Provides conversions from PCL data types and ROS message types
Provides conversions from PCL data types and ROS message types
|
||
| 1 | 2019-04-26 | multi_object_tracking_lidar |
ROS package for Multiple objects detection, tracking and classification from LIDAR scans/point-clouds
ROS package for Multiple objects detection, tracking and classification from LIDAR scans/point-clouds
|
||
| 1 | 2019-04-26 | kdl_conversions |
Conversion functions between KDL and geometry_msgs types.
Conversion functions between KDL and geometry_msgs types.
|
||
| 1 | 2019-04-26 | geometry |
|
||
| 1 | 2019-04-26 | freight_bringup |
Bringup for freight
Bringup for freight
|
||
| 2 | 2019-04-26 | fmi_adapter_examples |
Provides small examples for use of the fmi_adapter package
Provides small examples for use of the fmi_adapter package
|
||
| 2 | 2019-04-26 | fmi_adapter |
Wraps FMUs for co-simulation
Wraps FMUs for co-simulation
|
||
| 1 | 2019-04-26 | fetch_teleop |
Teleoperation for fetch and freight.
Teleoperation for fetch and freight.
|
||
| 1 | 2019-04-26 | fetch_ros |
Fetch ROS, packages for working with Fetch and Freight
Fetch ROS, packages for working with Fetch and Freight
|
||
| 1 | 2019-04-26 | fetch_navigation |
Configuration and launch files for running ROS navigation on Fetch.
Configuration and launch files for running ROS navigation on Fetch.
|
||
| 1 | 2019-04-26 | fetch_moveit_config |
An automatically generated package with all the configuration and launch files for using the fetch_urdf with the MoveIt Motion Planning Framework
An automatically generated package with all the configuration and launch files for using the fetch_urdf with the MoveIt Motion Planning Framework
|
||
| 1 | 2019-04-26 | fetch_maps |
The fetch_maps package
The fetch_maps package
|
||
| 1 | 2019-04-26 | fetch_ikfast_plugin |
Kinematics plugin for Fetch robot, generated through IKFast
Kinematics plugin for Fetch robot, generated through IKFast
|
||
| 1 | 2019-04-26 | fetch_drivers |
The public fetch_drivers package is a binary only release.
fetch_drivers contains both the drivers and firmware for the fetch and freight research robots.
There should be no reason to use these drivers unless you're running on a fetch or a freight research robot.
This package, is a cmake/make only package which installs the binaries for the drivers and firmware.
The public fetch_drivers package is a binary only release.
fetch_drivers contains both the drivers and firmware for the fetch and freight research robots.
There should be no reason to use these drivers unless you're running on a fetch or a freight research robot.
This package, is a cmake/make only package which installs the binaries for the drivers and firmware.
|
||
| 1 | 2019-04-26 | fetch_description |
URDF for Fetch Robot.
URDF for Fetch Robot.
|
||
| 1 | 2019-04-26 | fetch_depth_layer |
The fetch_depth_layer package
The fetch_depth_layer package
|
||
| 1 | 2019-04-26 | fetch_calibration |
Launch and configuration files for calibrating Fetch using the 'robot_calibration' package.
Launch and configuration files for calibrating Fetch using the 'robot_calibration' package.
|
||
| 1 | 2019-04-26 | fetch_bringup |
Bringup for fetch
Bringup for fetch
|
Packages
| Name | Description | ||||
|---|---|---|---|---|---|
| 2 | 2019-03-17 | rplidar_ros |
The rplidar ros package, support rplidar A2/A1 and A3/S1
The rplidar ros package, support rplidar A2/A1 and A3/S1
|
||
| 1 | 2019-03-17 | rosbash_params |
Tools for writing ros-node-like bash scripts
Tools for writing ros-node-like bash scripts
|
||
| 1 | 2019-03-17 | dynamic_robot_state_publisher |
Improved ROS robot_state_publisher which can update the robot model via dynamic_reconfigure.
Improved ROS robot_state_publisher which can update the robot model via dynamic_reconfigure.
|
||
| 1 | 2019-03-15 | rqt_py_common |
rqt_py_common provides common functionality for rqt plugins written in Python.
Despite no plugin is provided, this package is part of the rqt_common_plugins
repository to keep refactoring generic functionality from these common plugins
into this package as easy as possible.
Functionality included in this package should cover generic ROS concepts and
should not introduce any special dependencies beside "ros_base".
rqt_py_common provides common functionality for rqt plugins written in Python.
Despite no plugin is provided, this package is part of the rqt_common_plugins
repository to keep refactoring generic functionality from these common plugins
into this package as easy as possible.
Functionality included in this package should cover generic ROS concepts and
should not introduce any special dependencies beside "ros_base".
|
||
| 1 | 2019-03-15 | rqt_image_view |
rqt_image_view provides a GUI plugin for displaying images using image_transport.
rqt_image_view provides a GUI plugin for displaying images using image_transport.
|
||
| 1 | 2019-03-15 | rqt_gui_py |
rqt_gui_py enables GUI plugins to use the Python client library for ROS.
rqt_gui_py enables GUI plugins to use the Python client library for ROS.
|
||
| 1 | 2019-03-15 | rqt_gui_cpp |
rqt_gui_cpp enables GUI plugins to use the C++ client library for ROS.
rqt_gui_cpp enables GUI plugins to use the C++ client library for ROS.
|
||
| 1 | 2019-03-15 | rqt_gui |
rqt_gui provides the main to start an instance of the ROS integrated graphical user interface provided by qt_gui.
rqt_gui provides the main to start an instance of the ROS integrated graphical user interface provided by qt_gui.
|
||
| 1 | 2019-03-15 | rqt |
rqt is a Qt-based framework for GUI development for ROS. It consists of three parts/metapackages
rqt is a Qt-based framework for GUI development for ROS. It consists of three parts/metapackages
|
||
| 1 | 2019-03-15 | 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 | 2019-03-15 | 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 | 2019-03-15 | 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 | 2019-03-15 | 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 | 2019-03-15 | 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 | 2019-03-15 | qt_dotgraph |
qt_dotgraph provides helpers to work with dot graphs.
qt_dotgraph provides helpers to work with dot graphs.
|
||
| 1 | 2019-03-14 | sparse_bundle_adjustment |
ROS wrapper for the sparse bundle adjustment (sba) library (needed for slam_karto)
ROS wrapper for the sparse bundle adjustment (sba) library (needed for slam_karto)
|
||
| 1 | 2019-03-14 | rqt_plot |
rqt_plot provides a GUI plugin visualizing numeric values in a 2D plot using different plotting backends.
rqt_plot provides a GUI plugin visualizing numeric values in a 2D plot using different plotting backends.
|
||
| 1 | 2019-03-14 | 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.
|
||
| 3 | 2019-03-12 | pr2_ethercat_drivers |
This stack contains drivers for the ethercat system and the peripherals
that connect to it: motor control boards, fingertip sensors, texture
projector, hand accelerometer.
This stack contains drivers for the ethercat system and the peripherals
that connect to it: motor control boards, fingertip sensors, texture
projector, hand accelerometer.
|
||
| 3 | 2019-03-12 | fingertip_pressure |
This package provides access to the PR2 fingertip pressure sensors. This information includes:
This package provides access to the PR2 fingertip pressure sensors. This information includes:
|
||
| 3 | 2019-03-12 | ethercat_hardware |
Package for creating a hardware interface to the robot using the EtherCAT motor controller/driver
Package for creating a hardware interface to the robot using the EtherCAT motor controller/driver
|
||
| 1 | 2019-03-08 | velodyne_simulator |
Metapackage allowing easy installation of Velodyne simulation components.
Metapackage allowing easy installation of Velodyne simulation components.
|
||
| 1 | 2019-03-08 | velodyne_gazebo_plugins |
Gazebo plugin to provide simulated data from Velodyne laser scanners.
Gazebo plugin to provide simulated data from Velodyne laser scanners.
|
||
| 1 | 2019-03-08 | velodyne_description |
URDF and meshes describing Velodyne laser scanners.
URDF and meshes describing Velodyne laser scanners.
|
||
| 2 | 2019-03-07 | teleop_twist_keyboard |
Generic keyboard teleop for twist robots.
Generic keyboard teleop for twist robots.
|
||
| 1 | 2019-03-05 | basler_tof |
Driver for the Basler ToF camera based on GenTL
Driver for the Basler ToF camera based on GenTL
|
||
| 2 | 2019-03-04 | std_msgs |
Standard ROS Messages including common message types representing primitive data types and other basic message constructs, such as multiarrays.
For common, generic robot-specific message types, please see
Standard ROS Messages including common message types representing primitive data types and other basic message constructs, such as multiarrays.
For common, generic robot-specific message types, please see
|
||
| 1 | 2019-03-04 | rospack |
ROS Package Tool
ROS Package Tool
|
||
| 1 | 2019-03-04 | rosconsole_bridge |
rosconsole_bridge is a package used in conjunction with console_bridge and rosconsole for connecting console_bridge-based logging to rosconsole-based logging.
rosconsole_bridge is a package used in conjunction with console_bridge and rosconsole for connecting console_bridge-based logging to rosconsole-based logging.
|
||
| 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 | 2019-03-04 | orocos_kinematics_dynamics |
This package depends on a recent version of the Kinematics and Dynamics
Library (KDL), distributed by the Orocos Project. It is a meta-package that
depends on kdl which contains the c++ version and pykdl which contains the
generated python bindings.
This package depends on a recent version of the Kinematics and Dynamics
Library (KDL), distributed by the Orocos Project. It is a meta-package that
depends on kdl which contains the c++ version and pykdl which contains the
generated python bindings.
|
||
| 2 | 2019-03-04 | orocos_kdl |
This package contains a recent version of the Kinematics and Dynamics
Library (KDL), distributed by the Orocos Project.
This package contains a recent version of the Kinematics and Dynamics
Library (KDL), distributed by the Orocos Project.
|
||
| 1 | 2019-03-04 | genmsg |
Standalone Python library for generating ROS message and service data structures for various languages.
Standalone Python library for generating ROS message and service data structures for various languages.
|
||
| 2 | 2019-02-28 | voxel_grid |
voxel_grid provides an implementation of an efficient 3D voxel grid. The occupancy grid can support 3 different representations for the state of a cell: marked, free, or unknown. Due to the underlying implementation relying on bitwise and and or integer operations, the voxel grid only supports 16 different levels per voxel column. However, this limitation yields raytracing and cell marking performance in the grid comparable to standard 2D structures making it quite fast compared to most 3D structures.
voxel_grid provides an implementation of an efficient 3D voxel grid. The occupancy grid can support 3 different representations for the state of a cell: marked, free, or unknown. Due to the underlying implementation relying on bitwise and and or integer operations, the voxel grid only supports 16 different levels per voxel column. However, this limitation yields raytracing and cell marking performance in the grid comparable to standard 2D structures making it quite fast compared to most 3D structures.
|
||
| 2 | 2019-02-28 | rotate_recovery |
This package provides a recovery behavior for the navigation stack that attempts to clear space by performing a 360 degree rotation of the robot.
This package provides a recovery behavior for the navigation stack that attempts to clear space by performing a 360 degree rotation of the robot.
|
||
| 3 | 2019-02-28 | robot_pose_ekf |
The Robot Pose EKF package is used to estimate the 3D pose of a robot, based on (partial) pose measurements coming from different sources. It uses an extended Kalman filter with a 6D model (3D position and 3D orientation) to combine measurements from wheel odometry, IMU sensor and visual odometry. The basic idea is to offer loosely coupled integration with different sensors, where sensor signals are received as ROS messages.
The Robot Pose EKF package is used to estimate the 3D pose of a robot, based on (partial) pose measurements coming from different sources. It uses an extended Kalman filter with a 6D model (3D position and 3D orientation) to combine measurements from wheel odometry, IMU sensor and visual odometry. The basic idea is to offer loosely coupled integration with different sensors, where sensor signals are received as ROS messages.
|
||
| 2 | 2019-02-28 | navigation |
A 2D navigation stack that takes in information from odometry, sensor
streams, and a goal pose and outputs safe velocity commands that are sent
to a mobile base.
A 2D navigation stack that takes in information from odometry, sensor
streams, and a goal pose and outputs safe velocity commands that are sent
to a mobile base.
|
||
| 2 | 2019-02-28 | navfn |
navfn provides a fast interpolated navigation function that can be used to create plans for
a mobile base. The planner assumes a circular robot and operates on a costmap to find a
minimum cost plan from a start point to an end point in a grid. The navigation function is
computed with Dijkstra's algorithm, but support for an A* heuristic may also be added in the
near future. navfn also provides a ROS wrapper for the navfn planner that adheres to the
nav_core::BaseGlobalPlanner interface specified in
navfn provides a fast interpolated navigation function that can be used to create plans for
a mobile base. The planner assumes a circular robot and operates on a costmap to find a
minimum cost plan from a start point to an end point in a grid. The navigation function is
computed with Dijkstra's algorithm, but support for an A* heuristic may also be added in the
near future. navfn also provides a ROS wrapper for the navfn planner that adheres to the
nav_core::BaseGlobalPlanner interface specified in
|
||
| 2 | 2019-02-28 | nav_core |
This package provides common interfaces for navigation specific robot actions. Currently, this package provides the BaseGlobalPlanner, BaseLocalPlanner, and RecoveryBehavior interfaces, which can be used to build actions that can easily swap their planner, local controller, or recovery behavior for new versions adhering to the same interface.
This package provides common interfaces for navigation specific robot actions. Currently, this package provides the BaseGlobalPlanner, BaseLocalPlanner, and RecoveryBehavior interfaces, which can be used to build actions that can easily swap their planner, local controller, or recovery behavior for new versions adhering to the same interface.
|
||
| 2 | 2019-02-28 | move_slow_and_clear |
move_slow_and_clear
move_slow_and_clear
|
||
| 2 | 2019-02-28 | move_base |
The move_base package provides an implementation of an action (see the
The move_base package provides an implementation of an action (see the
|
||
| 2 | 2019-02-28 | map_server |
map_server provides the
map_server provides the
|
||
| 2 | 2019-02-28 | global_planner |
A path planner library and node.
A path planner library and node.
|
||
| 2 | 2019-02-28 | fake_localization |
A ROS node that simply forwards odometry information.
A ROS node that simply forwards odometry information.
|
||
| 2 | 2019-02-28 | dwa_local_planner |
This package provides an implementation of the Dynamic Window Approach to
local robot navigation on a plane. Given a global plan to follow and a
costmap, the local planner produces velocity commands to send to a mobile
base. This package supports any robot who's footprint can be represented as
a convex polygon or cicrle, and exposes its configuration as ROS parameters
that can be set in a launch file. The parameters for this planner are also
dynamically reconfigurable. This package's ROS wrapper adheres to the
BaseLocalPlanner interface specified in the
This package provides an implementation of the Dynamic Window Approach to
local robot navigation on a plane. Given a global plan to follow and a
costmap, the local planner produces velocity commands to send to a mobile
base. This package supports any robot who's footprint can be represented as
a convex polygon or cicrle, and exposes its configuration as ROS parameters
that can be set in a launch file. The parameters for this planner are also
dynamically reconfigurable. This package's ROS wrapper adheres to the
BaseLocalPlanner interface specified in the
|
||
| 2 | 2019-02-28 | costmap_2d |
This package provides an implementation of a 2D costmap that takes in sensor
data from the world, builds a 2D or 3D occupancy grid of the data (depending
on whether a voxel based implementation is used), and inflates costs in a
2D costmap based on the occupancy grid and a user specified inflation radius.
This package also provides support for map_server based initialization of a
costmap, rolling window based costmaps, and parameter based subscription to
and configuration of sensor topics.
This package provides an implementation of a 2D costmap that takes in sensor
data from the world, builds a 2D or 3D occupancy grid of the data (depending
on whether a voxel based implementation is used), and inflates costs in a
2D costmap based on the occupancy grid and a user specified inflation radius.
This package also provides support for map_server based initialization of a
costmap, rolling window based costmaps, and parameter based subscription to
and configuration of sensor topics.
|
||
| 2 | 2019-02-28 | clear_costmap_recovery |
This package provides a recovery behavior for the navigation stack that attempts to clear space by reverting the costmaps used by the navigation stack to the static map outside of a given area.
This package provides a recovery behavior for the navigation stack that attempts to clear space by reverting the costmaps used by the navigation stack to the static map outside of a given area.
|
||
| 2 | 2019-02-28 | carrot_planner |
This planner attempts to find a legal place to put a carrot for the robot to follow. It does this by moving back along the vector between the robot and the goal point.
This planner attempts to find a legal place to put a carrot for the robot to follow. It does this by moving back along the vector between the robot and the goal point.
|
||
| 2 | 2019-02-28 | base_local_planner |
This package provides implementations of the Trajectory Rollout and Dynamic Window approaches to local robot navigation on a plane. Given a plan to follow and a costmap, the controller produces velocity commands to send to a mobile base. This package supports both holonomic and non-holonomic robots, any robot footprint that can be represented as a convex polygon or circle, and exposes its configuration as ROS parameters that can be set in a launch file. This package's ROS wrapper adheres to the BaseLocalPlanner interface specified in the
This package provides implementations of the Trajectory Rollout and Dynamic Window approaches to local robot navigation on a plane. Given a plan to follow and a costmap, the controller produces velocity commands to send to a mobile base. This package supports both holonomic and non-holonomic robots, any robot footprint that can be represented as a convex polygon or circle, and exposes its configuration as ROS parameters that can be set in a launch file. This package's ROS wrapper adheres to the BaseLocalPlanner interface specified in the
|
||
| 2 | 2019-02-28 | amcl |
|
Packages
| Name | Description | ||||
|---|---|---|---|---|---|
| 1 | 2019-05-12 | tblib |
Traceback fiddling library. Allows you to pickle tracebacks.
Traceback fiddling library. Allows you to pickle tracebacks.
|
||
| 2 | 2019-05-12 | rqt_robot_monitor |
rqt_robot_monitor displays diagnostics_agg topics messages that
are published by
rqt_robot_monitor displays diagnostics_agg topics messages that
are published by
|
||
| 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-11 | webargs |
A friendly library for parsing HTTP request arguments, with built-in support for popular web frameworks, including Flask, Django, Bottle, Tornado, Pyramid, webapp2, Falcon, and aiohttp.
A friendly library for parsing HTTP request arguments, with built-in support for popular web frameworks, including Flask, Django, Bottle, Tornado, Pyramid, webapp2, Falcon, and aiohttp.
|
||
| 1 | 2019-05-10 | rtmros_nextage |
The rtmros_nextage package is a ROS interface for
The rtmros_nextage package is a ROS interface for
|
||
| 1 | 2019-05-10 | nextage_ros_bridge |
A main ROS interface for developers and users of
A main ROS interface for developers and users of
|
||
| 1 | 2019-05-10 | nextage_moveit_config |
An automatically generated package with all the configuration and launch files for using the NextageOpen with the MoveIt Motion Planning Framework.
An automatically generated package with all the configuration and launch files for using the NextageOpen with the MoveIt Motion Planning Framework.
|
||
| 1 | 2019-05-10 | nextage_ik_plugin |
IKFast package for NEXTAGE Open
IKFast package for NEXTAGE Open
|
||
| 1 | 2019-05-10 | nextage_gazebo |
Gazebo simulation for NEXTAGE Open
Gazebo simulation for NEXTAGE Open
|
||
| 1 | 2019-05-10 | nextage_description |
As a part of rtmros_nextage package that is a ROS interface for
As a part of rtmros_nextage package that is a ROS interface for
|
||
| 1 | 2019-05-10 | nextage_calibration |
This package provides .launch files and other tools for
calibrating the head-mount cameras to the NEXTAGE Open robot.
As of version 0.7.15/March 2017, only Kinect/Xtion is capable (i.e. Ueye
cameras, the ones the robot comes with on this head by default, are not yet
handled).
This package provides .launch files and other tools for
calibrating the head-mount cameras to the NEXTAGE Open robot.
As of version 0.7.15/March 2017, only Kinect/Xtion is capable (i.e. Ueye
cameras, the ones the robot comes with on this head by default, are not yet
handled).
|
||
| 1 | 2019-05-10 | naoqi_driver |
Driver module between Aldebaran's NAOqiOS and ROS. It publishes all sensor and actuator data as well as basic diagnostic for battery, temperature. It subscribes also to RVIZ simple goal and cmd_vel for teleop.
Driver module between Aldebaran's NAOqiOS and ROS. It publishes all sensor and actuator data as well as basic diagnostic for battery, temperature. It subscribes also to RVIZ simple goal and cmd_vel for teleop.
|
||
| 1 | 2019-05-10 | ensenso_driver |
Driver for Ensenso stereo cameras.
Driver for Ensenso stereo cameras.
|
||
| 1 | 2019-05-10 | ensenso_description |
Description package for Ensenso stereo cameras. This package consists of all current supported camera models.
The Xacro macros, which import the mesh files as stl, accept the following parameters:
- camera name
- parent frame and its transform regarding to the camera mounting frame
- collision margin to the camera
Description package for Ensenso stereo cameras. This package consists of all current supported camera models.
The Xacro macros, which import the mesh files as stl, accept the following parameters:
- camera name
- parent frame and its transform regarding to the camera mounting frame
- collision margin to the camera
|
||
| 1 | 2019-05-10 | ensenso_camera_test |
Tests for the ensenso_camera package.
Tests for the ensenso_camera package.
|
||
| 1 | 2019-05-10 | ensenso_camera_msgs |
Message definitions for the ensenso_camera package.
Message definitions for the ensenso_camera package.
|
||
| 1 | 2019-05-10 | ensenso_camera |
Driver for Ensenso stereo cameras.
Driver for Ensenso stereo cameras.
|
||
| 1 | 2019-05-10 | dynamixel_control_hw |
An interface to the Dynamixel actuators for ROS control
An interface to the Dynamixel actuators for ROS control
|
||
| 1 | 2019-05-09 | ypspur |
YP-Spur is a mobile robot motion control software with coordinate frame based commands.
YP-Spur is a mobile robot motion control software with coordinate frame based commands.
|
||
| 1 | 2019-05-09 | webots_ros |
The ROS package containing examples for interfacing ROS with the standard ROS controller of Webots
The ROS package containing examples for interfacing ROS with the standard ROS controller of Webots
|
||
| 1 | 2019-05-09 | livox_ros_driver |
The ROS device driver for Livox 3D LiDARs and Livox Hub
The ROS device driver for Livox 3D LiDARs and Livox Hub
|
||
| 2 | 2019-05-09 | hrpsys |
|
||
| 1 | 2019-05-09 | fiducials |
Localization using fiducial markers
Localization using fiducial markers
|
||
| 1 | 2019-05-09 | fiducial_slam |
ROS node to build a 3D map of fiducials and estimate robot pose from fiducial transforms
ROS node to build a 3D map of fiducials and estimate robot pose from fiducial transforms
|
||
| 1 | 2019-05-09 | fiducial_msgs |
Package containing message definitions for fiducials
Package containing message definitions for fiducials
|
||
| 1 | 2019-05-09 | crane_x7_msgs |
The crane_x7_msgs package
The crane_x7_msgs package
|
||
| 1 | 2019-05-09 | crane_x7_moveit_config |
An automatically generated package with all the configuration and launch files for using the crane_x7 with the MoveIt! Motion Planning Framework
An automatically generated package with all the configuration and launch files for using the crane_x7 with the MoveIt! Motion Planning Framework
|
||
| 1 | 2019-05-09 | crane_x7_gazebo |
The crane_x7_gazebo package
The crane_x7_gazebo package
|
||
| 1 | 2019-05-09 | crane_x7_examples |
examples of CRANE-X7 ROS package
examples of CRANE-X7 ROS package
|
||
| 1 | 2019-05-09 | crane_x7_description |
The CRANE-X7 description package
The CRANE-X7 description package
|
||
| 1 | 2019-05-09 | crane_x7_control |
The CRANE-X7 control package
The CRANE-X7 control package
|
||
| 1 | 2019-05-09 | crane_x7_bringup |
The CRANE-X7 bringup package
The CRANE-X7 bringup package
|
||
| 1 | 2019-05-09 | crane_x7 |
ROS package suite of CRANE-X7
ROS package suite of CRANE-X7
|
||
| 1 | 2019-05-09 | aruco_detect |
Fiducial detection based on the aruco library
Fiducial detection based on the aruco library
|
||
| 2 | 2019-05-08 | ur_modern_driver |
The new driver for Universal Robots UR3, UR5 and UR10 robots with CB2 and CB3 controllers.
The new driver for Universal Robots UR3, UR5 and UR10 robots with CB2 and CB3 controllers.
|
||
| 1 | 2019-05-08 | sr_ethercat_hand_config |
sr_ethercat_hand_config contains the different yaml files storing the parameters used on the etherCAT hand.
sr_ethercat_hand_config contains the different yaml files storing the parameters used on the etherCAT hand.
|
||
| 1 | 2019-05-08 | sr_config |
sr_config
sr_config
|
||
| 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 | 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.
|
Packages
| Name | Description | ||||
|---|---|---|---|---|---|
| 1 | 2019-04-13 | mrpt_slam |
mrpt_slam
mrpt_slam
|
||
| 1 | 2019-04-13 | mrpt_rbpf_slam |
This package is used for gridmap SLAM. The interface is similar to gmapping (http://wiki.ros.org/gmapping) but the package supports different particle-filter algorithms, range-only SLAM, can work with several grid maps simultaneously and more.
This package is used for gridmap SLAM. The interface is similar to gmapping (http://wiki.ros.org/gmapping) but the package supports different particle-filter algorithms, range-only SLAM, can work with several grid maps simultaneously and more.
|
||
| 1 | 2019-04-13 | mrpt_icp_slam_2d |
mrpt_icp_slam_2d contains a wrapper on MRPT's 2D ICP-SLAM algorithms.
mrpt_icp_slam_2d contains a wrapper on MRPT's 2D ICP-SLAM algorithms.
|
||
| 1 | 2019-04-13 | mrpt_graphslam_2d |
Implement graphSLAM using the mrpt-graphslam library, in an online fashion
by directly reading measurements off ROS Topics.
Implement graphSLAM using the mrpt-graphslam library, in an online fashion
by directly reading measurements off ROS Topics.
|
||
| 1 | 2019-04-13 | mrpt_ekf_slam_3d |
This package is a wrapper for the implementation of EKF-based SLAM with range-bearing sensors, odometry, a full 6D robot pose, and 3D landmarks.
This package is a wrapper for the implementation of EKF-based SLAM with range-bearing sensors, odometry, a full 6D robot pose, and 3D landmarks.
|
||
| 1 | 2019-04-13 | mrpt_ekf_slam_2d |
This package is a wrapper for the implementation of EKF-based SLAM with range-bearing sensors, odometry, and a 2D (+heading) robot pose, and 2D landmarks.
This package is a wrapper for the implementation of EKF-based SLAM with range-bearing sensors, odometry, and a 2D (+heading) robot pose, and 2D landmarks.
|
||
| 1 | 2019-04-12 | towr_ros |
A ROS dependent wrapper for
A ROS dependent wrapper for
|
||
| 1 | 2019-04-12 | towr |
A light-weight, Eigen-based
C++ library for trajectory optimization for legged robots.
This library provides implementations for variables, costs and constraints
that can be used to represent a legged locomotion problem.
The resulting Nonlinear Programming Problem (NLP) can then be solved with
off-the-shelf solvers, e.g. Ipopt using the generic optimizer interface
A light-weight, Eigen-based
C++ library for trajectory optimization for legged robots.
This library provides implementations for variables, costs and constraints
that can be used to represent a legged locomotion problem.
The resulting Nonlinear Programming Problem (NLP) can then be solved with
off-the-shelf solvers, e.g. Ipopt using the generic optimizer interface
|
||
| 1 | 2019-04-12 | tork_moveit_tutorial |
The tork_moveit_tutorial package
The tork_moveit_tutorial package
|
||
| 1 | 2019-04-11 | mvsim |
Node for the "multivehicle simulator" framework.
Node for the "multivehicle simulator" framework.
|
||
| 1 | 2019-04-11 | mrpt_tutorials |
Example files used as tutorials for MRPT ROS packages
Example files used as tutorials for MRPT ROS packages
|
||
| 1 | 2019-04-11 | mrpt_reactivenav2d |
Reactive navigation for 2D robots using MRPT navigation algorithms (TP-Space)
Reactive navigation for 2D robots using MRPT navigation algorithms (TP-Space)
|
||
| 1 | 2019-04-11 | mrpt_rawlog |
This package enables you to record a rawlog from a ROS drive robot.
At the moment the package is able to deal with odometry and 2d laser scans.
This package enables you to record a rawlog from a ROS drive robot.
At the moment the package is able to deal with odometry and 2d laser scans.
|
||
| 1 | 2019-04-11 | mrpt_navigation |
Tools related to the Mobile Robot Programming Toolkit (MRPT).
Refer to http://wiki.ros.org/mrpt_navigation for further documentation.
Tools related to the Mobile Robot Programming Toolkit (MRPT).
Refer to http://wiki.ros.org/mrpt_navigation for further documentation.
|
||
| 1 | 2019-04-11 | mrpt_map |
The mrpt_map is able to publish a mrpt map as ros occupancy grid like the map_server
The mrpt_map is able to publish a mrpt map as ros occupancy grid like the map_server
|
||
| 1 | 2019-04-11 | mrpt_localization |
Package for robot 2D self-localization using dynamic or static (MRPT or ROS) maps.
The interface is similar to amcl (http://wiki.ros.org/amcl)
but supports different particle-filter algorithms, several grid maps at
different heights, range-only localization, etc.
Package for robot 2D self-localization using dynamic or static (MRPT or ROS) maps.
The interface is similar to amcl (http://wiki.ros.org/amcl)
but supports different particle-filter algorithms, several grid maps at
different heights, range-only localization, etc.
|
||
| 1 | 2019-04-11 | mrpt_local_obstacles |
Maintains a local obstacle map (point cloud,
voxels or occupancy grid) from recent sensor readings within a
configurable time window.
Maintains a local obstacle map (point cloud,
voxels or occupancy grid) from recent sensor readings within a
configurable time window.
|
||
| 1 | 2019-04-11 | ipa_3d_fov_visualization |
The ipa_3d_fov_visualization package
The ipa_3d_fov_visualization package
|
||
| 1 | 2019-04-11 | cob_vision_utils |
Contains utilities used within the object detection tool chain.
Contains utilities used within the object detection tool chain.
|
||
| 1 | 2019-04-11 | cob_perception_msgs |
This package contains common message type definitions for perception tasks.
This package contains common message type definitions for perception tasks.
|
||
| 1 | 2019-04-11 | cob_perception_common |
This stack provides utilities commonly needed for a variety of computer vision tasks.
This stack provides utilities commonly needed for a variety of computer vision tasks.
|
||
| 1 | 2019-04-11 | cob_object_detection_visualizer |
The cob_object_detection_visualizer package
The cob_object_detection_visualizer package
|
||
| 1 | 2019-04-11 | cob_object_detection_msgs |
This package contains message type definitions for object detection
This package contains message type definitions for object detection
|
||
| 1 | 2019-04-11 | cob_image_flip |
Flips the image of Care-O-bots kinect in dependence of the viewing direction of the cameras to receive an upright image all the time.
Flips the image of Care-O-bots kinect in dependence of the viewing direction of the cameras to receive an upright image all the time.
|
||
| 1 | 2019-04-11 | cob_cam3d_throttle |
cob_cam3d_throttle: only for Trottel
cob_cam3d_throttle: only for Trottel
|
||
| 2 | 2019-04-11 | cob_3d_mapping_msgs |
Message, service and action definitions for environment perception.
Message, service and action definitions for environment perception.
|
||
| 2 | 2019-04-10 | openhrp3 |
|
||
| 1 | 2019-04-09 | widowx_arm_moveit |
An automatically generated package with all the configuration and launch files for using the widowx_arm with the MoveIt! Motion Planning Framework
An automatically generated package with all the configuration and launch files for using the widowx_arm with the MoveIt! Motion Planning Framework
|
||
| 1 | 2019-04-09 | widowx_arm_description |
The widowx_arm_description package
The widowx_arm_description package
|
||
| 1 | 2019-04-09 | widowx_arm_controller |
The widowx_arm_controller package
The widowx_arm_controller package
|
||
| 1 | 2019-04-09 | widowx_arm |
The widowx_arm package
The widowx_arm package
|
||
| 1 | 2019-04-09 | flexbe_widget |
flexbe_widget implements some smaller scripts for the behavior engine.
flexbe_widget implements some smaller scripts for the behavior engine.
|
||
| 1 | 2019-04-09 | flexbe_testing |
flexbe_testing provides a framework for unit testing states.
flexbe_testing provides a framework for unit testing states.
|
||
| 1 | 2019-04-09 | flexbe_states |
flexbe_states provides a collection of predefined states.
Feel free to add new states.
flexbe_states provides a collection of predefined states.
Feel free to add new states.
|
||
| 1 | 2019-04-09 | flexbe_onboard |
flexbe_onboard implements the robot-side of the behavior engine from where all behaviors are started.
flexbe_onboard implements the robot-side of the behavior engine from where all behaviors are started.
|
||
| 1 | 2019-04-09 | flexbe_msgs |
flexbe_msgs provides the messages used by FlexBE.
flexbe_msgs provides the messages used by FlexBE.
|
||
| 1 | 2019-04-09 | flexbe_mirror |
flexbe_mirror implements functionality to remotely mirror an executed behavior.
flexbe_mirror implements functionality to remotely mirror an executed behavior.
|
||
| 1 | 2019-04-09 | flexbe_input |
flexbe_input enables to send data to onboard behavior when required.
flexbe_input enables to send data to onboard behavior when required.
|
||
| 1 | 2019-04-09 | flexbe_core |
flexbe_core provides the core smach extension for the FlexBE behavior engine.
flexbe_core provides the core smach extension for the FlexBE behavior engine.
|
||
| 1 | 2019-04-09 | flexbe_behavior_engine |
A meta-package to aggregate all the FlexBE packages
A meta-package to aggregate all the FlexBE packages
|
||
| 1 | 2019-04-09 | flexbe_app |
flexbe_app provides a user interface (editor + runtime control) for the FlexBE behavior engine.
flexbe_app provides a user interface (editor + runtime control) for the FlexBE behavior engine.
|
||
| 1 | 2019-04-05 | service_tools |
Service tools
Service tools
|
||
| 1 | 2019-04-05 | generic_throttle |
This package provides a throttle for ROS topics
This package provides a throttle for ROS topics
|
||
| 1 | 2019-04-05 | cob_teleop |
Teleop node
Teleop node
|
||
| 1 | 2019-04-05 | cob_supported_robots |
This package contains the list of supported robots within the care-o-bot family.
This package contains the list of supported robots within the care-o-bot family.
|
||
| 1 | 2019-04-05 | cob_script_server |
The cob_script_server package provides a simple interface to operate Care-O-bot. It can be used via the python API or the actionlib interface.
The cob_script_server package provides a simple interface to operate Care-O-bot. It can be used via the python API or the actionlib interface.
|
||
| 1 | 2019-04-05 | cob_robots |
This stack holds packages for hardware configuration as well as launch files for starting up the basic layer for operating Care-O-bot.
This stack holds packages for hardware configuration as well as launch files for starting up the basic layer for operating Care-O-bot.
|
||
| 2 | 2019-04-05 | cob_moveit_config |
MoveIt config files for all cob and raw
MoveIt config files for all cob and raw
|
||
| 2 | 2019-04-05 | cob_monitoring |
cob_monitoring
cob_monitoring
|
||
| 1 | 2019-04-05 | cob_interactive_teleop |
COB teleop interactive marker for RViz provided by dcgm-robotics@FIT group.
COB teleop interactive marker for RViz provided by dcgm-robotics@FIT group.
|
Packages
Packages
| Name | Description | ||||
|---|---|---|---|---|---|
| 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-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.)
|
||
| 1 | 2018-10-02 | dynamic_reconfigure |
This unary stack contains the dynamic_reconfigure package which provides a means to change
node parameters at any time without having to restart the node.
This unary stack contains the dynamic_reconfigure package which provides a means to change
node parameters at any time without having to restart the node.
|
||
| 1 | 2018-09-30 | pioneer_teleop |
The pioneer_teleop package provides teleoperation using keyboard, sockets or command line for the Adept MobileRobots Pioneer and Pioneer-compatible robots (Including Pioneer 2, Pioneer 3, Pioneer LX, AmigoBot, PeopleBot, PatrolBot, PowerBot, Seekur and Seekur Jr.).
The pioneer_teleop package provides teleoperation using keyboard, sockets or command line for the Adept MobileRobots Pioneer and Pioneer-compatible robots (Including Pioneer 2, Pioneer 3, Pioneer LX, AmigoBot, PeopleBot, PatrolBot, PowerBot, Seekur and Seekur Jr.).
|
||
| 1 | 2018-09-29 | nmea_navsat_driver |
Package to parse NMEA strings and publish a very simple GPS message. Does not require the GPSD deamon.
Package to parse NMEA strings and publish a very simple GPS message. Does not require the GPSD deamon.
|
||
| 1 | 2018-09-27 | leap_motion |
ROS driver for the Leap Motion gesture sensor
ROS driver for the Leap Motion gesture sensor
|
||
| 2 | 2018-09-21 | rail_segmentation |
Segmentation Functionality from the RAIL Lab
Segmentation Functionality from the RAIL Lab
|
||
| 2 | 2018-09-21 | 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-19 | rosserial_xbee |
Allows multipoint communication between rosserial
nodes connected to an xbee. All nodes communicate back
to a master xbee connected to a computer running ROS.
This software currently only works with Series 1 Xbees.
This pkg includes python code from the python-xbee project:
http://code.google.com/p/python-xbee/
Allows multipoint communication between rosserial
nodes connected to an xbee. All nodes communicate back
to a master xbee connected to a computer running ROS.
This software currently only works with Series 1 Xbees.
This pkg includes python code from the python-xbee project:
http://code.google.com/p/python-xbee/
|
||
| 1 | 2018-09-19 | rosserial_windows |
rosserial for Windows platforms.
rosserial for Windows platforms.
|
||
| 1 | 2018-09-19 | rosserial_vex_v5 |
rosserial for the VEX Cortex V5 Robot Brain platform.
rosserial for the VEX Cortex V5 Robot Brain platform.
|
||
| 1 | 2018-09-19 | rosserial_vex_cortex |
rosserial for Cortex/AVR platforms.
rosserial for Cortex/AVR platforms.
|
||
| 1 | 2018-09-19 | rosserial_tivac |
rosserial for TivaC Launchpad evaluation boards.
rosserial for TivaC Launchpad evaluation boards.
|
||
| 1 | 2018-09-19 | rosserial_test |
A specialized harness which allows end-to-end integration testing of the
rosserial client and server components.
A specialized harness which allows end-to-end integration testing of the
rosserial client and server components.
|
||
| 1 | 2018-09-19 | rosserial_server |
A more performance- and stability-oriented server alternative implemented
in C++ to rosserial_python.
A more performance- and stability-oriented server alternative implemented
in C++ to rosserial_python.
|
||
| 1 | 2018-09-19 | rosserial_python |
A Python-based implementation of the rosserial protocol.
A Python-based implementation of the rosserial protocol.
|
||
| 1 | 2018-09-19 | rosserial_msgs |
Messages for automatic topic configuration using rosserial.
Messages for automatic topic configuration using rosserial.
|
||
| 1 | 2018-09-19 | rosserial_mbed |
rosserial for mbed platforms.
rosserial for mbed platforms.
|
||
| 1 | 2018-09-19 | rosserial_embeddedlinux |
rosserial for embedded Linux enviroments
rosserial for embedded Linux enviroments
|
||
| 1 | 2018-09-19 | rosserial_client |
Generalized client side source for rosserial.
Generalized client side source for rosserial.
|
||
| 1 | 2018-09-19 | rosserial_arduino |
rosserial for Arduino/AVR platforms.
rosserial for Arduino/AVR platforms.
|
||
| 1 | 2018-09-19 | rosserial |
Metapackage for core of rosserial.
Metapackage for core of rosserial.
|
||
| 1 | 2018-09-13 | openni_description |
Model files of OpenNI device.
Model files of OpenNI device.
|
||
| 1 | 2018-09-13 | openni_camera |
A ROS driver for OpenNI depth (+ RGB) cameras. These include:
Microsoft Kinect,
PrimeSense PSDK,
ASUS Xtion Pro and Pro Live
The driver publishes raw depth, RGB, and IR image streams.
A ROS driver for OpenNI depth (+ RGB) cameras. These include:
Microsoft Kinect,
PrimeSense PSDK,
ASUS Xtion Pro and Pro Live
The driver publishes raw depth, RGB, and IR image streams.
|
||
| 2 | 2018-09-11 | ecl_manipulators |
Deploys various manipulation algorithms, currently just
feedforward filters (interpolations).
Deploys various manipulation algorithms, currently just
feedforward filters (interpolations).
|
||
| 1 | 2018-09-11 | ecl_manipulation |
Includes basic manipulation related structures as well as a few
algorithms currently used at Yujin Robot.
Includes basic manipulation related structures as well as a few
algorithms currently used at Yujin Robot.
|
||
| 1 | 2018-09-11 | ecl |
Metapackage bringing all of ecl together.
Metapackage bringing all of ecl together.
|
||
| 1 | 2018-09-08 | smach_viewer |
The smach viewer is a GUI that shows the state of hierarchical
SMACH state machines. It can visualize the possible transitions
between states, as well as the currently active state and the
values of user data that is passed around between states. The
smach viewer uses the SMACH debugging interface based on
the
The smach viewer is a GUI that shows the state of hierarchical
SMACH state machines. It can visualize the possible transitions
between states, as well as the currently active state and the
values of user data that is passed around between states. The
smach viewer uses the SMACH debugging interface based on
the
|
||
| 1 | 2018-09-08 | executive_smach_visualization |
This metapackage depends on the SMACH visualization tools.
This metapackage depends on the SMACH visualization tools.
|
||
| 1 | 2018-09-05 | gscam |
A ROS camera driver that uses gstreamer to connect to
devices such as webcams.
A ROS camera driver that uses gstreamer to connect to
devices such as webcams.
|
||
| 1 | 2018-09-04 | view_controller_msgs |
Messages for (camera) view controllers
Messages for (camera) view controllers
|
||
| 2 | 2018-09-04 | pcdfilter_pa |
ProAut pointcloud filter package
ProAut pointcloud filter package
|
||
| 2 | 2018-09-04 | parameter_pa |
ProAut parameter package
ProAut parameter package
|
||
| 1 | 2018-09-02 | rosparam_handler |
An easy wrapper for using parameters in ROS.
An easy wrapper for using parameters in ROS.
|
||
| 2 | 2018-08-31 | social_navigation_layers |
Plugin-based layers for the navigation stack that
implement various social navigation contraints, like proxemic distance.
Plugin-based layers for the navigation stack that
implement various social navigation contraints, like proxemic distance.
|
||
| 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 | 2018-08-31 | navigation_layers |
Extra navigation layers.
Extra navigation layers.
|
||
| 2 | 2018-08-30 | uvc_camera |
A collection of node(let)s that stream images from USB cameras (UVC)
and provide CameraInfo messages to consumers. Includes a
two-camera node that provides rough synchronization
for stereo vision.
Currently uses the base driver from Morgan Quigley's uvc_cam package.
A collection of node(let)s that stream images from USB cameras (UVC)
and provide CameraInfo messages to consumers. Includes a
two-camera node that provides rough synchronization
for stereo vision.
Currently uses the base driver from Morgan Quigley's uvc_cam package.
|
||
| 2 | 2018-08-30 | jpeg_streamer |
tools for streaming JPEG-formatted CompressedImage topics over HTTP
tools for streaming JPEG-formatted CompressedImage topics over HTTP
|
||
| 2 | 2018-08-30 | camera_umd |
UMD camera metapackage
UMD camera metapackage
|
||
| 2 | 2018-08-24 | rplidar_ros |
The rplidar ros package, support rplidar A2/A1 and A3
The rplidar ros package, support rplidar A2/A1 and A3
|
||
| 1 | 2018-08-24 | mav_planning_msgs |
Messages specific to MAV planning, especially polynomial planning.
Messages specific to MAV planning, especially polynomial planning.
|
||
| 1 | 2018-08-24 | mav_msgs |
Package containing messages for communicating with rotary wing MAVs
Package containing messages for communicating with rotary wing MAVs
|
||
| 1 | 2018-08-24 | mav_comm |
Contains messages and services for MAV communication
Contains messages and services for MAV communication
|
||
| 1 | 2018-08-21 | slam_karto |
This package pulls in the Karto mapping library, and provides a ROS
wrapper for using it.
This package pulls in the Karto mapping library, and provides a ROS
wrapper for using it.
|
||
| 1 | 2018-08-18 | sparse_bundle_adjustment |
ROS wrapper for the sparse bundle adjustment (sba) library (needed for slam_karto)
ROS wrapper for the sparse bundle adjustment (sba) library (needed for slam_karto)
|
||
| 1 | 2018-08-16 | stepback_and_steerturn_recovery |
This package provides a recovery behavior for the navigation stack which
steps back and proceed with a specified steer angle
This package provides a recovery behavior for the navigation stack which
steps back and proceed with a specified steer angle
|
Packages
| Name | Description | ||||
|---|---|---|---|---|---|
| 1 | 2017-03-29 | uuv_sensor_plugins_ros |
The uuv_sensor_plugins_ros package
The uuv_sensor_plugins_ros package
|
||
| 1 | 2017-03-29 | uuv_sensor_plugins |
The uuv_sensor_plugins package
The uuv_sensor_plugins package
|
||
| 1 | 2017-03-29 | uuv_nc_parser |
The uuv_nc_parser package
The uuv_nc_parser package
|
||
| 1 | 2017-03-29 | uuv_manipulators_msgs |
Definitions of messages and services for the manipulator control package.
Definitions of messages and services for the manipulator control package.
|
||
| 1 | 2017-03-29 | uuv_manipulators_kinematics |
Implementation of interfaces to operate manipulators and grippers along with kinematics solver services.
Implementation of interfaces to operate manipulators and grippers along with kinematics solver services.
|
||
| 1 | 2017-03-29 | uuv_manipulators_description |
Common macros to build the robot description of manipulators.
Common macros to build the robot description of manipulators.
|
||
| 1 | 2017-03-29 | uuv_manipulators_control |
Cartesian and gripper controllers.
Cartesian and gripper controllers.
|
||
| 1 | 2017-03-29 | uuv_manipulators_commons |
Common nodes and configurations for underwater manipulators.
Common nodes and configurations for underwater manipulators.
|
||
| 1 | 2017-03-29 | uuv_gazebo_ros_plugins_msgs |
The uuv_gazebo_ros_plugins_msgs package
The uuv_gazebo_ros_plugins_msgs package
|
||
| 1 | 2017-03-29 | uuv_gazebo_ros_plugins |
The uuv_gazebo_ros_plugins package
The uuv_gazebo_ros_plugins package
|
||
| 1 | 2017-03-29 | uuv_gazebo_plugins |
The uuv_gazebo_plugins package
The uuv_gazebo_plugins package
|
||
| 1 | 2017-03-29 | uuv_gazebo |
The uuv_gazebo package
The uuv_gazebo package
|
||
| 1 | 2017-03-29 | uuv_filtered_joy |
The uuv_filtered_joy package
The uuv_filtered_joy package
|
||
| 1 | 2017-03-29 | uuv_descriptions |
The uuv_descriptions package
The uuv_descriptions package
|
||
| 1 | 2017-03-29 | uuv_control_cascaded_pid |
A cascade of PID controllers for acceleration, velocity, and position control.
A cascade of PID controllers for acceleration, velocity, and position control.
|
||
| 1 | 2017-03-29 | uuv_auv_teleop |
The uuv_auv_teleop package
The uuv_auv_teleop package
|
||
| 1 | 2017-03-29 | uuv_assistants |
Tools and utilities to monitor and analyze the simulation
Tools and utilities to monitor and analyze the simulation
|
||
| 1 | 2017-03-29 | oberon_teleop |
The oberon_teleop package
The oberon_teleop package
|
||
| 1 | 2017-03-29 | oberon_description |
The oberon_description package
The oberon_description package
|
||
| 1 | 2017-03-29 | oberon_control |
Package with configuration and launch files to control the Oberon 7P manipulator.
Package with configuration and launch files to control the Oberon 7P manipulator.
|
||
| 1 | 2017-03-29 | oberon4_description |
The oberon4_description package
The oberon4_description package
|
||
| 1 | 2017-03-29 | oberon4_control |
The oberon4_control package
The oberon4_control package
|
||
| 1 | 2017-03-29 | oberon4 |
The oberon4 package
The oberon4 package
|
||
| 1 | 2017-03-29 | oberon |
The Schilling Robotics Oberon 7P metapackage
The Schilling Robotics Oberon 7P metapackage
|
||
| 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 | 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
|
||
| 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.
|
||
| 1 | 2017-03-07 | ipa_canopen_ros |
This package provides functionalities to communicate a ROS Node to CANopen devices
This package provides functionalities to communicate a ROS Node to CANopen devices
|
||
| 1 | 2017-03-07 | ipa_canopen_core |
ROS-independent CANopen C++ library.
User manual: https://github.com/ipa320/ipa_canopen/blob/master/ipa_canopen_core/doc/usermanual.pdf?raw=true
ROS-independent CANopen C++ library.
User manual: https://github.com/ipa320/ipa_canopen/blob/master/ipa_canopen_core/doc/usermanual.pdf?raw=true
|
||
| 1 | 2017-03-07 | ipa_canopen |
This stack includes packages that provide access to CANopen hardware through ROS messages, services and actions.
This stack includes packages that provide access to CANopen hardware through ROS messages, services and actions.
|
||
| 1 | 2017-03-06 | jskeus |
EusLisp software developed and used by JSK at The University of Tokyo
EusLisp software developed and used by JSK at The University of Tokyo
|
||
| 1 | 2017-02-20 | dynamixel_tutorials |
Example configuration and launch file for dynamixel_motor stack.
Example configuration and launch file for dynamixel_motor stack.
|
||
| 1 | 2017-02-20 | dynamixel_msgs |
Common messages used throughout dynamixel_motor stack.
Common messages used throughout dynamixel_motor stack.
|
||
| 1 | 2017-02-20 | dynamixel_motor |
This stack contains packages that are used to interface with Robotis
Dynamixel line of servo motors. This stack was tested with and fully
supports AX-12, AX-18, RX-24, RX-28, MX-28, RX-64, MX-64, EX-106 and
MX-106 models.
This stack contains packages that are used to interface with Robotis
Dynamixel line of servo motors. This stack was tested with and fully
supports AX-12, AX-18, RX-24, RX-28, MX-28, RX-64, MX-64, EX-106 and
MX-106 models.
|
||
| 1 | 2017-02-20 | dynamixel_driver |
This package provides low level IO for Robotis Dynamixel servos.
Fully supports and was tested with AX-12, AX-18, RX-24, RX-28,
MX-28, RX-64, EX-106 models. Hardware specific constants are
defined for reading and writing information from/to Dynamixel
servos. This low level package won't be used directly by most
ROS users. The higher level dynamixel_controllers and specific
robot joint controllers make use of this package.
This package provides low level IO for Robotis Dynamixel servos.
Fully supports and was tested with AX-12, AX-18, RX-24, RX-28,
MX-28, RX-64, EX-106 models. Hardware specific constants are
defined for reading and writing information from/to Dynamixel
servos. This low level package won't be used directly by most
ROS users. The higher level dynamixel_controllers and specific
robot joint controllers make use of this package.
|
||
| 1 | 2017-02-20 | dynamixel_controllers |
This package contains a configurable node, services and a spawner script
to start, stop and restart one or more controller plugins. Reusable
controller types are defined for common Dynamixel motor joints. Both speed and
torque can be set for each joint. This python package can be used by more
specific robot controllers and all configurable parameters can be loaded
via a yaml file.
This package contains a configurable node, services and a spawner script
to start, stop and restart one or more controller plugins. Reusable
controller types are defined for common Dynamixel motor joints. Both speed and
torque can be set for each joint. This python package can be used by more
specific robot controllers and all configurable parameters can be loaded
via a yaml file.
|
||
| 2 | 2017-02-03 | moveit_full_pr2 |
All MoveIt components, plugins and PR2-specific plugins
All MoveIt components, plugins and PR2-specific plugins
|
||
| 2 | 2017-02-03 | moveit_full |
All MoveIt components and plugins
All MoveIt components and plugins
|
||
| 1 | 2017-02-02 | object_recognition_core |
object_recognition_core contains tools to launch several recognition pipelines, train objects, store models ...
object_recognition_core contains tools to launch several recognition pipelines, train objects, store models ...
|
||
| 1 | 2017-02-01 | robot_instance |
The robot_instance package
The robot_instance package
|
||
| 1 | 2017-01-20 | pepper_meshes |
meshes for the Aldebaran Robotics Pepper
meshes for the Aldebaran Robotics Pepper
|
||
| 1 | 2017-01-20 | nao_moveit_config |
An automatically generated package with all the configuration and launch files for using the NAO robot with the MoveIt Motion Planning Framework
An automatically generated package with all the configuration and launch files for using the NAO robot with the MoveIt Motion Planning Framework
|
||
| 1 | 2017-01-20 | nao_meshes |
meshes for the Aldebaran Robotics NAO
meshes for the Aldebaran Robotics NAO
|
||
| 1 | 2017-01-11 | staro_moveit_config |
An automatically generated package with all the configuration and launch files for using the STARO with the MoveIt Motion Planning Framework
An automatically generated package with all the configuration and launch files for using the STARO with the MoveIt Motion Planning Framework
|
||
| 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 | 2017-01-11 | moveit_eus_ik_plugin |
moveit_eus_ik_plugin
moveit_eus_ik_plugin
|
||
| 1 | 2017-01-11 | hrpsys_gazebo_msgs |
hrpsys_gazebo_msgs
hrpsys_gazebo_msgs
|