Packages
Packages
| Name | Description | ||||
|---|---|---|---|---|---|
| 1 | rospeex_msgs | ||||
| 1 | rospeex_launch | ||||
| 1 | rospeex_if | ||||
| 1 | rospeex_core | ||||
| 1 | rospeex_audiomonitor | ||||
| 1 | rospeex | ||||
| 1 | rospatlite | ||||
| 2 | rosparam_shortcuts | ||||
| 1 | rosparam_handler | ||||
| 2 | rosparam | ||||
| 1 | rospack | ||||
| 2 | rosout | ||||
| 1 | rosnode_rtc | ||||
| 2 | rosnode | ||||
| 2 | rosmsg | ||||
| 1 | rosmon_msgs | ||||
| 1 | rosmon_core | ||||
| 1 | rosmon | ||||
| 2 | rosmaster | ||||
| 1 | rosmake | ||||
| 2 | roslz4 | ||||
| 1 | roslisp_utilities | ||||
| 2 | roslisp_repl | ||||
| 1 | roslisp_common | ||||
| 1 | roslisp | ||||
| 1 | roslint | ||||
| 1 | roslibjs_experimental | ||||
| 1 | roslibjs | ||||
| 1 | roslib | ||||
| 2 | roslaunch | ||||
| 1 | roslang | ||||
| 1 | rosjson_time | ||||
| 1 | rosjson | ||||
| 1 | rosjava_test_msgs | ||||
| 1 | rosjava_messages | ||||
| 1 | rosjava_extras | ||||
| 1 | rosjava_dynamic_reconfigure | ||||
| 1 | rosjava_core | ||||
| 1 | rosjava_build_tools | ||||
| 1 | rosjava_bootstrap | ||||
| 1 | rosjava | ||||
| 2 | 2018-06-23 | rosidl_typesupport_opensplice_cpp |
Generate the C++ interfaces for PrismTech OpenSplice.
Generate the C++ interfaces for PrismTech OpenSplice.
|
||
| 2 | 2018-06-23 | rosidl_typesupport_opensplice_c |
Generate the C interfaces for PrismTech OpenSplice.
Generate the C interfaces for PrismTech OpenSplice.
|
||
| 1 | 2018-06-28 | rosidl_typesupport_introspection_cpp |
Generate the message type support for dynamic message construction in C++.
Generate the message type support for dynamic message construction in C++.
|
||
| 1 | 2018-06-28 | rosidl_typesupport_introspection_c |
Generate the message type support for dynamic message construction in C.
Generate the message type support for dynamic message construction in C.
|
||
| 1 | 2018-06-28 | rosidl_typesupport_interface |
The interface for rosidl typesupport packages.
The interface for rosidl typesupport packages.
|
||
| 1 | rosidl_typesupport_fastrtps_cpp | ||||
| 1 | rosidl_typesupport_fastrtps_c | ||||
| 1 | 2018-06-24 | rosidl_typesupport_cpp |
Generate the type support for C++ messages.
Generate the type support for C++ messages.
|
||
| 2 | 2018-06-28 | rosidl_typesupport_connext_cpp |
Generate the C++ interfaces for RTI Connext.
Generate the C++ interfaces for RTI Connext.
|
Packages
| Name | Description | ||||
|---|---|---|---|---|---|
| 1 | segbot_firmware | ||||
| 1 | segbot_description | ||||
| 1 | segbot_concert_services | ||||
| 1 | segbot_bringup | ||||
| 1 | segbot_arm_tutorials | ||||
| 1 | segbot_arm_tasks | ||||
| 1 | segbot_arm_manipulation | ||||
| 1 | segbot_arm_joystick | ||||
| 1 | segbot_apps | ||||
| 1 | segbot | ||||
| 1 | sdf_tracker | ||||
| 1 | scriptable_monitoring | ||||
| 1 | scriptable_monitor_rqt | ||||
| 1 | scriptable_monitor | ||||
| 0 | scriptable_analyzer | ||||
| 1 | screenrun | ||||
| 1 | scratch4robots | ||||
| 1 | scratch3-ros | ||||
| 1 | sciurus17_vision | ||||
| 1 | sciurus17_tools | ||||
| 1 | sciurus17_msgs | ||||
| 1 | sciurus17_moveit_config | ||||
| 1 | sciurus17_gazebo | ||||
| 1 | sciurus17_examples | ||||
| 1 | sciurus17_description | ||||
| 1 | sciurus17_control | ||||
| 1 | sciurus17_bringup | ||||
| 1 | sciurus17 | ||||
| 1 | schunk_svh_driver | ||||
| 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 | schunk_robots | ||||
| 1 | schunk_pw70 | ||||
| 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, ...
|
||
| 2 | schunk_pg70 | ||||
| 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 | schunk_lwa4p_extended | ||||
| 1 | schunk_lwa4p | ||||
| 1 | schunk_lwa4d_moveit_config | ||||
| 1 | schunk_lwa4d | ||||
| 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 | schunk_grippers | ||||
| 1 | schunk_ezn64 | ||||
| 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 | schunk_canopen_driver | ||||
| 1 | 2016-05-05 | scheduler_msgs |
Messages used by the rocon scheduler.
Messages used by the rocon scheduler.
|
||
| 0 | scanning_table_msgs | ||||
| 1 | scan_tools | ||||
| 1 | scan_to_cloud_converter | ||||
| 2 | 2019-05-21 | sbpl_interface_ros |
sbpl_interface_ros
sbpl_interface_ros
|
Packages
| Name | Description | ||||
|---|---|---|---|---|---|
| 1 | rviz_common | ||||
| 1 | rviz_backdrop | ||||
| 1 | rviz_assimp_vendor | ||||
| 1 | rviz_animated_view_controller | ||||
| 1 | rviz2 | ||||
| 1 | rv7fl_moveit_config | ||||
| 1 | rv4fl_moveit_config | ||||
| 1 | rttest | ||||
| 1 | 2019-05-15 | rtt_visualization_msgs |
Provides an rtt typekit for ROS visualization_msgs messages.
It allows you to use ROS messages transparently in
RTT components and applications.
This package was automatically generated by the
create_rtt_msgs generator and should not be manually
modified.
See the http://ros.org/wiki/visualization_msgs documentation
for the documentation of the ROS messages in this
typekit.
Provides an rtt typekit for ROS visualization_msgs messages.
It allows you to use ROS messages transparently in
RTT components and applications.
This package was automatically generated by the
create_rtt_msgs generator and should not be manually
modified.
See the http://ros.org/wiki/visualization_msgs documentation
for the documentation of the ROS messages in this
typekit.
|
||
| 1 | rtt_typelib | ||||
| 1 | 2019-05-15 | rtt_trajectory_msgs |
Provides an rtt typekit for ROS trajectory_msgs messages.
It allows you to use ROS messages transparently in
RTT components and applications.
This package was automatically generated by the
create_rtt_msgs generator and should not be manually
modified.
See the http://ros.org/wiki/trajectory_msgs documentation
for the documentation of the ROS messages in this
typekit.
Provides an rtt typekit for ROS trajectory_msgs messages.
It allows you to use ROS messages transparently in
RTT components and applications.
This package was automatically generated by the
create_rtt_msgs generator and should not be manually
modified.
See the http://ros.org/wiki/trajectory_msgs documentation
for the documentation of the ROS messages in this
typekit.
|
||
| 1 | 2019-05-15 | rtt_tf2_msgs |
Provides an rtt typekit for ROS tf2_msgs messages.
It allows you to use ROS messages transparently in
RTT components and applications.
This package was automatically generated by the
create_rtt_msgs generator and should not be manually
modified.
See the http://ros.org/wiki/tf2_msgs documentation
for the documentation of the ROS messages in this
typekit.
Provides an rtt typekit for ROS tf2_msgs messages.
It allows you to use ROS messages transparently in
RTT components and applications.
This package was automatically generated by the
create_rtt_msgs generator and should not be manually
modified.
See the http://ros.org/wiki/tf2_msgs documentation
for the documentation of the ROS messages in this
typekit.
|
||
| 1 | 2019-05-15 | rtt_stereo_msgs |
Provides an rtt typekit for ROS stereo_msgs messages.
It allows you to use ROS messages transparently in
RTT components and applications.
This package was automatically generated by the
create_rtt_msgs generator and should not be manually
modified.
See the http://ros.org/wiki/stereo_msgs documentation
for the documentation of the ROS messages in this
typekit.
Provides an rtt typekit for ROS stereo_msgs messages.
It allows you to use ROS messages transparently in
RTT components and applications.
This package was automatically generated by the
create_rtt_msgs generator and should not be manually
modified.
See the http://ros.org/wiki/stereo_msgs documentation
for the documentation of the ROS messages in this
typekit.
|
||
| 1 | 2019-05-15 | rtt_std_srvs |
Provides an rtt typekit for ROS std_msgs messages.
It allows you to use ROS messages transparently in
RTT components and applications.
This package was automatically generated by the
create_rtt_msgs generator and should not be manually
modified.
See the http://ros.org/wiki/std_msgs documentation
for the documentation of the ROS messages in this
typekit.
Provides an rtt typekit for ROS std_msgs messages.
It allows you to use ROS messages transparently in
RTT components and applications.
This package was automatically generated by the
create_rtt_msgs generator and should not be manually
modified.
See the http://ros.org/wiki/std_msgs documentation
for the documentation of the ROS messages in this
typekit.
|
||
| 1 | 2019-05-15 | rtt_std_msgs |
Provides an rtt typekit for ROS std_msgs messages.
It allows you to use ROS messages transparently in
RTT components and applications.
This package was automatically generated by the
create_rtt_msgs generator and should not be manually
modified.
See the http://ros.org/wiki/std_msgs documentation
for the documentation of the ROS messages in this
typekit.
Provides an rtt typekit for ROS std_msgs messages.
It allows you to use ROS messages transparently in
RTT components and applications.
This package was automatically generated by the
create_rtt_msgs generator and should not be manually
modified.
See the http://ros.org/wiki/std_msgs documentation
for the documentation of the ROS messages in this
typekit.
|
||
| 1 | 2019-05-15 | rtt_shape_msgs |
Provides an rtt typekit for ROS shape_msgs messages.
It allows you to use ROS messages transparently in
RTT components and applications.
This package was automatically generated by the
create_rtt_msgs generator and should not be manually
modified.
See the http://ros.org/wiki/shape_msgs documentation
for the documentation of the ROS messages in this
typekit.
Provides an rtt typekit for ROS shape_msgs messages.
It allows you to use ROS messages transparently in
RTT components and applications.
This package was automatically generated by the
create_rtt_msgs generator and should not be manually
modified.
See the http://ros.org/wiki/shape_msgs documentation
for the documentation of the ROS messages in this
typekit.
|
||
| 1 | 2019-05-15 | rtt_sensor_msgs |
Provides an rtt typekit for ROS sensor_msgs messages.
It allows you to use ROS messages transparently in
RTT components and applications.
This package was automatically generated by the
create_rtt_msgs generator and should not be manually
modified.
See the http://ros.org/wiki/sensor_msgs documentation
for the documentation of the ROS messages in this
typekit.
Provides an rtt typekit for ROS sensor_msgs messages.
It allows you to use ROS messages transparently in
RTT components and applications.
This package was automatically generated by the
create_rtt_msgs generator and should not be manually
modified.
See the http://ros.org/wiki/sensor_msgs documentation
for the documentation of the ROS messages in this
typekit.
|
||
| 1 | 2019-05-15 | rtt_rosparam_tests |
The rtt_rosparam_tests package
The rtt_rosparam_tests package
|
||
| 1 | 2019-05-15 | rtt_rospack_tests |
The rtt_ros_tests package
The rtt_ros_tests package
|
||
| 1 | 2019-05-15 | rtt_rosnode |
This package provides an RTT plugin to add a ROS node to the RTT process.
This package provides an RTT plugin to add a ROS node to the RTT process.
|
||
| 1 | 2019-05-15 | rtt_rosgraph_msgs |
Provides an rtt typekit for ROS rosgraph_msgs messages.
It allows you to use ROS messages transparently in
RTT components and applications.
This package was automatically generated by the
create_rtt_msgs generator and should not be manually
modified.
See the http://ros.org/wiki/rosgraph_msgs documentation
for the documentation of the ROS messages in this
typekit.
Provides an rtt typekit for ROS rosgraph_msgs messages.
It allows you to use ROS messages transparently in
RTT components and applications.
This package was automatically generated by the
create_rtt_msgs generator and should not be manually
modified.
See the http://ros.org/wiki/rosgraph_msgs documentation
for the documentation of the ROS messages in this
typekit.
|
||
| 1 | 2019-05-15 | rtt_roscomm_tests |
The rtt_roscomm_tests package
The rtt_roscomm_tests package
|
||
| 1 | 2019-05-15 | rtt_rosbuild_tests |
rtt_ros_rosbuild_test
rtt_ros_rosbuild_test
|
||
| 1 | 2019-05-15 | rtt_ros_tests |
The rtt_ros_tests package
The rtt_ros_tests package
|
||
| 1 | 2019-05-15 | 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 | 2019-05-15 | 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 | 2019-05-15 | rtt_ros_comm |
The rtt_ros_comm package
The rtt_ros_comm package
|
||
| 1 | 2019-05-15 | 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 | 2019-05-15 | rtt_kdl_conversions |
This package contains the components of the kdl_conversions package
This package contains the components of the kdl_conversions package
|
||
| 1 | 2019-05-15 | rtt_geometry_msgs |
Provides an rtt typekit for ROS geometry_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/geometry_msgs documentation
for the documentation of the ROS messages in this
typekit.
Provides an rtt typekit for ROS geometry_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/geometry_msgs documentation
for the documentation of the ROS messages in this
typekit.
|
||
| 1 | 2019-05-16 | rtt_geometry |
This metapackage contains tools for integrating the Orocos Kinematics and
Dynamics Library (KDL) with the Orocos Toolchain and Real-Time Toolkit
(RTT).
This metapackage contains tools for integrating the Orocos Kinematics and
Dynamics Library (KDL) with the Orocos Toolchain and Real-Time Toolkit
(RTT).
|
||
| 1 | 2019-05-15 | rtt_dynamic_reconfigure_tests |
The rtt_dynamic_reconfigure_tests package
The rtt_dynamic_reconfigure_tests package
|
||
| 1 | 2019-05-15 | rtt_diagnostic_msgs |
Provides an rtt typekit for ROS diagnostic_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/diagnostic_msgs documentation
for the documentation of the ROS messages in this
typekit.
Provides an rtt typekit for ROS diagnostic_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/diagnostic_msgs documentation
for the documentation of the ROS messages in this
typekit.
|
||
| 1 | rtt_controller_manager_msgs | ||||
| 1 | rtt_control_msgs | ||||
| 2 | rtt_conman_msgs | ||||
| 1 | 2019-05-15 | rtt_common_msgs |
The rtt_common_msgs package
The rtt_common_msgs package
|
||
| 1 | 2019-05-15 | rtt_actionlib_msgs |
Provides an rtt typekit for ROS actionlib_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/actionlib_msgs documentation
for the documentation of the ROS messages in this
typekit.
Provides an rtt typekit for ROS actionlib_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/actionlib_msgs documentation
for the documentation of the ROS messages in this
typekit.
|
||
| 1 | rtshell | ||||
| 1 | rtmros_nextage | ||||
| 1 | rtmros_hironx | ||||
| 1 | rtmros_common | ||||
| 1 | rtmbuild | ||||
| 1 | rsync_ros | ||||
| 1 | rsv_balance_viz | ||||
| 1 | rsv_balance_simulator | ||||
| 1 | rsv_balance_rqt | ||||
| 1 | rsv_balance_msgs | ||||
| 1 | rsv_balance_gazebo_control | ||||
| 1 | rsv_balance_gazebo |
Packages
| Name | Description | ||||
|---|---|---|---|---|---|
| 1 | 2018-03-26 | thormang3_walking_module_msgs |
This package is a set of messages and services for using thormang3_walking_module.
This package is a set of messages and services for using thormang3_walking_module.
|
||
| 1 | 2018-03-27 | thormang3_walking_module |
This package is a motion module for thormang3 walking.
This package provides a online walking pattern generator for the thormang3.
This package is a motion module for thormang3 walking.
This package provides a online walking pattern generator for the thormang3.
|
||
| 1 | 2018-03-28 | thormang3_walking_demo |
The thormang3_walking_demo package
This package describes how to use thormang3_walking_module.
The thormang3_walking_demo package
This package describes how to use thormang3_walking_module.
|
||
| 1 | 2018-04-19 | thormang3_tools |
ROS packages for the thormang3_tools (meta package)
ROS packages for the thormang3_tools (meta package)
|
||
| 1 | 2018-03-28 | thormang3_sensors |
This package contains sensor related launch files.
The package also includes a node for assembling Laserscan(LaserScan to PointCloud)
This package contains sensor related launch files.
The package also includes a node for assembling Laserscan(LaserScan to PointCloud)
|
||
| 1 | 2018-03-28 | thormang3_ppc |
ROS packages for the thormang3_ppc (meta package)
ROS packages for the thormang3_ppc (meta package)
|
||
| 1 | 2018-04-19 | thormang3_opc |
ROS packages for the thormang3_opc (meta package)
ROS packages for the thormang3_opc (meta package)
|
||
| 1 | 2018-04-19 | thormang3_offset_tuner_server |
The offset_tuner_server package
The offset_tuner_server package
|
||
| 1 | 2018-03-26 | thormang3_offset_tuner_msgs |
This package is a set of messages and services for using thormang3_offset_tuner.
This package is a set of messages and services for using thormang3_offset_tuner.
|
||
| 1 | 2018-04-19 | thormang3_offset_tuner_client |
The GUI program that can adjust offset of THORMANG3.
It is used with the thormang3_offset_tuner_server.
The GUI program that can adjust offset of THORMANG3.
It is used with the thormang3_offset_tuner_server.
|
||
| 1 | 2018-04-19 | thormang3_navigation |
This package is for generating footsteps.
It has several config files and launch files in order to use footstep planner package.
This package is for generating footsteps.
It has several config files and launch files in order to use footstep planner package.
|
||
| 1 | 2018-03-26 | thormang3_msgs |
ROS packages for the thormang3_msgs (meta package)
ROS packages for the thormang3_msgs (meta package)
|
||
| 1 | 2018-03-27 | thormang3_mpc_sensors |
ROS packages for the thormang3_mpc_sensors (meta package)
ROS packages for the thormang3_mpc_sensors (meta package)
|
||
| 1 | 2018-03-27 | thormang3_mpc |
ROS packages for the thormang3_mpc (meta package)
ROS packages for the thormang3_mpc (meta package)
|
||
| 1 | 2018-03-26 | thormang3_manipulation_module_msgs |
This package is a set of messages and services for using thormang3_manipulation_module.
This package is a set of messages and services for using thormang3_manipulation_module.
|
||
| 1 | 2018-03-27 | thormang3_manipulation_module |
This package describes basic function to control THORMANG3's upper-body.
This module is based on position control.
We provide joint space and task space control (forward kinematics, inverse kinematics).
This package describes basic function to control THORMANG3's upper-body.
This module is based on position control.
We provide joint space and task space control (forward kinematics, inverse kinematics).
|
||
| 1 | 2018-03-28 | thormang3_manipulation_demo |
The thormang3_manipulation_demo package
The thormang3_manipulation_demo package
|
||
| 1 | 2018-03-27 | thormang3_manager |
This package describes robot manager to execute THORMANG3's motion modules.
This package describes robot manager to execute THORMANG3's motion modules.
|
||
| 1 | 2018-03-27 | thormang3_kinematics_dynamics |
This package provides a kinematics and dynamics impletation for the thormang3.
It can be used to calculate forward and inverse kinematics.
This package provides a kinematics and dynamics impletation for the thormang3.
It can be used to calculate forward and inverse kinematics.
|
||
| 1 | 2018-03-26 | thormang3_head_control_module_msgs |
This package is a set of messages and services for using thormang3_head_control_module.
This package is a set of messages and services for using thormang3_head_control_module.
|
||
| 1 | 2018-03-27 | thormang3_head_control_module |
A module to control the head.
This module is included in the Thormang3 Manager as a library.
A module to control the head.
This module is included in the Thormang3 Manager as a library.
|
||
| 1 | 2018-03-27 | thormang3_gripper_module |
The thormang3_gripper_module package
The thormang3_gripper_module package
|
||
| 1 | 2018-03-28 | thormang3_gazebo |
This package provides basic message pub and launch file to use Thormang3 on Gazebo
This package provides basic message pub and launch file to use Thormang3 on Gazebo
|
||
| 1 | 2018-04-19 | thormang3_foot_step_generator |
This package provides foot step generation for the thormang3
This package provides foot step generation for the thormang3
|
||
| 1 | 2018-03-26 | thormang3_feet_ft_module_msgs |
This package is a set of messages and services for using thormang3_feet_ft_module.
This package is a set of messages and services for using thormang3_feet_ft_module.
|
||
| 1 | 2018-03-27 | thormang3_feet_ft_module |
This package is a sensor module for force torque sensors on feet.
This package is a sensor module for force torque sensors on feet.
|
||
| 1 | 2018-03-28 | thormang3_description |
3D models of the Thormang3 for simulation and visualization
3D models of the Thormang3 for simulation and visualization
|
||
| 1 | 2018-04-19 | thormang3_demo |
A GUI program for controlling a THORMANG3.
Initial posture, walking, manipulation, head control are available with this package.
A GUI program for controlling a THORMANG3.
Initial posture, walking, manipulation, head control are available with this package.
|
||
| 1 | 2018-03-28 | thormang3_common |
ROS packages for the thormang3_common (meta package)
ROS packages for the thormang3_common (meta package)
|
||
| 1 | 2018-03-27 | thormang3_base_module |
The thormang3_base_module package
The thormang3_base_module package
|
||
| 1 | 2018-03-27 | thormang3_balance_control |
The thormang3_balance_control package
This balance control is based on PD control.
The thormang3_balance_control package
This balance control is based on PD control.
|
||
| 1 | 2018-04-19 | thormang3_action_script_player |
This package provides a action script playing for thormang3.
It can be used with thormang3_action_module and ros_mpg321_player.
This package provides a action script playing for thormang3.
It can be used with thormang3_action_module and ros_mpg321_player.
|
||
| 1 | 2018-03-26 | thormang3_action_module_msgs |
This package is a set of messages and services for using thormang3_action_module.
This package is a set of messages and services for using thormang3_action_module.
|
||
| 1 | 2018-03-27 | thormang3_action_module |
This package is a motion module that can play the saved action.
This module is based on position control.
This package is a motion module that can play the saved action.
This module is based on position control.
|
||
| 1 | 2018-04-19 | thormang3_action_editor |
The thormang3_action_editor package
This package is a action editor for thormang3.
The action file which is edited by this editor will be used with this action editor.
The thormang3_action_editor package
This package is a action editor for thormang3.
The action file which is edited by this editor will be used with this action editor.
|
||
| 1 | thingmagic_rfid | ||||
| 0 | thermaleye_msgs | ||||
| 1 | 2016-10-03 | theora_image_transport |
Theora_image_transport provides a plugin to image_transport for
transparently sending an image stream encoded with the Theora codec.
Theora_image_transport provides a plugin to image_transport for
transparently sending an image stream encoded with the Theora codec.
|
||
| 1 | 2018-06-18 | tf_tools |
ROS tools and scripts relates to tf
ROS tools and scripts relates to tf
|
||
| 1 | 2018-08-13 | tf_publisher_gui |
This is a simple GUI for publishing a single TF transform.
This is a simple GUI for publishing a single TF transform.
|
||
| 0 | tf_lookup | ||||
| 1 | 2018-07-06 | 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).
|
||
| 2 | 2018-11-16 | tf2_tools |
tf2_tools
tf2_tools
|
||
| 2 | 2018-11-16 | tf2_sensor_msgs |
Small lib to transform sensor_msgs with tf. Most notably, PointCloud2
Small lib to transform sensor_msgs with tf. Most notably, PointCloud2
|
||
| 2 | 2018-11-16 | tf2_ros |
This package contains the ROS bindings for the tf2 library, for both Python and C++.
This package contains the ROS bindings for the tf2 library, for both Python and C++.
|
||
| 1 | 2017-03-15 | tf2_relay |
Specialization of message_relay for tf2
Specialization of message_relay for tf2
|
||
| 2 | 2018-11-16 | tf2_py |
The tf2_py package
The tf2_py package
|
||
| 2 | 2018-11-16 | tf2_msgs |
tf2_msgs
tf2_msgs
|
||
| 2 | 2018-11-16 | tf2_kdl |
KDL binding for tf2
KDL binding for tf2
|
||
| 2 | 2018-11-16 | tf2_geometry_msgs |
tf2_geometry_msgs
tf2_geometry_msgs
|
Packages
| Name | Description | ||||
|---|---|---|---|---|---|
| 1 | 2017-03-12 | turtlebot_arm_moveit_demos |
The turtlebot_arm_moveit_demos package contains scripts to start playing with a turtlebot arm and MoveIt.
The turtlebot_arm_moveit_demos package contains scripts to start playing with a turtlebot arm and MoveIt.
|
||
| 1 | 2017-03-12 | turtlebot_arm_moveit_config |
An automatically generated package with all the configuration and launch files for using the turtlebot_arm with the MoveIt Motion Planning Framework
An automatically generated package with all the configuration and launch files for using the turtlebot_arm with the MoveIt Motion Planning Framework
|
||
| 1 | 2017-03-12 | turtlebot_arm_kinect_calibration |
turtlebot_arm_kinect_calibration allows calibration of a kinect to a TurtleBot arm,
including a kinect on-board and off-board the TurtleBot for more precise manipulation.
turtlebot_arm_kinect_calibration allows calibration of a kinect to a TurtleBot arm,
including a kinect on-board and off-board the TurtleBot for more precise manipulation.
|
||
| 1 | 2017-03-12 | turtlebot_arm_ikfast_plugin |
The turtlebot_arm_ikfast_plugin package
The turtlebot_arm_ikfast_plugin package
|
||
| 1 | 2017-03-12 | turtlebot_arm_description |
turtlebot_arm_description contains URDF files and meshes for the TurtleBot arm.
turtlebot_arm_description contains URDF files and meshes for the TurtleBot arm.
|
||
| 1 | 2017-03-12 | turtlebot_arm_bringup |
turtlebot_arm_bringup provides launch files for starting the drivers for the TurtleBot arm.
turtlebot_arm_bringup provides launch files for starting the drivers for the TurtleBot arm.
|
||
| 1 | 2017-03-12 | turtlebot_arm_block_manipulation |
turtlebot_arm_block_manipulation contains a demo allowing the TurtleBot arm
to manipulate small blocks on a level surface using interactive markers.
turtlebot_arm_block_manipulation contains a demo allowing the TurtleBot arm
to manipulate small blocks on a level surface using interactive markers.
|
||
| 1 | 2017-03-12 | turtlebot_arm |
The turtlebot arm meta package.
The turtlebot arm meta package.
|
||
| 1 | 2017-11-22 | turtlebot_apps |
turtlebot_apps is a group of simple demos and exmaples to run on your TurtleBot to help you get started with ROS and TurtleBot.
turtlebot_apps is a group of simple demos and exmaples to run on your TurtleBot to help you get started with ROS and TurtleBot.
|
||
| 1 | 2017-11-22 | turtlebot_actions |
turtlebot_actions provides several basic actionlib actions for the TurtleBot.
turtlebot_actions provides several basic actionlib actions for the TurtleBot.
|
||
| 1 | turtlebot_2dnav | ||||
| 1 | turtlebot3_teleop | ||||
| 1 | turtlebot3_slam | ||||
| 1 | turtlebot3_simulations | ||||
| 1 | turtlebot3_panorama | ||||
| 1 | turtlebot3_navigation | ||||
| 1 | turtlebot3_msgs | ||||
| 1 | turtlebot3_gazebo | ||||
| 1 | turtlebot3_follower | ||||
| 1 | turtlebot3_follow_filter | ||||
| 1 | turtlebot3_fake | ||||
| 1 | turtlebot3_example | ||||
| 1 | turtlebot3_description | ||||
| 1 | turtlebot3_bringup | ||||
| 1 | turtlebot3_autorace_detect | ||||
| 1 | turtlebot3_autorace_core | ||||
| 1 | turtlebot3_autorace_control | ||||
| 1 | turtlebot3_autorace_camera | ||||
| 1 | turtlebot3_autorace | ||||
| 1 | turtlebot3_automatic_parking_vision | ||||
| 1 | turtlebot3_automatic_parking | ||||
| 1 | turtlebot3_applications_msgs | ||||
| 1 | turtlebot3_applications | ||||
| 1 | turtlebot3 | ||||
| 1 | turtlebot2_teleop | ||||
| 1 | turtlebot2_follower | ||||
| 1 | turtlebot2_drivers | ||||
| 1 | turtlebot2_demo | ||||
| 1 | turtlebot2_cartographer | ||||
| 1 | turtlebot2_amcl | ||||
| 1 | 2017-11-23 | turtlebot |
The turtlebot meta package provides all the basic drivers for running and using a TurtleBot.
The turtlebot meta package provides all the basic drivers for running and using a TurtleBot.
|
||
| 1 | 2015-04-02 | turtle_tf2 |
turtle_tf2 demonstrates how to write a tf2 broadcaster and listener with the turtlesim. The tutle_tf2_listener commands turtle2 to follow turtle1 around as you drive turtle1 using the keyboard.
turtle_tf2 demonstrates how to write a tf2 broadcaster and listener with the turtlesim. The tutle_tf2_listener commands turtle2 to follow turtle1 around as you drive turtle1 using the keyboard.
|
||
| 1 | 2015-04-02 | turtle_tf |
turtle_tf demonstrates how to write a tf broadcaster and listener with the turtlesim. The tutle_tf_listener commands turtle2 to follow turtle1 around as you drive turtle1 using the keyboard.
turtle_tf demonstrates how to write a tf broadcaster and listener with the turtlesim. The tutle_tf_listener commands turtle2 to follow turtle1 around as you drive turtle1 using the keyboard.
|
||
| 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 | 2016-09-13 | tty0tty |
Linux null modem emulator
Linux null modem emulator
|
||
| 1 | tts | ||||
| 1 | 2015-04-23 | trivial_gray_streams |
3rd party library: trivial-gray-streams
3rd party library: trivial-gray-streams
|
||
| 1 | 2015-04-23 | trivial_garbage |
3rd party library: trivial-garbage
3rd party library: trivial-garbage
|
||
| 1 | 2015-04-23 | trivial_features |
3rd party library: trivial-features
3rd party library: trivial-features
|
||
| 1 | 2019-05-23 | trajectory_tracker_msgs |
Message definitions for trajectory_tracker package
Message definitions for trajectory_tracker package
|
Packages
| Name | Description | ||||
|---|---|---|---|---|---|
| 2 | rosparam | ||||
| 1 | rospack | ||||
| 2 | rosout | ||||
| 1 | rosnode_rtc | ||||
| 2 | rosnode | ||||
| 2 | rosmsg | ||||
| 1 | rosmon_msgs | ||||
| 1 | rosmon_core | ||||
| 1 | rosmon | ||||
| 2 | rosmaster | ||||
| 1 | rosmake | ||||
| 2 | roslz4 | ||||
| 1 | roslisp_utilities | ||||
| 2 | roslisp_repl | ||||
| 1 | roslisp_common | ||||
| 1 | roslisp | ||||
| 1 | roslint | ||||
| 1 | roslibjs_experimental | ||||
| 1 | roslibjs | ||||
| 1 | roslib | ||||
| 2 | roslaunch | ||||
| 1 | roslang | ||||
| 1 | rosjson_time | ||||
| 1 | rosjson | ||||
| 1 | rosjava_test_msgs | ||||
| 1 | rosjava_messages | ||||
| 1 | rosjava_extras | ||||
| 1 | rosjava_dynamic_reconfigure | ||||
| 1 | rosjava_core | ||||
| 1 | rosjava_build_tools | ||||
| 1 | rosjava_bootstrap | ||||
| 1 | rosjava | ||||
| 2 | 2017-12-08 | rosidl_typesupport_opensplice_cpp |
Generate the C++ interfaces for PrismTech OpenSplice.
Generate the C++ interfaces for PrismTech OpenSplice.
|
||
| 2 | 2017-12-08 | rosidl_typesupport_opensplice_c |
Generate the C interfaces for PrismTech OpenSplice.
Generate the C interfaces for PrismTech OpenSplice.
|
||
| 1 | 2018-02-07 | rosidl_typesupport_introspection_cpp |
Generate the message type support for dynamic message construction in C++.
Generate the message type support for dynamic message construction in C++.
|
||
| 1 | 2018-02-07 | rosidl_typesupport_introspection_c |
Generate the message type support for dynamic message construction in C.
Generate the message type support for dynamic message construction in C.
|
||
| 1 | 2018-02-07 | rosidl_typesupport_interface |
The interface for rosidl typesupport packages.
The interface for rosidl typesupport packages.
|
||
| 1 | rosidl_typesupport_fastrtps_cpp | ||||
| 1 | rosidl_typesupport_fastrtps_c | ||||
| 1 | 2017-12-08 | rosidl_typesupport_cpp |
Generate the type support for C++ messages.
Generate the type support for C++ messages.
|
||
| 2 | 2017-12-08 | rosidl_typesupport_connext_cpp |
Generate the C++ interfaces for RTI Connext.
Generate the C++ interfaces for RTI Connext.
|
||
| 2 | 2017-12-08 | rosidl_typesupport_connext_c |
Generate the C interfaces for RTI Connext.
Generate the C interfaces for RTI Connext.
|
||
| 1 | 2017-12-08 | rosidl_typesupport_c |
Generate the type support for C messages.
Generate the type support for C messages.
|
||
| 1 | rosidl_runtime_py | ||||
| 1 | 2018-02-07 | rosidl_parser |
The parser for ROS interface files.
The parser for ROS interface files.
|
||
| 2 | 2018-02-07 | rosidl_generator_py |
Generate the ROS interfaces in Python.
Generate the ROS interfaces in Python.
|
||
| 1 | 2017-12-08 | rosidl_generator_dds_idl |
Generate the DDS interfaces for ROS interfaces.
Generate the DDS interfaces for ROS interfaces.
|
||
| 1 | 2018-02-07 | rosidl_generator_cpp |
Generate the ROS interfaces in C++.
Generate the ROS interfaces in C++.
|
||
| 1 | 2018-02-07 | rosidl_generator_c |
Generate the ROS interfaces in C.
Generate the ROS interfaces in C.
|
||
| 2 | 2017-12-08 | rosidl_default_runtime |
A configuration package defining the runtime for the ROS interfaces.
A configuration package defining the runtime for the ROS interfaces.
|
Packages
Packages
| Name | Description | ||||
|---|---|---|---|---|---|
| 2 | 2015-11-03 | single_joint_position_action |
The single joint position action is a node that provides an action
interface for commanding a trajectory to move a joint to a particular
position. The action reports success when the joint reaches the desired
position.
The single joint position action is a node that provides an action
interface for commanding a trajectory to move a joint to a particular
position. The action reports success when the joint reaches the desired
position.
|
||
| 1 | 2014-09-18 | simulators |
A metapackage to aggregate several packages.
A metapackage to aggregate several packages.
|
||
| 1 | 2013-08-16 | simple_navigation_goals_tutorial |
The simple_navigation_goals_tutorial package
The simple_navigation_goals_tutorial package
|
||
| 1 | 2014-01-21 | 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.
|
||
| 0 | simple_grasping_action | ||||
| 1 | simple_grasping | ||||
| 1 | simple_drive | ||||
| 1 | simple_arm | ||||
| 1 | 2015-04-21 | simple_approximate_time_synchronizer |
simple_approximate_time_synchronizer
simple_approximate_time_synchronizer
|
||
| 1 | 2015-01-17 | siftgpu |
The SiftGPU library is an implementation of SIFT for GPU.
The SiftGPU library is an implementation of SIFT for GPU.
|
||
| 1 | siemens_cp1616 | ||||
| 1 | 2013-08-21 | sicktoolbox_wrapper |
sicktoolbox_wrapper is a ROS wrapper for the outstanding
sicktoolbox_wrapper is a ROS wrapper for the outstanding
|
||
| 1 | sick_visionary_t_driver | ||||
| 1 | sick_visionary_t | ||||
| 1 | 2015-06-03 | sick_tim |
A ROS driver for the SICK TiM series of laser scanners.
Currently, the pacakge supports serveral types of TiM310 and TiM551
scanners.
A ROS driver for the SICK TiM series of laser scanners.
Currently, the pacakge supports serveral types of TiM310 and TiM551
scanners.
|
||
| 1 | sick_scan | ||||
| 1 | sick_safetyscanners | ||||
| 1 | sick_ldmrs_tools | ||||
| 1 | sick_ldmrs_msgs | ||||
| 1 | sick_ldmrs_laser | ||||
| 1 | sick_ldmrs_driver | ||||
| 1 | sick_ldmrs_description | ||||
| 1 | shm_transport | ||||
| 0 | sherlock_sim_msgs | ||||
| 1 | 2014-07-02 | shared_serial |
Shared serial port with locking functionality
Shared serial port with locking functionality
|
||
| 1 | shared_queues_vendor | ||||
| 0 | shared_memory_transport | ||||
| 1 | shape_tracker | ||||
| 1 | shape_tools | ||||
| 1 | shape_reconstruction | ||||
| 2 | 2015-05-11 | shape_msgs |
This package contains messages for defining shapes, such as simple solid
object primitives (cube, sphere, etc), planes, and meshes.
This package contains messages for defining shapes, such as simple solid
object primitives (cube, sphere, etc), planes, and meshes.
|
||
| 1 | 2014-09-19 | shadow_robot_ethercat |
This stack contains the drivers and the controllers for Shadow Robot's EtherCAT Hand.
This stack contains the drivers and the controllers for Shadow Robot's EtherCAT Hand.
|
||
| 1 | 2014-09-29 | shadow_robot |
This stack regroups the different ros interfaces developped for Shadow Robot's
Hardware. It provides an interface to both simulated and real hardware.
This stack regroups the different ros interfaces developped for Shadow Robot's
Hardware. It provides an interface to both simulated and real hardware.
|
||
| 1 | sf30_node | ||||
| 1 | 2016-09-25 | settlerlib |
Defines helper functions and routines that greatly help when trying to create a settler
for a specific sensor channel. This package is experimental and unstable.
Expect its APIs to change.
Defines helper functions and routines that greatly help when trying to create a settler
for a specific sensor channel. This package is experimental and unstable.
Expect its APIs to change.
|
||
| 1 | session_tutorials | ||||
| 1 | service_tools | ||||
| 0 | service_runtime | ||||
| 0 | service_generation | ||||
| 1 | 2013-09-18 | serial_utils |
A package which adds useful additions to the serial package.
A package which adds useful additions to the serial package.
|
||
| 1 | 2014-02-17 | sensorhand_speed |
ROS driver package for the Otto Bock SensorHand Speed prosthetics device.
ROS driver package for the Otto Bock SensorHand Speed prosthetics device.
|
||
| 0 | sensor_to_cloud | ||||
| 2 | 2015-05-11 | sensor_msgs |
This package defines messages for commonly used sensors, including
cameras and scanning laser rangefinders.
This package defines messages for commonly used sensors, including
cameras and scanning laser rangefinders.
|
||
| 1 | sensor_module_tutorial | ||||
| 0 | sensor_fusion_comm | ||||
| 2 | 2018-04-25 | semantic_point_annotator |
A node which annotates 3D point cloud data with semantic labels.
A node which annotates 3D point cloud data with semantic labels.
|
||
| 1 | 2015-08-06 | self_test |
self_test
self_test
|
||
| 1 | 2014-08-13 | segwayrmp |
segwayrmp
segwayrmp
|
||
| 1 | 2015-03-31 | segbot_simulator |
ROS metapackage containing simulation components for the Segway
RMP 50 based research robots at the University of Texas at Austin.
ROS metapackage containing simulation components for the Segway
RMP 50 based research robots at the University of Texas at Austin.
|
||
| 2 | 2015-03-31 | segbot_simulation_apps |
Applications designed specifically to be used in a simulation
environment, such as opening and closing doors inside the building
simulation.
Applications designed specifically to be used in a simulation
environment, such as opening and closing doors inside the building
simulation.
|