-
 

Packages

Name Description
1 2024-05-15 ament_lint_auto
The auto-magic functions for ease to use of the ament linters in CMake.
The auto-magic functions for ease to use of the ament linters in CMake.
 
1 2024-05-15 ament_lint
Providing common API for ament linter packages.
Providing common API for ament linter packages.
 
1 2022-03-01 ament_index_python
Python API to access the ament resource index.
Python API to access the ament resource index.
 
1 2022-03-01 ament_index_cpp
C++ API to access the ament resource index.
C++ API to access the ament resource index.
 
1 2024-05-15 ament_flake8
The ability to check code for style and syntax conventions with flake8.
The ability to check code for style and syntax conventions with flake8.
 
1 2022-06-22 ament_download
CMake macros for downloading files with ament
CMake macros for downloading files with ament
 
1 2024-05-15 ament_cpplint
The ability to check code against the Google style conventions using cpplint and generate xUnit test result files.
The ability to check code against the Google style conventions using cpplint and generate xUnit test result files.
 
1 2024-05-15 ament_cppcheck
The ability to perform static code analysis on C/C++ code using Cppcheck and generate xUnit test result files.
The ability to perform static code analysis on C/C++ code using Cppcheck and generate xUnit test result files.
 
1 2024-05-15 ament_copyright
The ability to check source files for copyright and license information.
The ability to check source files for copyright and license information.
 
1 2024-05-15 ament_cmake_xmllint
The CMake API for ament_xmllint to check XML file using xmmlint.
The CMake API for ament_xmllint to check XML file using xmmlint.
 
1 2024-11-01 ament_cmake_version
The ability to override the exported package version in the ament buildsystem.
The ability to override the exported package version in the ament buildsystem.
 
1 2024-11-01 ament_cmake_vendor_package
Macros for maintaining a 'vendor' package.
Macros for maintaining a 'vendor' package.
 
1 2024-05-15 ament_cmake_uncrustify
The CMake API for ament_uncrustify to check code against styleconventions using uncrustify.
The CMake API for ament_uncrustify to check code against styleconventions using uncrustify.
 
1 2024-11-01 ament_cmake_test
The ability to add tests in the ament buildsystem in CMake.
The ability to add tests in the ament buildsystem in CMake.
 
1 2024-11-01 ament_cmake_target_dependencies
The ability to add definitions, include directories and libraries of a package to a target in the ament buildsystem in CMake.
The ability to add definitions, include directories and libraries of a package to a target in the ament buildsystem in CMake.
 
1 2022-01-13 ament_cmake_ros
The ROS specific CMake bits in the ament buildsystem.
The ROS specific CMake bits in the ament buildsystem.
 
1 2024-11-01 ament_cmake_python
The ability to use Python in the ament buildsystem in CMake.
The ability to use Python in the ament buildsystem in CMake.
 
1 2024-11-01 ament_cmake_pytest
The ability to run Python tests using pytest in the ament buildsystem in CMake.
The ability to run Python tests using pytest in the ament buildsystem in CMake.
 
1 2024-05-15 ament_cmake_pyflakes
The CMake API for ament_pyflakes to check code using pyflakes.
The CMake API for ament_pyflakes to check code using pyflakes.
 
1 2024-05-15 ament_cmake_pycodestyle
The CMake API for ament_pycodestyle to check code against the style conventions in PEP 8.
The CMake API for ament_pycodestyle to check code against the style conventions in PEP 8.
 
1 2024-05-15 ament_cmake_pep257
The CMake API for ament_pep257 to check code against the docstring style conventions in PEP 257.
The CMake API for ament_pep257 to check code against the docstring style conventions in PEP 257.
 
1 2024-05-15 ament_cmake_pclint
The CMake API for ament_pclint to perform static code analysis on C/C++ code using PC-lint.
The CMake API for ament_pclint to perform static code analysis on C/C++ code using PC-lint.
 
1 2024-11-01 ament_cmake_nose
The ability to add nose-based tests in the ament buildsystem in CMake.
The ability to add nose-based tests in the ament buildsystem in CMake.
 
1 2024-05-15 ament_cmake_mypy
The CMake API for ament_mypy to perform static type analysis on python code with mypy.
The CMake API for ament_mypy to perform static type analysis on python code with mypy.
 
1 2024-05-15 ament_cmake_lint_cmake
The CMake API for ament_lint_cmake to lint CMake code using cmakelint.
The CMake API for ament_lint_cmake to lint CMake code using cmakelint.
 
1 2024-11-01 ament_cmake_libraries
The functionality to deduplicate libraries in the ament buildsystem in CMake.
The functionality to deduplicate libraries in the ament buildsystem in CMake.
 
1 2024-11-01 ament_cmake_include_directories
The functionality to order include directories according to a chain of prefixes in the ament buildsystem in CMake.
The functionality to order include directories according to a chain of prefixes in the ament buildsystem in CMake.
 
1 2024-11-01 ament_cmake_gtest
The ability to add gtest-based tests in the ament buildsystem in CMake.
The ability to add gtest-based tests in the ament buildsystem in CMake.
 
1 2024-11-01 ament_cmake_google_benchmark
The ability to add Google Benchmark tests in the ament buildsystem in CMake.
The ability to add Google Benchmark tests in the ament buildsystem in CMake.
 
1 2024-11-01 ament_cmake_gmock
The ability to add Google mock-based tests in the ament buildsystem in CMake.
The ability to add Google mock-based tests in the ament buildsystem in CMake.
 
1 2024-11-01 ament_cmake_gen_version_h
Generate a C header containing the version number of the package
Generate a C header containing the version number of the package
 
1 2024-05-15 ament_cmake_flake8
The CMake API for ament_flake8 to check code syntax and style conventions with flake8.
The CMake API for ament_flake8 to check code syntax and style conventions with flake8.
 
1 2024-11-01 ament_cmake_export_targets
The ability to export targets to downstream packages in the ament buildsystem in CMake.
The ability to export targets to downstream packages in the ament buildsystem in CMake.
 
1 2024-11-01 ament_cmake_export_link_flags
The ability to export link flags to downstream packages in the ament buildsystem.
The ability to export link flags to downstream packages in the ament buildsystem.
 
1 2024-11-01 ament_cmake_export_libraries
The ability to export libraries to downstream packages in the ament buildsystem in CMake.
The ability to export libraries to downstream packages in the ament buildsystem in CMake.
 
1 2024-11-01 ament_cmake_export_interfaces
The ability to export interfaces to downstream packages in the ament buildsystem in CMake.
The ability to export interfaces to downstream packages in the ament buildsystem in CMake.
 
1 2024-11-01 ament_cmake_export_include_directories
The ability to export include directories to downstream packages in the ament buildsystem in CMake.
The ability to export include directories to downstream packages in the ament buildsystem in CMake.
 
1 2024-11-01 ament_cmake_export_dependencies
The ability to export dependencies to downstream packages in the ament buildsystem in CMake.
The ability to export dependencies to downstream packages in the ament buildsystem in CMake.
 
1 2024-11-01 ament_cmake_export_definitions
The ability to export definitions to downstream packages in the ament buildsystem.
The ability to export definitions to downstream packages in the ament buildsystem.
 
1 2024-05-15 ament_cmake_cpplint
The CMake API for ament_cpplint to lint C / C++ code using cpplint.
The CMake API for ament_cpplint to lint C / C++ code using cpplint.
 
1 2024-05-15 ament_cmake_cppcheck
The CMake API for ament_cppcheck to perform static code analysis on C/C++ code using Cppcheck.
The CMake API for ament_cppcheck to perform static code analysis on C/C++ code using Cppcheck.
 
1 2024-11-01 ament_cmake_core
The core of the ament buildsystem in CMake. Several subcomponents provide specific funtionalities: * environment: provide prefix-level setup files * environment_hooks: provide package-level setup files and environment hooks * index: store information in an index and retrieve them without crawling * package_templates: templates from the ament_package Python package * symlink_install: use symlinks for CMake install commands
The core of the ament buildsystem in CMake. Several subcomponents provide specific funtionalities: * environment: provide prefix-level setup files * environment_hooks: provide package-level setup files and environment hooks * index: store information in an index and retrieve them without crawling * package_templates: templates from the ament_package Python package * symlink_install: use symlinks for CMake install commands
 
1 2024-05-15 ament_cmake_copyright
The CMake API for ament_copyright to check every source file contains copyright reference.
The CMake API for ament_copyright to check every source file contains copyright reference.
 
1 2024-05-15 ament_cmake_clang_tidy
The CMake API for ament_clang_tidy to lint C / C++ code using clang tidy.
The CMake API for ament_clang_tidy to lint C / C++ code using clang tidy.
 
1 2024-05-15 ament_cmake_clang_format
The CMake API for ament_clang_format to lint C / C++ code using clang format.
The CMake API for ament_clang_format to lint C / C++ code using clang format.
 
1 2023-06-01 ament_cmake_catch2
Allows integrating catch2 tests in the ament buildsystem with CMake
Allows integrating catch2 tests in the ament buildsystem with CMake
 
2 2024-09-05 ament_cmake_black
The CMake API for ament_black to lint Python code using black.
The CMake API for ament_black to lint Python code using black.
 
1 2024-11-01 ament_cmake_auto
The auto-magic functions for ease to use of the ament buildsystem in CMake.
The auto-magic functions for ease to use of the ament buildsystem in CMake.
 
1 2024-11-01 ament_cmake
The entry point package for the ament buildsystem in CMake.
The entry point package for the ament buildsystem in CMake.
 
1 2024-05-15 ament_clang_tidy
The ability to check code against style conventions using clang-tidy and generate xUnit test result files.
The ability to check code against style conventions using clang-tidy and generate xUnit test result files.
 
1 2024-05-15 ament_clang_format
The ability to check code against style conventions using clang-format and generate xUnit test result files.
The ability to check code against style conventions using clang-format and generate xUnit test result files.
 
2 2024-09-05 ament_black
The ability to check code against style conventions using black and generate xUnit test result files.
The ability to check code against style conventions using black and generate xUnit test result files.
 
1 2022-03-23 ament_acceleration
CMake macros and utilities to include hardware acceleration into the ROS 2 build system (ament) and its development flows.
CMake macros and utilities to include hardware acceleration into the ROS 2 build system (ament) and its development flows.
 
1 2022-02-16 affordance_primitives
Library for affordance motion primitives.
Library for affordance motion primitives.
 
1 2024-11-18 aerostack2
Aerostack2 is a ROS2-based framework for the development of autonomous systems for aerial robotics.
Aerostack2 is a ROS2-based framework for the development of autonomous systems for aerial robotics.
 
1 2024-11-22 admittance_controller
Implementation of admittance controllers for different input and output interface.
Implementation of admittance controllers for different input and output interface.
 
2 2024-11-14 adi_tmcl
The adi_tmcl ROS2 package
The adi_tmcl ROS2 package
 
1 2024-10-27 adi_3dtof_image_stitching
The adi_3dtof_image_stitching package
The adi_3dtof_image_stitching package
 
1 2022-04-14 adaptive_component
A composable container for Adaptive ROS 2 Node computations. Allows building Nodes that can select between FPGA, CPU or GPU, at run-time. Stateless by default, can be made stateful to meet use-case specific needs. Refer to examples in README. Technically, provides A ROS 2 Node subclass programmed as a "Component" and including its own single threaded executor to build adaptive computations. Adaptive ROS 2 Nodes are able to perform computations in the CPU, the FPGA or the GPU, adaptively. Adaptive behavior is controlled through the "adaptive" ROS 2 parameter.
A composable container for Adaptive ROS 2 Node computations. Allows building Nodes that can select between FPGA, CPU or GPU, at run-time. Stateless by default, can be made stateful to meet use-case specific needs. Refer to examples in README. Technically, provides A ROS 2 Node subclass programmed as a "Component" and including its own single threaded executor to build adaptive computations. Adaptive ROS 2 Nodes are able to perform computations in the CPU, the FPGA or the GPU, adaptively. Adaptive behavior is controlled through the "adaptive" ROS 2 parameter.
 
1 2023-04-11 actuator_msgs
ROS 2 message interface for Actuators.
ROS 2 message interface for Actuators.
 
2 2024-05-20 actionlib_msgs
A package containing some message definitions used in the implementation of ROS 1 actions.
A package containing some message definitions used in the implementation of ROS 1 actions.
 
1 2024-07-26 action_tutorials_py
Python action tutorial code
Python action tutorial code
 
1 2024-07-26 action_tutorials_interfaces
Action tutorials action
Action tutorials action
 
1 2024-07-26 action_tutorials_cpp
C++ action tutorial cpp code
C++ action tutorial cpp code
 
1 2022-11-07 action_msgs
Messages and service definitions common among all ROS actions.
Messages and service definitions common among all ROS actions.
 
2 2024-11-22 ackermann_steering_controller
Steering controller for Ackermann kinematics. Rear fixed wheels are powering the vehicle and front wheels are steering it.
Steering controller for Ackermann kinematics. Rear fixed wheels are powering the vehicle and front wheels are steering it.
 
1 2022-02-08 ackermann_msgs
ROS2 messages for robots using Ackermann steering.
ROS2 messages for robots using Ackermann steering.
 
1 2021-04-12 acado_vendor
ament package for ACADO toolkit for MPC code generation
ament package for ACADO toolkit for MPC code generation
 
1 2023-09-19 aandd_ekew_driver_py
aandd ek/ew series driver python package
aandd ek/ew series driver python package
 
1 zstd_image_transport
1 zivid_samples
1 zivid_interfaces
1 zivid_camera
1 zeroconf_msgs
1 zenoh_c_vendor
1 zdepth_image_transport
1 zdepth
1 zbar_ros_interfaces
1 z_laser_zlp1
1 z_laser_viz
1 z_laser_projector
1 z_laser_msgs
1 z_laser_gui
1 yujin_yrl_package
1 yujin_ocs
1 ypspur_ros
1 ypspur
1 yosemite_valley
1 yocs_waypoints_navi
1 yocs_waypoint_provider
1 yocs_virtual_sensor
1 yocs_velocity_smoother
1 yocs_safety_controller
1 yocs_rapps
1 yocs_navigator
1 yocs_navi_toolkit
1 yocs_msgs
1 yocs_math_toolkit
1 yocs_localization_manager
1 yocs_keyop
1 yocs_joyop
1 yocs_diff_drive_pose_controller
1 yocs_controllers
1 yocs_cmd_vel_mux
1 yocs_ar_pair_tracking
1 yocs_ar_pair_approach
1 yocs_ar_marker_tracking
1 xv_11_laser_driver
1 xsens_mti_driver
1 xsens_driver
0 xsdcxx
1 xpp_vis
1 xpp_states
1 xpp_quadrotor
1 xpp_msgs
1 xpp_hyq
1 xpp_examples
1 xpp
1 xmlrpcpp
1 xaxxon_openlidar
0 wxWidgets
1 wu_ros_tools
1 ws281x
1 wrapyfi_ros_interfaces
0 world_model
1 witmotion_ros
1 willow_maps
1 wifi_ddwrt
1 2024-05-24 whill_msgs
WHILL Model CR2 interfaces package
WHILL Model CR2 interfaces package
 
1 2024-10-28 whill_examples
This package boot WHILL Model CR2
This package boot WHILL Model CR2
 
1 2024-10-28 whill_driver
WHILL Model CR2 driver package
WHILL Model CR2 driver package
 
1 2024-10-28 whill_description
WHILL Model CR2 description package
WHILL Model CR2 description package
 
1 2024-10-28 whill_bringup
This package boot WHILL Model CR2
This package boot WHILL Model CR2
 
1 2024-10-28 whill
ROS2 package for WHILL Model CR2
ROS2 package for WHILL Model CR2
 
1 wge100_driver
1 wge100_camera_firmware
1 wge100_camera
1 wfov_camera_msgs
1 webrtcvad_ros
1 webrtc_ros
1 webrtc
1 webots_ros
1 webkit_dependency
1 warthog_viz
1 warthog_simulator
1 warthog_msgs
1 warthog_gazebo
1 warthog_desktop
1 warthog_description
1 warthog_control
0 walking_utils
0 walking_controller
1 vtec_tracker
1 vtec_ros
1 vtec_msgs
1 vrpn_client_ros
0 vrpn
1 voxel_grid
1 volta_teleoperator
1 volta_simulation
1 volta_rules
1 volta_navigation
1 volta_msgs
1 volta_localization
1 volta_description
1 volta_control
1 volta_base
1 volksbot_driver
1 voice_text
1 vl53l1x
1 2024-11-18 vizanti_server
A mission planner and visualizer for controlling outdoor ROS robots.
A mission planner and visualizer for controlling outdoor ROS robots.
 
1 2024-11-18 vizanti_msgs
Interfaces for Vizanti.
Interfaces for Vizanti.
 
1 2024-11-18 vizanti_demos
Demonstration package for Vizanti
Demonstration package for Vizanti
 
1 2024-11-18 vizanti_cpp
An ament built package for any cpp nodes.
An ament built package for any cpp nodes.
 
1 2024-11-18 vizanti
Web mission planner and visualizer for controlling outdoor ROS robots.
Web mission planner and visualizer for controlling outdoor ROS robots.
 
1 viz
0 vive_ros
1 vive_localization
1 vive
1 visualstates
1 visualization_tutorials
1 visualization_rwt
1 visualization_osg
1 visualization_marker_tutorials
1 visp_tracker
1 visp_ros
1 visp_hand2eye_calibration
1 visp_camera_calibration
1 visp_bridge
1 visp_auto_tracker
0 visp
1 vision_visp
1 vision_common
1 virtual_scan
1 virtual_force_publisher
1 view_controller_msgs
1 video_stream_opencv
1 vesc_msgs
1 vesc_driver
1 vesc_ackermann

Packages

Name Description
1 tiago_laser_sensors
1 tiago_gazebo
1 tiago_description
1 tiago_controller_configuration
1 tiago_bringup
1 tiago_2dnav
1 thunder_line_follower_pmr3100
1 tf_to_pose_publisher
1 tf_static_publisher
1 tf_remapper_cpp
1 tf_conversions
1 tf2_web_republisher
1 tf2_urdf
1 tf2_server
1 tf2_relay
1 tf2_client
1 tf
1 2024-02-07 test_security
Test nodes, publishers and subscribers with DDS-Security.
Test nodes, publishers and subscribers with DDS-Security.
 
1 test_rostopic
1 test_rostest
1 test_rosservice
1 test_rospy
1 test_rosparam
1 test_rosmaster
1 test_roslib_comm
1 test_roslaunch
1 test_rosgraph
1 test_roscpp
1 test_rosbag_storage
1 test_rosbag
1 test_ros2trace_analysis
1 2024-02-07 test_rclcpp
Test rclcpp API. Each test is run with every available rmw implementation.
Test rclcpp API. Each test is run with every available rmw implementation.
 
1 2024-02-07 test_quality_of_service
Test quality of service features, specifically liveliness, deadline, and lifespan.
Test quality of service features, specifically liveliness, deadline, and lifespan.
 
1 test_osm
1 test_nodelet_topic_tools
1 test_nodelet
1 test_mavros
1 test_diagnostic_aggregator
1 2024-02-07 test_communication
Test publish / subscribe and request / response communication with all primitive as well as builtin types. Also exchange dynamic and static arrays and nested message structures. Each test is run with every available rmw implementation for the sending as well as the receiving side.
Test publish / subscribe and request / response communication with all primitive as well as builtin types. Also exchange dynamic and static arrays and nested message structures. Each test is run with every available rmw implementation for the sending as well as the receiving side.
 
1 2024-02-07 test_cli_remapping
Test command line remapping of topic names, service names, node namespace, and node name.
Test command line remapping of topic names, service names, node namespace, and node name.
 
1 2024-02-07 test_cli
Test command line arguments passed to ros2 executables.
Test command line arguments passed to ros2 executables.
 
1 test_catkin_virtualenv_inherited
1 test_catkin_virtualenv
1 tesseract_visualization
1 tesseract_urdf
1 tesseract_support
1 tesseract_state_solver
1 tesseract_srdf
1 tesseract_scene_graph
1 tesseract_kinematics
1 tesseract_geometry
1 tesseract_environment
1 tesseract_common
1 tesseract_collision
1 teraranger_array
1 teraranger
1 tensorflow_ros_cpp
0 tensorflow_catkin
1 temp_monitor
1 tello_driver
1 teleop_twist_keyboard_cpp
1 teleop_legged_robots
1 teleop_keyboard_omni3
1 teb_local_planner_tutorials
1 teb_local_planner
1 tb4_sim_scenario
1 task_compiler
1 talos_robot
1 talos_moveit_config
1 talos_gazebo
1 talos_description_inertial
1 talos_description_calibration
1 talos_description
1 talos_controller_configuration
1 talos_bringup
1 tablet_socket_msgs
1 sys_monitor
1 sync_parameter_server
1 swri_yaml_util
1 swri_string_util
1 swri_rospy
1 swri_profiler_tools
1 swri_profiler_msgs
1 swri_profiler
1 swri_prefix_tools
1 swri_nodelet
1 switchbot_ros
1 swarm_ros_bridge
1 stubborn_buddies_msgs
1 stubborn_buddies
1 strain_gauge_calibration
1 std_capabilities
1 stcamera_msgs
1 stcamera_launch
1 stcamera_grabber
1 stcamera_components
1 staubli_val3_driver
1 staubli_tx90_support
1 staubli_tx90_gazebo
1 staubli_tx60_support
1 staubli_tx60_gazebo
1 staubli_tx2_90_support
1 staubli_tx2_60_support
1 staubli_rx160_support
1 staubli_rx160_moveit_plugins
1 staubli_rx160_moveit_config
1 staubli_rx160_gazebo
1 staubli_resources
1 staubli_experimental
1 staubli
1 static_transform_mux
1 static_tf
1 states
1 stairs_visualizer_pkg
1 stairs_msg
1 stair_step_detector_pkg
1 stage_ros
1 stage
1 stag_ros
1 stag_detect
0 srdf
1 srbot_description
1 sr_visualization_icons
1 sr_visualization
0 sr_utilities_common
1 sr_utilities
1 sr_tools
1 sr_tactile_sensors
1 sr_tactile_sensor_controller
0 sr_system_info
1 sr_robot_msgs
1 sr_robot_lib
1 sr_robot_launch
1 sr_robot_commander
1 sr_multi_moveit_test
1 sr_multi_moveit_config
1 sr_multi_description
1 sr_movements
1 sr_moveit_hand_config
1 sr_mechanism_model
1 sr_mechanism_controllers
0 sr_interpolation
1 sr_interface
1 sr_hardware_interface
1 sr_hand_health_report
1 sr_hand_detector
1 sr_hand
1 sr_gui_muscle_driver_bootloader
1 sr_gui_motor_resetter
1 sr_gui_hand_calibration
1 sr_gui_cyberglove_calibrator
1 sr_gui_controller_tuner
1 sr_gui_change_muscle_controllers
1 sr_gui_bootloader
1 sr_gui_biotac
1 sr_gui_advanced_controls
1 sr_grasp_stability
1 sr_grasp_fast_planner
1 sr_grasp
1 sr_gazebo_sim
1 sr_external_dependencies
1 sr_example
1 sr_ethercat_hand_config
1 sr_error_reporter
1 sr_edc_muscle_tools
1 sr_edc_launch
1 sr_edc_ethercat_drivers
1 sr_edc_controller_configuration
1 sr_description
1 sr_data_visualization
1 sr_core
0 sr_controllers_tools
1 sr_config
1 sr_common
1 sr_box_ur10_moveit_config
1 sr_3dmouse
0 sphinx
1 speed_scaling_state_controller
1 speed_scaling_interface
1 speed_cam
1 speech_recognition_msgs
1 sparse_mapping
1 sparse_bundle_adjustment
1 spacenav_node
1 sound_play
1 sound_classification
1 sot-tools
1 sot-dynamic-pinocchio
1 sot-core
0 softhand_ros
1 soem
1 socketcan_interface
1 socketcan_bridge
0 socket_bridge
1 social_navigation_layers
1 sob_layer
1 soar_ros
1 snmp_ros
1 snmp_diagnostics
1 smart_dock

Packages

Name Description
1 tuw_object_rviz
1 tuw_object_msgs
1 tuw_object_map_msgs
1 tuw_nav_rviz
1 tuw_nav_msgs
1 tuw_multi_robot_rviz
1 tuw_multi_robot_router
1 tuw_multi_robot_msgs
1 tuw_multi_robot_local_behavior_controller
1 tuw_multi_robot_goal_generator
1 tuw_multi_robot_demo
1 tuw_multi_robot_ctrl
1 tuw_multi_robot
1 tuw_msgs
1 tuw_marker_pose_estimation
1 tuw_marker_detection
1 tuw_local_controller_msgs
1 tuw_graph_msgs
1 tuw_geometry_rviz
1 tuw_geometry_msgs
1 tuw_geo_msgs
1 tuw_gazebo_msgs
1 tuw_ellipses
1 tuw_control
1 tuw_checkerboard
1 tuw_aruco
1 tuw_airskin_msgs
1 tutorial_examples
1 turtlesim_msgs
1 turtlesim_dash_tutorial
0 turtlebot_description
1 turtlebot4_tutorials
1 turtlebot4_python_tutorials
1 turtlebot4_python_examples
1 turtlebot4_openai_tutorials
1 turtlebot4_ignition_toolbox
1 turtlebot4_ignition_gui_plugins
1 turtlebot4_ignition_bringup
1 turtlebot4_examples
1 turtlebot4_cpp_tutorials
1 turtlebot4_cpp_examples
1 turtlebot3_teleop
1 turtlebot3_slam
1 turtlebot3_panorama
1 turtlebot3_node
1 turtlebot3_navigation2
1 turtlebot3_navigation
1 turtlebot3_manipulation_teleop
1 turtlebot3_manipulation_navigation2
1 turtlebot3_manipulation_moveit_config
1 turtlebot3_manipulation_hardware
1 turtlebot3_manipulation_description
1 turtlebot3_manipulation_cartographer
1 turtlebot3_manipulation_bringup
1 turtlebot3_manipulation
1 turtlebot3_follower
1 turtlebot3_follow_filter
1 turtlebot3_fake
1 turtlebot3_example
1 turtlebot3_description
1 turtlebot3_cartographer
1 turtlebot3_bringup
1 turtlebot3_autorace_msgs
1 turtlebot3_autorace_driving
2 turtlebot3_autorace_detect
2 turtlebot3_autorace_core
1 turtlebot3_autorace_control
2 turtlebot3_autorace_camera
1 turtlebot3_autorace_2020
1 turtlebot3_autorace
1 turtlebot3_automatic_parking_vision
1 turtlebot3_automatic_parking
1 turtlebot3_applications_msgs
1 turtlebot3_applications
1 turtlebot3
1 turtle_tf2
1 turtle_tf
1 turtle_teleop_multi_key
1 turtle_actionlib
1 tts
1 tsid
1 trajectory_tracker_rviz_plugins
1 trajectory_tracker_msgs
1 trajectory_tracker
0 trajectory_execution_ros
0 trajectory_execution
1 traj_opt_ros
1 traj_opt_pro
1 traj_opt_msgs
1 traj_opt_basic
1 track_odometry
1 tra1_moveit_config
1 tra1_description
1 tra1_bringup
1 towr_ros
1 towr
1 tork_moveit_tutorial
1 topics_rviz_plugin
1 tof_radar_controller
1 tiny_tf
1 timestamp_tools
2 timed_roslaunch
1 tiago_simulation
1 tiago_robot
1 tiago_rgbd_sensors
1 tiago_navigation
1 tiago_multi
1 tiago_moveit_config
1 tiago_laser_sensors
1 tiago_gazebo
1 tiago_description
1 tiago_controller_configuration
1 tiago_bringup
1 tiago_2dnav
1 thunder_line_follower_pmr3100
1 tf_static_publisher
1 tf_remapper_cpp
1 tf_conversions
1 tf2_web_republisher
1 tf2_urdf
1 tf2_server
1 tf2_relay
1 tf2_client
1 tf
1 2024-04-16 test_security
Test nodes, publishers and subscribers with DDS-Security.
Test nodes, publishers and subscribers with DDS-Security.
 
1 test_rostopic
1 test_rostest
1 test_rosservice
1 test_rospy
1 test_rosparam
1 test_rosmaster
1 test_roslib_comm
1 test_roslaunch
1 test_rosgraph
1 test_roscpp
1 test_rosbag_storage
1 test_rosbag
1 test_ros2trace_analysis
1 2024-04-16 test_rclcpp
Test rclcpp API. Each test is run with every available rmw implementation.
Test rclcpp API. Each test is run with every available rmw implementation.
 
1 2024-04-16 test_quality_of_service
Test quality of service features, specifically liveliness, deadline, and lifespan.
Test quality of service features, specifically liveliness, deadline, and lifespan.
 
1 test_osm
1 test_nodelet_topic_tools
1 test_nodelet
1 test_mavros
1 test_diagnostic_aggregator
1 2024-04-16 test_communication
Test publish / subscribe and request / response communication with all primitive as well as builtin types. Also exchange dynamic and static arrays and nested message structures. Each test is run with every available rmw implementation for the sending as well as the receiving side.
Test publish / subscribe and request / response communication with all primitive as well as builtin types. Also exchange dynamic and static arrays and nested message structures. Each test is run with every available rmw implementation for the sending as well as the receiving side.
 
1 2024-04-16 test_cli_remapping
Test command line remapping of topic names, service names, node namespace, and node name.
Test command line remapping of topic names, service names, node namespace, and node name.
 
1 2024-04-16 test_cli
Test command line arguments passed to ros2 executables.
Test command line arguments passed to ros2 executables.
 
1 test_catkin_virtualenv_inherited
1 test_catkin_virtualenv
1 tesseract_visualization
1 tesseract_urdf
1 tesseract_support
1 tesseract_state_solver
1 tesseract_srdf
1 tesseract_scene_graph
1 tesseract_kinematics
1 tesseract_geometry
1 tesseract_environment
1 tesseract_common
1 tesseract_collision
1 teraranger_array
1 teraranger
1 tensorflow_ros_cpp
0 tensorflow_catkin
1 temp_monitor
1 tello_driver
1 teleop_twist_keyboard_cpp
1 teleop_legged_robots
1 teleop_keyboard_omni3
1 teb_local_planner_tutorials
1 teb_local_planner
1 task_compiler
1 talos_robot
1 talos_moveit_config
1 talos_gazebo
1 talos_description_inertial
1 talos_description_calibration
1 talos_description
1 talos_controller_configuration
1 talos_bringup
1 tablet_socket_msgs
1 sys_monitor
1 sync_parameter_server
1 swri_yaml_util
1 swri_string_util
1 swri_rospy
1 swri_profiler_tools
1 swri_profiler_msgs
1 swri_profiler
1 swri_prefix_tools
1 swri_nodelet
1 switchbot_ros
1 swarm_ros_bridge
1 stubborn_buddies_msgs
1 stubborn_buddies
1 strain_gauge_calibration
1 std_capabilities
1 stcamera_msgs
1 stcamera_launch

Packages

Name Description
1 std_capabilities
1 stcamera_msgs
1 stcamera_launch
1 stcamera_grabber
1 stcamera_components
1 staubli_val3_driver
1 staubli_tx90_support
1 staubli_tx90_gazebo
1 staubli_tx60_support
1 staubli_tx60_gazebo
1 staubli_tx2_90_support
1 staubli_tx2_60_support
1 staubli_rx160_support
1 staubli_rx160_moveit_plugins
1 staubli_rx160_moveit_config
1 staubli_rx160_gazebo
1 staubli_resources
1 staubli_experimental
1 staubli
1 static_transform_mux
1 static_tf
1 states
1 stairs_visualizer_pkg
1 stairs_msg
1 stair_step_detector_pkg
1 stage_ros
1 stage
1 stag_ros
1 stag_detect
0 srdf
1 srbot_description
1 sr_visualization_icons
1 sr_visualization
0 sr_utilities_common
1 sr_utilities
1 sr_tools
1 sr_tactile_sensors
1 sr_tactile_sensor_controller
0 sr_system_info
1 sr_robot_msgs
1 sr_robot_lib
1 sr_robot_launch
1 sr_robot_commander
1 sr_multi_moveit_test
1 sr_multi_moveit_config
1 sr_multi_description
1 sr_movements
1 sr_moveit_hand_config
1 sr_mechanism_model
1 sr_mechanism_controllers
0 sr_interpolation
1 sr_interface
1 sr_hardware_interface
1 sr_hand_health_report
1 sr_hand_detector
1 sr_hand
1 sr_gui_muscle_driver_bootloader
1 sr_gui_motor_resetter
1 sr_gui_hand_calibration
1 sr_gui_cyberglove_calibrator
1 sr_gui_controller_tuner
1 sr_gui_change_muscle_controllers
1 sr_gui_bootloader
1 sr_gui_biotac
1 sr_gui_advanced_controls
1 sr_grasp_stability
1 sr_grasp_fast_planner
1 sr_grasp
1 sr_gazebo_sim
1 sr_external_dependencies
1 sr_example
1 sr_ethercat_hand_config
1 sr_error_reporter
1 sr_edc_muscle_tools
1 sr_edc_launch
1 sr_edc_ethercat_drivers
1 sr_edc_controller_configuration
1 sr_description
1 sr_data_visualization
1 sr_core
0 sr_controllers_tools
1 sr_config
1 sr_common
1 sr_box_ur10_moveit_config
1 sr_3dmouse
0 sphinx
1 speed_scaling_state_controller
1 speed_scaling_interface
1 speed_cam
1 speech_recognition_msgs
1 spatio_temporal_voxel_layer
1 sparse_mapping
1 sparse_bundle_adjustment
1 spacenav_node
1 sound_play
1 sound_classification
1 sot-tools
1 sot-dynamic-pinocchio
1 sot-core
0 softhand_ros
1 soem
1 socketcan_interface
1 socketcan_bridge
0 socket_bridge
1 social_navigation_layers
1 social_nav_util
1 social_nav_msgs
1 social_nav_metrics
1 soccer_object_msgs
1 soccer_marker_generation
1 sob_layer
1 soar_ros
1 snmp_ros
1 snmp_diagnostics
1 smart_dock
1 smach_viewer
1 smacc_rviz_plugin
1 smacc_runtime_test
1 smacc_msgs
1 smacc
1 sm_viewer_sim
1 sm_update_loop
1 sm_subscriber
1 sm_starcraft_ai
1 sm_simple_action_client
1 sm_ridgeback_barrel_search_2
1 sm_ridgeback_barrel_search_1
1 sm_panda_moveit2z_cb_inventory
1 sm_packml
1 sm_multi_panda_sim
1 sm_fetch_two_table_whiskey_pour
1 sm_fetch_two_table_pick_n_place_1
1 sm_fetch_six_table_pick_n_sort_1
1 sm_fetch_screw_loop_1
1 sm_ferrari
1 sm_dance_bot_2
1 sm_coretest_x_y_3
1 sm_coretest_x_y_2
1 sm_coretest_x_y_1
1 sm_calendar_week
1 sm_atomic_openai
2 sm_atomic_mode_states
1 sm_atomic_lifecycle
1 sm_atomic_http
1 sm_atomic_cb
1 slime_wrapper
1 slime_ros
1 sliding_window_graph_optimizer
1 slic
1 slam_toolbox_rviz
1 slam_toolbox_msgs
1 slam_toolbox
1 slam_karto
1 slam_gmapping
1 skyway
1 situational_graphs_wrapper
1 situational_graphs_reasoning_msgs
1 situational_graphs_reasoning
1 situational_graphs_msgs
1 situational_graphs_datasets
1 single_joint_position_action
1 simulators
1 simple_term_menu_vendor
1 simple_rviz_plugin
1 simple_qt_gui
1 simple_node
1 simple_navigation_goals_tutorial
1 simple_message
1 simple_desktop_launcher
1 signal_lights
1 sicks300_2
1 sick_visionary_ros
1 sick_tim
1 sick_scan_xd
1 sick_scan
1 sick_safevisionary_msgs
1 sick_safetyscanners
1 sick_ldmrs_tools
1 sick_ldmrs_msgs
1 sick_ldmrs_laser
1 sick_ldmrs_driver
1 sick_ldmrs_description
1 shadow_robot_ethercat
1 settlerlib
1 sesame_ros
2 service_tools
1 2024-11-19 service_load_balancing
This package helps ROS2 services implement load balancing functionality.
This package helps ROS2 services implement load balancing functionality.
 
1 serl_franka_controllers
1 serial
1 sensor_filters
1 sensehat_ros
1 semantic_point_annotator
1 seek_thermal
1 seed_smartactuator_sdk
1 seed_r7_typeg_moveit_config
1 seed_r7_typeg_arm_moveit_config
1 seed_r7_typeg2_arm_moveit_config
1 seed_r7_typef_moveit_config
1 seed_r7_samples
1 seed_r7_ros_pkg

Packages

Name Description
2 2020-05-20 desktop
A metapackage to aggregate several packages.
A metapackage to aggregate several packages.
 
1 2023-04-25 derived_object_msgs
Abstracted Messages from Perception Modalities
Abstracted Messages from Perception Modalities
 
1 2021-09-03 depthimage_to_laserscan
depthimage_to_laserscan
depthimage_to_laserscan
 
1 2024-10-15 depthai_ros_msgs
Package to keep interface independent of the driver
Package to keep interface independent of the driver
 
1 2024-10-15 depthai_ros_driver
Depthai ROS Monolithic node.
Depthai ROS Monolithic node.
 
1 2024-10-15 depthai_filters
The depthai_filters package
The depthai_filters package
 
1 2024-10-15 depthai_examples
The depthai_examples package
The depthai_examples package
 
1 2024-10-15 depthai_descriptions
The depthai_descriptions package
The depthai_descriptions package
 
1 2024-10-15 depthai_bridge
The depthai_bridge package
The depthai_bridge package
 
1 2024-10-15 depthai-ros
The depthai-ros package
The depthai-ros package
 
1 2024-08-21 depthai
DepthAI core is a C++ library which comes with firmware and an API to interact with OAK Platform
DepthAI core is a C++ library which comes with firmware and an API to interact with OAK Platform
 
1 2024-01-22 depth_image_proc
Contains nodelets for processing depth images such as those produced by OpenNI camera. Functions include creating disparity images and point clouds, as well as registering (reprojecting) a depth image into another camera frame.
Contains nodelets for processing depth images such as those produced by OpenNI camera. Functions include creating disparity images and point clouds, as well as registering (reprojecting) a depth image into another camera frame.
 
1 2023-04-25 delphi_srr_msgs
Message definitions for the Delphi SRR
Message definitions for the Delphi SRR
 
1 2023-04-25 delphi_mrr_msgs
Message definitions for the Delphi MRR
Message definitions for the Delphi MRR
 
1 2023-04-25 delphi_esr_msgs
Message definitions for the Delphi ESR
Message definitions for the Delphi ESR
 
1 2020-10-30 ddynamic_reconfigure_python
The ddynamic_reconfigure_python package contains a class to instantiate dynamic reconfigure servers on the fly registering variables
The ddynamic_reconfigure_python package contains a class to instantiate dynamic reconfigure servers on the fly registering variables
 
1 2021-01-18 ddynamic_reconfigure
The ddynamic_reconfigure package
The ddynamic_reconfigure package
 
1 2024-01-02 dbw_polaris_msgs
Drive-by-wire messages for Polaris platforms
Drive-by-wire messages for Polaris platforms
 
1 2024-01-02 dbw_polaris_joystick_demo
Demonstration of drive-by-wire with joystick
Demonstration of drive-by-wire with joystick
 
1 2024-01-02 dbw_polaris_description
URDF and meshes describing Polaris vehicles.
URDF and meshes describing Polaris vehicles.
 
1 2024-01-02 dbw_polaris_can
Drive-by-wire interface to the Dataspeed Inc. Polaris GEM/Ranger/RZR DBW kit
Drive-by-wire interface to the Dataspeed Inc. Polaris GEM/Ranger/RZR DBW kit
 
1 2024-01-02 dbw_polaris
Drive-by-wire interface to the Dataspeed Inc. Polaris GEM/Ranger/RZR DBW kit
Drive-by-wire interface to the Dataspeed Inc. Polaris GEM/Ranger/RZR DBW kit
 
1 2024-01-02 dbw_mkz_msgs
Drive-by-wire messages for the Lincoln MKZ
Drive-by-wire messages for the Lincoln MKZ
 
1 2024-01-02 dbw_mkz_joystick_demo
Demonstration of drive-by-wire with joystick
Demonstration of drive-by-wire with joystick
 
1 2024-01-02 dbw_mkz_description
URDF and meshes describing the Lincoln MKZ.
URDF and meshes describing the Lincoln MKZ.
 
1 2024-01-02 dbw_mkz_can
Drive-by-wire interface to the Dataspeed Inc. Lincoln MKZ DBW kit
Drive-by-wire interface to the Dataspeed Inc. Lincoln MKZ DBW kit
 
1 2024-01-02 dbw_mkz
Drive-by-wire interface to the Dataspeed Inc. Lincoln MKZ DBW kit
Drive-by-wire interface to the Dataspeed Inc. Lincoln MKZ DBW kit
 
1 2024-01-02 dbw_fca_msgs
Drive-by-wire messages for the Chrysler Pacifica
Drive-by-wire messages for the Chrysler Pacifica
 
1 2024-01-02 dbw_fca_joystick_demo
Demonstration of drive-by-wire with joystick
Demonstration of drive-by-wire with joystick
 
1 2024-01-02 dbw_fca_description
URDF and meshes describing the Chrysler Pacifica.
URDF and meshes describing the Chrysler Pacifica.
 
1 2024-01-02 dbw_fca_can
Drive-by-wire interface to the Dataspeed Inc. Chrysler Pacifica DBW kit
Drive-by-wire interface to the Dataspeed Inc. Chrysler Pacifica DBW kit
 
1 2024-01-02 dbw_fca
Drive-by-wire interface to the Dataspeed Inc. Chrysler Pacifica DBW kit
Drive-by-wire interface to the Dataspeed Inc. Chrysler Pacifica DBW kit
 
1 2022-11-30 dataspeed_ulc_msgs
ROS messages for interacting with the Universal Lat/Lon Controller (ULC)
ROS messages for interacting with the Universal Lat/Lon Controller (ULC)
 
1 2022-11-30 dataspeed_ulc_can
Package to translate ROS messages to and from CAN messages to interact with the Universal Lat/Lon Controller (ULC) firmware
Package to translate ROS messages to and from CAN messages to interact with the Universal Lat/Lon Controller (ULC) firmware
 
1 2022-11-30 dataspeed_ulc
CAN interface to the Universal Lat/Lon Controller (ULC) firmware
CAN interface to the Universal Lat/Lon Controller (ULC) firmware
 
1 2020-11-13 dataspeed_pds_scripts
Test scripts to interface to the Dataspeed Inc. Intelligent Power Distribution System (iPDS)
Test scripts to interface to the Dataspeed Inc. Intelligent Power Distribution System (iPDS)
 
1 2020-11-13 dataspeed_pds_rqt
ROS rqt GUI for the Dataspeed Inc. Intelligent Power Distribution System (iPDS)
ROS rqt GUI for the Dataspeed Inc. Intelligent Power Distribution System (iPDS)
 
1 2020-11-13 dataspeed_pds_msgs
Messages for the Dataspeed Inc. Intelligent Power Distribution System (iPDS)
Messages for the Dataspeed Inc. Intelligent Power Distribution System (iPDS)
 
1 2020-11-13 dataspeed_pds_lcm
Interface to the Dataspeed Inc. Intelligent Power Distribution System (iPDS) via LCM
Interface to the Dataspeed Inc. Intelligent Power Distribution System (iPDS) via LCM
 
1 2020-11-13 dataspeed_pds_can
Interface to the Dataspeed Inc. Intelligent Power Distribution System (iPDS) via CAN
Interface to the Dataspeed Inc. Intelligent Power Distribution System (iPDS) via CAN
 
1 2020-11-13 dataspeed_pds
Interface to the Dataspeed Inc. Intelligent Power Distribution System (iPDS)
Interface to the Dataspeed Inc. Intelligent Power Distribution System (iPDS)
 
1 2023-02-03 dataspeed_can_usb
Driver to interface with the Dataspeed Inc. USB CAN Tool
Driver to interface with the Dataspeed Inc. USB CAN Tool
 
1 2023-02-03 dataspeed_can_tools
CAN bus introspection
CAN bus introspection
 
1 2023-02-03 dataspeed_can_msgs
Controller Area Network (CAN) messages
Controller Area Network (CAN) messages
 
1 2023-02-03 dataspeed_can_msg_filters
Time synchronize multiple CAN messages to get a single callback
Time synchronize multiple CAN messages to get a single callback
 
1 2023-02-03 dataspeed_can
CAN bus tools using Dataspeed hardware
CAN bus tools using Dataspeed hardware
 
1 2021-06-30 darknet_ros_msgs
Darknet is an open source neural network framework that runs on CPU and GPU. You only look once (YOLO) is a state-of-the-art, real-time object detection system.
Darknet is an open source neural network framework that runs on CPU and GPU. You only look once (YOLO) is a state-of-the-art, real-time object detection system.
 
1 2021-06-30 darknet_ros
Darknet is an open source neural network framework that runs on CPU and GPU. You only look once (YOLO) is a state-of-the-art, real-time object detection system.
Darknet is an open source neural network framework that runs on CPU and GPU. You only look once (YOLO) is a state-of-the-art, real-time object detection system.
 
1 2022-01-26 cv_camera
cv_camera uses OpenCV capture object to capture camera image. This supports camera_image and nodelet.
cv_camera uses OpenCV capture object to capture camera image. This supports camera_image and nodelet.
 
1 2024-08-20 cv_bridge
This contains CvBridge, which converts between ROS Image messages and OpenCV images.
This contains CvBridge, which converts between ROS Image messages and OpenCV images.
 
1 2022-08-16 csm
This is a ROS 3rd-party wrapper
This is a ROS 3rd-party wrapper
 
1 2020-10-25 criutils
The criutils package
The criutils package
 
1 2023-05-21 create_robot
ROS driver for iRobot's Create 1 and 2, based on the libcreate C++ library
ROS driver for iRobot's Create 1 and 2, based on the libcreate C++ library
 
1 2023-05-21 create_msgs
Common message definitions for create_robot
Common message definitions for create_robot
 
1 2023-05-21 create_driver
ROS driver for iRobot's Create and Roomba platforms, based on libcreate
ROS driver for iRobot's Create and Roomba platforms, based on libcreate
 
1 2023-05-21 create_description
Robot URDF descriptions for create_robot
Robot URDF descriptions for create_robot
 
1 2023-05-21 create_bringup
Launch and configuration files for common accessories when working with Create/Roomba platforms.
Launch and configuration files for common accessories when working with Create/Roomba platforms.
 
1 2024-11-13 cras_topic_tools
Nodes and nodeletes for safe and efficient manipulation with topics
Nodes and nodeletes for safe and efficient manipulation with topics
 
1 2023-08-29 cras_relative_positional_controller
Action server for moving the robot with relative positional commands
Action server for moving the robot with relative positional commands
 
1 2024-11-13 cras_py_common
A Czech-army knife for ROS code written in Python.
A Czech-army knife for ROS code written in Python.
 
1 2023-08-25 cras_msgs
Common messages used by CRAS
Common messages used by CRAS
 
1 2024-01-26 cras_laser_geometry
Tools for working with laser scans.
Tools for working with laser scans.
 
1 2024-01-12 cras_joy_tools
Joystick and gamepad handling tools.
Joystick and gamepad handling tools.
 
1 2023-06-19 cras_imu_tools
Tools for working with IMU data
Tools for working with IMU data
 
1 2024-11-13 cras_docs_common
Common configuration for CRAS packages documentation.
Common configuration for CRAS packages documentation.
 
1 2024-11-13 cras_cpp_common
A Czech-army knife for ROS code written in C++.
A Czech-army knife for ROS code written in C++.
 
1 2024-11-13 cras_bag_tools
Various utilities to work with bag files
Various utilities to work with bag files
 
1 2024-10-01 cpr_onav_description
Clearpath OutdoorNav URDF description
Clearpath OutdoorNav URDF description
 
1 2023-06-15 cpp_common
cpp_common contains C++ code for doing things that are not necessarily ROS related, but are useful for multiple packages. This includes things like the ROS_DEPRECATED and ROS_FORCE_INLINE macros, as well as code for getting backtraces. This package is a component of
cpp_common contains C++ code for doing things that are not necessarily ROS related, but are useful for multiple packages. This includes things like the ROS_DEPRECATED and ROS_FORCE_INLINE macros, as well as code for getting backtraces. This package is a component of
 
2 2022-06-27 costmap_queue
Tool for iterating through the cells of a costmap to find the closest distance to a subset of cells.
Tool for iterating through the cells of a costmap to find the closest distance to a subset of cells.
 
1 2024-05-23 costmap_cspace_rviz_plugins
Rviz plugins for costmap_cspace_msgs
Rviz plugins for costmap_cspace_msgs
 
1 2024-02-19 costmap_cspace_msgs
Message definitions for costmap_cspace package
Message definitions for costmap_cspace package
 
1 2024-11-08 costmap_cspace
3-dof configuration space costmap package
3-dof configuration space costmap package
 
1 2024-09-20 costmap_converter
A ros package that includes plugins and nodes to convert occupied costmap2d cells to primitive types.
A ros package that includes plugins and nodes to convert occupied costmap2d cells to primitive types.
 
1 2023-03-04 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.
 
1 2020-04-24 convex_decomposition
Convex Decomposition Tool for Robot Model
Convex Decomposition Tool for Robot Model
 
1 2024-10-12 controller_manager_tests
Tests for the controller manager.
Tests for the controller manager.
 
2 2024-10-12 controller_manager_msgs
Messages and services for the controller manager.
Messages and services for the controller manager.
 
2 2024-10-12 controller_manager
The controller manager.
The controller manager.
 
2 2024-10-12 controller_interface
Interface base class for controllers.
Interface base class for controllers.
 
1 2022-05-10 control_toolbox
The control toolbox contains modules that are useful across all controllers.
The control toolbox contains modules that are useful across all controllers.
 
1 2021-02-02 control_msgs
control_msgs contains base messages and actions useful for controlling robots. It provides representations for controller setpoints and joint and cartesian trajectories.
control_msgs contains base messages and actions useful for controlling robots. It provides representations for controller setpoints and joint and cartesian trajectories.
 
1 2020-06-05 control_box_rst
The control_box_rst package provides C++ libraries for predictive control, direct optimal control, optimization and simulation.
The control_box_rst package provides C++ libraries for predictive control, direct optimal control, optimization and simulation.
 
1 2024-01-22 contact_states_observer
The contact_states_observer package
The contact_states_observer package
 
1 2020-09-19 computer_status_msgs
Messages definitions for representing computer's hardware state, such as battery information, GPU, some miscellaneous sensors. Format is in ROS. Originally developed at
Messages definitions for representing computer's hardware state, such as battery information, GPU, some miscellaneous sensors. Format is in ROS. Originally developed at
 
1 2024-01-25 compressed_image_transport
Compressed_image_transport provides a plugin to image_transport for transparently sending images encoded as JPEG or PNG.
Compressed_image_transport provides a plugin to image_transport for transparently sending images encoded as JPEG or PNG.
 
1 2024-01-25 compressed_depth_image_transport
Compressed_depth_image_transport provides a plugin to image_transport for transparently sending depth images (raw, floating-point) using PNG compression.
Compressed_depth_image_transport provides a plugin to image_transport for transparently sending depth images (raw, floating-point) using PNG compression.
 
1 2023-07-12 compass_msgs
Messages related to compass
Messages related to compass
 
1 2020-07-23 common_tutorials
Metapackage that contains common tutorials
Metapackage that contains common tutorials
 
1 2021-01-11 common_msgs
common_msgs contains messages that are widely used by other ROS packages. These includes messages for actions (
common_msgs contains messages that are widely used by other ROS packages. These includes messages for actions (
 
1 2024-10-12 combined_robot_hw_tests
Tests for the combined Robot HW class.
Tests for the combined Robot HW class.
 
1 2024-10-12 combined_robot_hw
Combined Robot HW class.
Combined Robot HW class.
 
2 2022-06-27 color_util
An almost dependency-less library for converting between color spaces
An almost dependency-less library for converting between color spaces
 
1 2024-07-10 collada_urdf_jsk_patch
unaccepted patch for collada_urdf
unaccepted patch for collada_urdf
 
1 2020-07-14 collada_urdf
This package contains a tool to convert Unified Robot Description Format (URDF) documents into COLLAborative Design Activity (COLLADA) documents. Implements robot-specific COLLADA extensions as defined by http://openrave.programmingvision.com/index.php/Started:COLLADA
This package contains a tool to convert Unified Robot Description Format (URDF) documents into COLLAborative Design Activity (COLLADA) documents. Implements robot-specific COLLADA extensions as defined by http://openrave.programmingvision.com/index.php/Started:COLLADA
 
1 2020-07-14 collada_parser
This package contains a C++ parser for the Collada robot description format. The parser reads a Collada XML robot description, and creates a C++ URDF model. Although it is possible to directly use this parser when working with Collada robot descriptions, the preferred user API is found in the urdf package.
This package contains a C++ parser for the Collada robot description format. The parser reads a Collada XML robot description, and creates a C++ URDF model. Although it is possible to directly use this parser when working with Collada robot descriptions, the preferred user API is found in the urdf package.
 
1 2020-05-27 codec_image_transport
The codec_image_transport package
The codec_image_transport package
 
1 2023-08-29 code_coverage
CMake configuration to run coverage
CMake configuration to run coverage
 
2 2024-04-30 cob_voltage_control
Interface to IO board that manages emergency stop and battery voltage on rob@work 3
Interface to IO board that manages emergency stop and battery voltage on rob@work 3
 
1 2024-02-19 cob_vision_utils
Contains utilities used within the object detection tool chain.
Contains utilities used within the object detection tool chain.
 
2 2024-04-30 cob_utilities
Deprecated "cob_utilities" subsumes a number of classes, which are used in the original COb3 software. E.g. "IniFile.h" supports the original inifile structure of Care-O-bot 3. "MathSup.h" provides some basic functions like conversion from degree to radion or norming of angles within +/- PI. The package is currently used while the drivers are ported to ROS and Orocos respectively. Midterm it shall be removed and the ROS structures shall be used for reading parameters during initialization. So, don't use this package in new code!
Deprecated "cob_utilities" subsumes a number of classes, which are used in the original COb3 software. E.g. "IniFile.h" supports the original inifile structure of Care-O-bot 3. "MathSup.h" provides some basic functions like conversion from degree to radion or norming of angles within +/- PI. The package is currently used while the drivers are ported to ROS and Orocos respectively. Midterm it shall be removed and the ROS structures shall be used for reading parameters during initialization. So, don't use this package in new code!
 
2 2024-04-30 cob_undercarriage_ctrl
cob_undercarriage_ctrl implements a controller for the omnidirectional base of Care-O-bot 3 on joint level. For a given Pltf-Twist the according wheel steering angles and linear wheel velocities are calculated based on the principle of rigid body motion. Each joint is than controlled individually to achieve the computed position and velocity
cob_undercarriage_ctrl implements a controller for the omnidirectional base of Care-O-bot 3 on joint level. For a given Pltf-Twist the according wheel steering angles and linear wheel velocities are calculated based on the principle of rigid body motion. Each joint is than controlled individually to achieve the computed position and velocity
 
2 2024-04-30 cob_twist_controller
The main purpose of the cob_twist_controller is to convert target twists into joint velocities. Therefore it makes use of several implemented inverse kinematics approaches at the first order differential level. The inverse differential kinematics solver considers kinematic chain extensions, singularity robustness, redundancy resolution and priority-based methods. To avoid hardware destruction there is a limiter interface active as well. Via parameter server users can dynamically configure the solving strategy.
The main purpose of the cob_twist_controller is to convert target twists into joint velocities. Therefore it makes use of several implemented inverse kinematics approaches at the first order differential level. The inverse differential kinematics solver considers kinematic chain extensions, singularity robustness, redundancy resolution and priority-based methods. To avoid hardware destruction there is a limiter interface active as well. Via parameter server users can dynamically configure the solving strategy.
 
2 2024-04-30 cob_tricycle_controller
The cob_omni_drive_controller package provides a ros_controller plugin for the Care-O-bot tricycle base platform.
The cob_omni_drive_controller package provides a ros_controller plugin for the Care-O-bot tricycle base platform.
 
2 2024-04-30 cob_trajectory_controller
This package provides a trajectory controller which controlls velocities for a chain of joints. This controller can be used e.g. with [[schunk_powercube_chain]].
This package provides a trajectory controller which controlls velocities for a chain of joints. This controller can be used e.g. with [[schunk_powercube_chain]].
 
2 2024-04-30 cob_teleop
Teleop node
Teleop node
 
1 2024-02-19 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 2024-04-17 cob_substitute
cob_substitute
cob_substitute
 
2 2024-04-30 cob_srvs
This Package contains Care-O-bot specific service definitions.
This Package contains Care-O-bot specific service definitions.
 
2 2024-04-30 cob_sound
This package implements a sound play module using text2wave and aplay through python.
This package implements a sound play module using text2wave and aplay through python.
 
1 2024-02-19 cob_simulation
The cob_simulation stack includes packages to work with Care-O-bot within simulation environments, e.g. gazebo.
The cob_simulation stack includes packages to work with Care-O-bot within simulation environments, e.g. gazebo.
 
2 2024-04-30 cob_sick_s300
This package published a laser scan message out of a Sick S300 laser scanner.
This package published a laser scan message out of a Sick S300 laser scanner.
 
2 2024-04-30 cob_sick_lms1xx
This package published a laser scan message out of a Sick LMS1xx laser scanner. This version is made by fusion of ipa320/RCPRG_laser_drivers and ipa320/libLMS1xx repository. This package shuld have clearer structure and be easier to install.
This package published a laser scan message out of a Sick LMS1xx laser scanner. This version is made by fusion of ipa320/RCPRG_laser_drivers and ipa320/libLMS1xx repository. This package shuld have clearer structure and be easier to install.
 
2 2024-04-30 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.
 
2 2024-04-30 cob_scan_unifier
The cob_scan_unifier package holds code to unify two or more laser-scans to one unified scan-message
The cob_scan_unifier package holds code to unify two or more laser-scans to one unified scan-message
 
1 2024-04-17 cob_safety_controller
This package is a substitute for the private implementation of cob_safety_controller package
This package is a substitute for the private implementation of cob_safety_controller package
 
1 2024-02-19 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 2024-04-30 cob_relayboard
cob_relayboard
cob_relayboard
 
1 2024-04-17 cob_reflector_referencing
This package provides a node broadcasting a tf frame based on reflector markers detected within sensor_msgs::LaserScan messages. It can be used to position/reference a robot wrt to the reflektor markers.
This package provides a node broadcasting a tf frame based on reflector markers detected within sensor_msgs::LaserScan messages. It can be used to position/reference a robot wrt to the reflektor markers.
 
2 2024-04-30 cob_phidgets
cob_phidgets
cob_phidgets
 
2 2024-04-30 cob_phidget_power_state
The cob_phidget_power_state package publishes power state based on phidgets signals.
The cob_phidget_power_state package publishes power state based on phidgets signals.
 
2 2024-04-30 cob_phidget_em_state
The cob_phidget_em_state package publishes emergency state based on phidgets signals.
The cob_phidget_em_state package publishes emergency state based on phidgets signals.
 
1 2024-02-19 cob_perception_msgs
This package contains common message type definitions for perception tasks.
This package contains common message type definitions for perception tasks.
 
1 2024-02-19 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.
 
2 2024-04-30 cob_omni_drive_controller
The cob_omni_drive_controller package provides a ros_controller plugin for the Care-O-bot omni-directional base platform.
The cob_omni_drive_controller package provides a ros_controller plugin for the Care-O-bot omni-directional base platform.
 
1 2024-02-19 cob_obstacle_distance_moveit
This package provides nodes for calculating the minimal distance to robot links, obstacles and octomap using MoveIt!'s PlanningSceneMonitor
This package provides nodes for calculating the minimal distance to robot links, obstacles and octomap using MoveIt!'s PlanningSceneMonitor
 
2 2024-04-30 cob_obstacle_distance
The cob_obstacle_distance package calculates distances between both robot links and obstacles to be used for obstacle avoidance within cob_twist_controller framework.
The cob_obstacle_distance package calculates distances between both robot links and obstacles to be used for obstacle avoidance within cob_twist_controller framework.
 
1 2024-02-19 cob_object_detection_visualizer
The cob_object_detection_visualizer package visualizes the object detection result.
The cob_object_detection_visualizer package visualizes the object detection result.
 
1 2024-02-19 cob_object_detection_msgs
This package contains message type definitions for object detection
This package contains message type definitions for object detection
 
1 2024-02-19 cob_navigation_slam
This package provides launch files for running
This package provides launch files for running
 
1 2024-02-19 cob_navigation_local
This package holds config and launch files for running the
This package holds config and launch files for running the
 
1 2024-02-19 cob_navigation_global
This package holds config and launch files for running the
This package holds config and launch files for running the
 
1 2024-02-19 cob_navigation_config
This package holds common configuration files for running the
This package holds common configuration files for running the
 
1 2024-02-19 cob_navigation
The cob_navigation stack provides different navigation packages for
The cob_navigation stack provides different navigation packages for
 
2 2024-04-30 cob_msgs
Messages for representing state information, such as battery information and emergency stop status.
Messages for representing state information, such as battery information and emergency stop status.
 
1 2024-02-19 cob_moveit_interface
cob_moveit_interface
cob_moveit_interface
 
1 2024-02-19 cob_moveit_config
MoveIt config files for all cob and raw
MoveIt config files for all cob and raw
 
1 2024-02-19 cob_moveit_bringup
MoveIt launch files
MoveIt launch files
 
2 2024-04-30 cob_monitoring
cob_monitoring
cob_monitoring
 
2 2024-04-30 cob_model_identifier
The cob_model_identifier package provides nodes to analyse the system response behavior of actuators to optimally tune PID controllers to be used with cob_twist_controller framework.
The cob_model_identifier package provides nodes to analyse the system response behavior of actuators to optimally tune PID controllers to be used with cob_twist_controller framework.
 
2 2024-04-30 cob_mimic
This package implements the Care-O-bot mimic
This package implements the Care-O-bot mimic
 
2 2024-04-30 cob_mecanum_controller
The cob_mecanum_controller_node provides a lightweight base controller for mecanum drive robots. The out/input for the wheel command/state are wheel velocities in rad/s for the wheels [front left, front right, rear left, rear right]
The cob_mecanum_controller_node provides a lightweight base controller for mecanum drive robots. The out/input for the wheel command/state are wheel velocities in rad/s for the wheels [front left, front right, rear left, rear right]
 
1 2024-02-19 cob_mapping_slam
cob_mapping_slam holds launch files for running SLAM using the
cob_mapping_slam holds launch files for running SLAM using the
 
1 2024-02-19 cob_map_accessibility_analysis
cob_map_accessibility_analysis receives the map from navigation as well as obstacles and inflates_obstacles topics to assemble a common obstacle map. Upon request, this node checks the accessibility of poses within thin map by (i) checking whether the pose itself is free and by (ii) checking whether there is a closed path from robot to the goal pose.
cob_map_accessibility_analysis receives the map from navigation as well as obstacles and inflates_obstacles topics to assemble a common obstacle map. Upon request, this node checks the accessibility of poses within thin map by (i) checking whether the pose itself is free and by (ii) checking whether there is a closed path from robot to the goal pose.
 
1 2024-02-19 cob_manipulation_msgs
Messages for cob_manipulation
Messages for cob_manipulation
 
1 2024-02-19 cob_manipulation
The cob_manipulation stack includes packages that provide manipulation capabilities for Care-O-bot.
The cob_manipulation stack includes packages that provide manipulation capabilities for Care-O-bot.
 
1 2024-02-19 cob_lookat_action
cob_lookat_action
cob_lookat_action
 
1 2024-02-19 cob_linear_nav
cob_linear_nav provides a simple navigation instrument driving on a linear path from current position to goal without any planning or obstacle avoidance capabilites. Obstacle avoidance should be carried out in other package, e.g.
cob_linear_nav provides a simple navigation instrument driving on a linear path from current position to goal without any planning or obstacle avoidance capabilites. Obstacle avoidance should be carried out in other package, e.g.
 
2 2024-04-30 cob_light
This package contains scripts to operate the LED lights on Care-O-bot.
This package contains scripts to operate the LED lights on Care-O-bot.
 
1 2024-02-19 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.
 
2 2024-04-30 cob_helper_tools
Helper scripts for Care-O-bot
Helper scripts for Care-O-bot
 
2 2024-04-30 cob_hardware_emulation
The cob_hardware_emulation package provides idealized nodes emulating real robot hardware and/or physics simulation.
The cob_hardware_emulation package provides idealized nodes emulating real robot hardware and/or physics simulation.
 
1 2024-02-19 cob_hardware_config
This package contains configuration for each robot instance (e.g. cob4-X, raw3-X). There is a directory for each robot with configuration about urdf and hardware/device configurations.
This package contains configuration for each robot instance (e.g. cob4-X, raw3-X). There is a directory for each robot with configuration about urdf and hardware/device configurations.
 
1 2024-02-19 cob_hand_bridge
The cob_hand_bridge package provides a driver for the gripper of Care-O-bot4.
The cob_hand_bridge package provides a driver for the gripper of Care-O-bot4.
 
1 2024-02-19 cob_hand
The cob_hand stack includes packages that provide access to the Care-O-bot hand through ROS serial.
The cob_hand stack includes packages that provide access to the Care-O-bot hand through ROS serial.
 
1 2024-02-19 cob_grasp_generation
Grasp generation for Care-O-bot based on OpenRAVE
Grasp generation for Care-O-bot based on OpenRAVE
 
2 2024-04-30 cob_generic_can
The package cob_generic_can provides an interface for nodes on a can-bus and examplary wrappers for two PeakSys-can-libs. When a can-bus-device is generated (for an example see base_dirve_chain) you can use generic_can to create as many itfs as there will be components communicating via this can-bus. Assign type of the can communication device (e.g. usb-to-can or can-card of a specific vendor) and can-address of the target device. This package comes with wrappers for PeakSys and PeakSysUSB adapters.
The package cob_generic_can provides an interface for nodes on a can-bus and examplary wrappers for two PeakSys-can-libs. When a can-bus-device is generated (for an example see base_dirve_chain) you can use generic_can to create as many itfs as there will be components communicating via this can-bus. Assign type of the can communication device (e.g. usb-to-can or can-card of a specific vendor) and can-address of the target device. This package comes with wrappers for PeakSys and PeakSysUSB adapters.
 
1 2024-02-19 cob_gazebo_worlds
This package provides some worlds for gazebo simulation.
This package provides some worlds for gazebo simulation.
 
1 2024-02-19 cob_gazebo_tools
The cob_gazebo_tools package provides helper tools for the gazebo simulation
The cob_gazebo_tools package provides helper tools for the gazebo simulation
 
1 2024-02-19 cob_gazebo_ros_control
This package contains a specialization of the gazebo_ros_control plugin. The cob_gazebo_ros_control plugin allows Multi-HardwareInterface-Support.
This package contains a specialization of the gazebo_ros_control plugin. The cob_gazebo_ros_control plugin allows Multi-HardwareInterface-Support.
 
1 2024-02-19 cob_gazebo_plugins
Additional gazebo plugins used with Care-O-bot
Additional gazebo plugins used with Care-O-bot
 
1 2024-02-19 cob_gazebo_objects
This package provides some objects and furniture for gazebo simulation.
This package provides some objects and furniture for gazebo simulation.
 
1 2024-02-19 cob_gazebo
Launch files and tools for 3D simulation of Care-O-bot in gazebo simulator.
Launch files and tools for 3D simulation of Care-O-bot in gazebo simulator.
 
2 2024-04-30 cob_frame_tracker
The cob_frame_tracker package contains nodes that publish Twist commands based on the distance to the desired tf frame target.
The cob_frame_tracker package contains nodes that publish Twist commands based on the distance to the desired tf frame target.
 
2 2024-04-30 cob_footprint_observer
The cob_footprint_observer package adjusts the footprint of the robot based on the setup (e.g. arm and/or tray).
The cob_footprint_observer package adjusts the footprint of the robot based on the setup (e.g. arm and/or tray).
 
1 2024-03-18 cob_fiducials
Fiducial recognition. Implementation of different 2D tags like PI-tag from Bergamasco et al. for recognition with a single 2D camera.
Fiducial recognition. Implementation of different 2D tags like PI-tag from Bergamasco et al. for recognition with a single 2D camera.
 
1 2024-02-19 cob_extern
The cob_extern stack contains third party libraries needed for operating Care-O-bot. The packages are downloaded from the manufactorers website and not changed in any way.
The cob_extern stack contains third party libraries needed for operating Care-O-bot. The packages are downloaded from the manufactorers website and not changed in any way.
 
1 2024-02-19 cob_environments
This stack holds packages for IPA default environment configuration.
This stack holds packages for IPA default environment configuration.
 
2 2024-04-30 cob_elmo_homing
This packagae implements the special homing procedure that is needed for old cob4/raw bases
This packagae implements the special homing procedure that is needed for old cob4/raw bases
 
2 2024-04-30 cob_driver
The cob_driver stack includes packages that provide access to the Care-O-bot hardware through ROS messages, services and actions. E.g. for mobile base, arm, camera sensors, laser scanners, etc...
The cob_driver stack includes packages that provide access to the Care-O-bot hardware through ROS messages, services and actions. E.g. for mobile base, arm, camera sensors, laser scanners, etc...
 
1 2024-04-17 cob_docker_control
Autonomous docking
Autonomous docking
 
2 2024-04-30 cob_description
This package contains the description (mechanical, kinematic, visual, etc.) of the Care-O-bot robot. The files in this package are parsed and used by a variety of other components. Most users will not interact directly with this package.
This package contains the description (mechanical, kinematic, visual, etc.) of the Care-O-bot robot. The files in this package are parsed and used by a variety of other components. Most users will not interact directly with this package.
 
1 2024-02-19 cob_default_robot_config
Default configuration of the different robots supported by the Care-O-bot stacks. Configuration is e.g. preconfigured joint positions.
Default configuration of the different robots supported by the Care-O-bot stacks. Configuration is e.g. preconfigured joint positions.
 
1 2024-02-19 cob_default_robot_behavior
The cob_default_robot_behavior package provides helper scripts for standard robot behaviors.
The cob_default_robot_behavior package provides helper scripts for standard robot behaviors.
 
1 2024-02-19 cob_default_env_config
This package contains configuration files for the default environments for Care-O-bot supported by IPA.
This package contains configuration files for the default environments for Care-O-bot supported by IPA.
 
2 2024-04-30 cob_dashboard
cob_dashboard is a modified version of [[pr2_dashboard]].
cob_dashboard is a modified version of [[pr2_dashboard]].
 
2 2024-04-30 cob_control_msgs
Common messages and services used in various packages within cob_control.
Common messages and services used in various packages within cob_control.
 
2 2024-04-30 cob_control_mode_adapter
The cob_control_mode_adapter package provides a node that automatically loads respective ros_controllers depending on required control mode.
The cob_control_mode_adapter package provides a node that automatically loads respective ros_controllers depending on required control mode.
 
2 2024-04-30 cob_control
cob_control meta-package
cob_control meta-package
 
2 2024-04-30 cob_common
The cob_common stack hosts common packages that are used within the Care-O-bot repository. E.g. utility packages or common message and service definitions etc. Also the urdf desciption of the robot is located in this stack.
The cob_common stack hosts common packages that are used within the Care-O-bot repository. E.g. utility packages or common message and service definitions etc. Also the urdf desciption of the robot is located in this stack.
 
2 2024-04-30 cob_command_tools
The cob_command_tools stack provides tools, for operating Care-O-bot.
The cob_command_tools stack provides tools, for operating Care-O-bot.
 
2 2024-04-30 cob_command_gui
This package provides a simple GUI for operating Care-O-bot.
This package provides a simple GUI for operating Care-O-bot.
 
2 2024-04-30 cob_collision_velocity_filter
The cob_collision_velocity_filter package is a package for collision avoidance using teleoperation.
The cob_collision_velocity_filter package is a package for collision avoidance using teleoperation.
 
1 2024-02-19 cob_collision_monitor
The collision monitor uses the planning scene monitor to read the state of the robot and check it for collision with itselt or the environment. It addition a ground plane is added in any case. Can be used as a stand-aloan node or a move_group capability.
The collision monitor uses the planning scene monitor to read the state of the robot and check it for collision with itselt or the environment. It addition a ground plane is added in any case. Can be used as a stand-aloan node or a move_group capability.
 
2 2024-04-30 cob_cartesian_controller
This package provides nodes that broadcast tf-frames along various (model-based) Cartesian paths (e.g. Linear, Circular). The tf-frames are interpolated using a given velocity profile (e.g. Ramp, Sinoid) and can be used as targets for the cob_frame_tracker/cob_twist_controller.
This package provides nodes that broadcast tf-frames along various (model-based) Cartesian paths (e.g. Linear, Circular). The tf-frames are interpolated using a given velocity profile (e.g. Ramp, Sinoid) and can be used as targets for the cob_frame_tracker/cob_twist_controller.
 
2 2024-04-30 cob_canopen_motor
The package cob_canopen_motor implements a controller-drive component which is connected to a can-bus and works with a canopen-interface. "CanDriveItf" provides a - more or less - generic interface to the controller-drive components. "CanDrvie..." then implements a specific setup, e.g. an ELMO Harmonica Controller in case of the "CanDriveHarmonica".
The package cob_canopen_motor implements a controller-drive component which is connected to a can-bus and works with a canopen-interface. "CanDriveItf" provides a - more or less - generic interface to the controller-drive components. "CanDrvie..." then implements a specific setup, e.g. an ELMO Harmonica Controller in case of the "CanDriveHarmonica".
 
1 2024-02-19 cob_cam3d_throttle
cob_cam3d_throttle: only for Trottel
cob_cam3d_throttle: only for Trottel
 
1 2024-02-19 cob_calibration_data
This repository holds the current calibration data for Care-O-bot.
This repository holds the current calibration data for Care-O-bot.
 
1 2024-02-19 cob_bringup_sim
This package provides launch files for starting a simulated Care-O-bot.
This package provides launch files for starting a simulated Care-O-bot.
 
1 2024-02-19 cob_bringup
This package provides launch files for operating Care-O-bot.
This package provides launch files for operating Care-O-bot.
 
2 2024-04-30 cob_bms_driver
Driver package for interfacing the battery management system (BMS) on Care-O-bot.
Driver package for interfacing the battery management system (BMS) on Care-O-bot.
 
2 2024-04-30 cob_base_velocity_smoother
The 'cob_base_velocity_smoother' reads velocity messages and publishes messages of the same type for "smoothed" velocity to avoid shaking behavior.
The 'cob_base_velocity_smoother' reads velocity messages and publishes messages of the same type for "smoothed" velocity to avoid shaking behavior.
 
2 2024-04-30 cob_base_drive_chain
This package contains classes that are able to control the platform of the Care-O-Bot. This means to establish a CAN communication to drive and steering motors of the platform and later send motion commands and receive motor information.
This package contains classes that are able to control the platform of the Care-O-Bot. This means to establish a CAN communication to drive and steering motors of the platform and later send motion commands and receive motor information.
 
2 2024-04-30 cob_base_controller_utils
The cob_base_controller_utils package contains common utils for various base_controllers.
The cob_base_controller_utils package contains common utils for various base_controllers.
 
1 2024-02-19 cob_android_settings
cob_android_settings
cob_android_settings
 
1 2024-02-19 cob_android_script_server
cob_android_script_server
cob_android_script_server
 
1 2024-02-19 cob_android_resource_server
cob_android_resource_server
cob_android_resource_server
 
1 2024-02-19 cob_android_msgs
cob_android_msgs
cob_android_msgs
 
1 2024-02-19 cob_android
cob_android package provides tools for android apps operation.
cob_android package provides tools for android apps operation.
 
2 2024-04-30 cob_actions
This Package contains Care-O-bot specific action definitions.
This Package contains Care-O-bot specific action definitions.
 

Packages

Name Description
1 safe_teleop_base
1 s3_file_uploader
1 s3_common
1 rxros_tf
1 rxros
1 rxcpp_vendor
1 rx_service_tools
1 rwt_utils_3rdparty
1 rwt_steer
1 rwt_speech_recognition
1 rwt_robot_monitor
1 rwt_plot
1 rwt_nav
1 rwt_moveit
1 rwt_image_view
1 rwt_app_chooser
1 rviz_tool_path_display
1 rviz_tool_cursor
1 rviz_satellite
1 rviz_robot_description_topic
1 rviz_python_tutorial
1 rviz_plugin_tutorials
1 rviz_marker_tools
1 rviz_animated_view_controller
1 rviz_2d_overlay_plugins
1 rviz_2d_overlay_msgs
1 rviz
1 ruckig
0 rtshell
1 rtmros_nextage
1 rtmros_hironx
1 rtmros_common
1 rtmbuild
1 rtabmap_viz
1 rtabmap_util
1 rtabmap_sync
1 rtabmap_slam
1 rtabmap_rviz_plugins
1 rtabmap_python
1 rtabmap_odom
1 rtabmap_msgs
1 rtabmap_legacy
1 rtabmap_launch
1 rtabmap_examples
1 rtabmap_demos
1 rtabmap_costmap_plugins
1 rtabmap_conversions
1 rt_usb_9axisimu_driver
1 rsm_rviz_plugins
1 rsm_rqt_plugins
1 rsm_msgs
1 rsm_core
1 rsm_additions
1 rslidar_sdk
1 rslidar_pointcloud
1 rslidar_msgs
1 rslidar_driver
1 rslidar
1 rsl
1 rrt_planner
1 rr_rover_zero_driver
1 rr_openrover_stack
1 rr_openrover_simulation
1 rr_openrover_driver_msgs
1 rr_openrover_driver
1 rr_openrover_description
1 rr_control_input_manager
1 rqt_web
1 rqt_virtual_joy
1 rqt_rviz
1 rqt_rotors
1 rqt_rosmon
1 rqt_rosbag_fancy
1 rqt_robot_plugins
1 rqt_py_trees
1 rqt_pr2_dashboard
1 rqt_pose_view
1 rqt_play_motion_builder
1 rqt_paramedit
1 rqt_nav_view
1 rqt_multiplot
1 rqt_mocap4r2_control
1 rqt_logger_level
1 rqt_launchtree
1 rqt_launch
1 rqt_joint_trajectory_plot
2 rqt_joint_trajectory_controller
1 rqt_human_radar
1 rqt_ground_robot_teleop
1 rqt_gauges
1 rqt_ez_publisher
1 rqt_dwb_plugin
1 rqt_drone_teleop
1 rqt_dotgraph
1 rqt_dep
2 rqt_controller_manager
1 rqt_bag_exporter
1 route_network
1 rotors_simulator
1 rotors_joy_interface
0 rotors_hil_interface
1 rotors_gazebo_plugins
1 rotors_gazebo
1 rotors_evaluation
1 rotors_driver
1 rotors_description
1 rotors_control
1 rotors_comm
1 rotate_recovery
1 rosx_introspection
1 roswww_static
1 roswww
1 roswtf
1 rosunit
1 rostwitter
1 rostopic
1 rostime
1 rosthrottle
1 rostest_node_interface_validation
1 rostest
1 rostate_machine
0 rossmbus
1 rosservice
1 rosserial_xbee
1 rosserial_windows
1 rosserial_vex_v5
1 rosserial_vex_cortex
1 rosserial_tivac
1 rosserial_test
1 rosserial_server
1 rosserial_python
1 rosserial_msgs
1 rosserial_mbed
1 rosserial_leonardo_cmake
1 rosserial_embeddedlinux
1 rosserial_client
1 rosserial_chibios
1 rosserial_arduino
1 rosserial
1 rosrt
1 rospy_message_converter
1 rospy
1 rosping
1 rospilot
1 rospatlite
1 rosparam_shortcuts
1 rosparam_handler
1 rosparam
1 rospack
1 rosout
1 rosnode_rtc
1 rosnode
1 rosmsg_cpp
1 rosmsg
1 rosmon_msgs
1 rosmon_core
1 rosmon
1 rosmaster
1 rosmake
1 roslz4
1 roslisp_utilities
1 roslisp_repl
1 roslisp_common
1 roslisp
1 roslint
1 roslib
1 roslaunch
1 roslang
1 rosidl_typesupport_tests
1 rosidl_typesupport_introspection_tests
1 rosidl_pycommon
1 rosidl_generator_type_description
1 rosidl_generator_tests
1 rosidl_dynamic_typesupport_fastrtps
1 rosidl_dynamic_typesupport
1 rosidl_core_runtime
1 rosidl_core_generators
1 rosgraph
1 rosfmt
1 roseus_tutorials
1 roseus_smach
1 roseus_mongo
1 roseus
1 rosemacs
1 rosee_msg
1 rose2
1 rosdoc_lite
1 rosdiagnostic
1 roscreate
1 roscpp_traits
1 roscpp_serialization
1 roscpp_core
1 roscpp
1 rosconsole_bridge
1 rosconsole
1 roscompile
1 rosclean
1 rosbuild
1 rosboost_cfg
1 rosbash_params

Packages

Name Description
1 2015-05-20 graft
Graft is not yet finished. It's intended to be a full replacement to robot_pose_ekf, including native absolute references, and arbitrary topic configuration. If you try to use Graft now, please note that not all parameters are configured and you will not always see a change in behavior by modifying the parameters.
Graft is not yet finished. It's intended to be a full replacement to robot_pose_ekf, including native absolute references, and arbitrary topic configuration. If you try to use Graft now, please note that not all parameters are configured and you will not always see a change in behavior by modifying the parameters.
 
1 2024-10-22 graceful_controller_ros
A controller. Some say it might be graceful.
A controller. Some say it might be graceful.
 
1 2024-10-22 graceful_controller
A controller.
A controller.
 
1 2024-05-15 gpsd_client
connects to a GPSd server and broadcasts GPS fixes using the NavSatFix message
connects to a GPSd server and broadcasts GPS fixes using the NavSatFix message
 
1 2024-05-15 gps_umd
gps_umd metapackage
gps_umd metapackage
 
1 2024-05-15 gps_common
GPS messages and common routines for use in GPS drivers
GPS messages and common routines for use in GPS drivers
 
1 2021-04-21 gpio_control
Control GPIO pins on Raspberry Pi, Nvidia Jetson, and other Linux devices with GPIO pins
Control GPIO pins on Raspberry Pi, Nvidia Jetson, and other Linux devices with GPIO pins
 
1 2024-07-10 google_cloud_texttospeech
The google_cloud_texttospeech package
The google_cloud_texttospeech package
 
1 2024-07-10 google_chat_ros
Use Google Chat API clients via ROS
Use Google Chat API clients via ROS
 
1 2022-08-24 goal_passer
A global planner plugin for move_base that simply passes the target pose on as a global plan. Useful for debugging local planners.
A global planner plugin for move_base that simply passes the target pose on as a global plan. Useful for debugging local planners.
 
1 2024-08-21 gmapping
This package contains a ROS wrapper for OpenSlam's Gmapping. The gmapping package provides laser-based SLAM (Simultaneous Localization and Mapping), as a ROS node called slam_gmapping. Using slam_gmapping, you can create a 2-D occupancy grid map (like a building floorplan) from laser and pose data collected by a mobile robot.
This package contains a ROS wrapper for OpenSlam's Gmapping. The gmapping package provides laser-based SLAM (Simultaneous Localization and Mapping), as a ROS node called slam_gmapping. Using slam_gmapping, you can create a 2-D occupancy grid map (like a building floorplan) from laser and pose data collected by a mobile robot.
 
1 2021-07-30 global_planner_tests
A collection of tests for checking the validity and completeness of global planners.
A collection of tests for checking the validity and completeness of global planners.
 
1 2022-06-20 global_planner
A path planner library and node.
A path planner library and node.
 
1 2020-10-08 gl_dependency
This encapsulates the GL dependency for a specific ROS distribution and its Qt version
This encapsulates the GL dependency for a specific ROS distribution and its Qt version
 
1 2020-09-04 geos_cmake_module
cmake module for using the libgeos geometry library with ROS
cmake module for using the libgeos geometry library with ROS
 
1 2017-08-07 geometry_tutorials
Metapackage of geometry tutorials ROS.
Metapackage of geometry tutorials ROS.
 
2 2021-01-12 geometry_msgs
geometry_msgs provides messages for common geometric primitives such as points, vectors, and poses. These primitives are designed to provide a common data type and facilitate interoperability throughout the system.
geometry_msgs provides messages for common geometric primitives such as points, vectors, and poses. These primitives are designed to provide a common data type and facilitate interoperability throughout the system.
 
3 2022-06-23 geometry2
A metapackage to bring in the default packages second generation Transform Library in ros, tf2.
A metapackage to bring in the default packages second generation Transform Library in ros, tf2.
 
1 2021-09-02 geometry
 
1 2023-04-12 geometric_shapes
Generic definitions of geometric shapes and bodies.
Generic definitions of geometric shapes and bodies.
 
1 2022-01-28 geographic_msgs
ROS messages for Geographic Information Systems.
ROS messages for Geographic Information Systems.
 
1 2022-01-28 geographic_info
Geographic information metapackage. Not needed for wet packages, use only to resolve dry stack dependencies.
Geographic information metapackage. Not needed for wet packages, use only to resolve dry stack dependencies.
 
1 2022-01-28 geodesy
Python and C++ interfaces for manipulating geodetic coordinates.
Python and C++ interfaces for manipulating geodetic coordinates.
 
1 2023-03-15 genpy
Python ROS message and service generators.
Python ROS message and service generators.
 
1 2020-01-25 gennodejs
Javascript ROS message and service generators.
Javascript ROS message and service generators.
 
1 2023-04-08 genmypy
Python stub generator from genmsg specs
Python stub generator from genmsg specs
 
1 2020-11-02 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.
 
1 2020-01-25 genlisp
Common-Lisp ROS message and service generators.
Common-Lisp ROS message and service generators.
 
1 2020-01-27 geneus
EusLisp ROS message and service generators.
EusLisp ROS message and service generators.
 
2 2024-04-17 generic_throttle
This package provides a throttle for ROS topics
This package provides a throttle for ROS topics
 
1 2022-05-05 gencpp
C++ ROS message and service generators.
C++ ROS message and service generators.
 
1 2024-07-10 gdrive_ros
Google drive upload and download package
Google drive upload and download package
 
1 2021-08-22 gazebo_video_monitors
Metapackage that groups together the gazebo_video_monitors packages.
Metapackage that groups together the gazebo_video_monitors packages.
 
1 2021-08-22 gazebo_video_monitor_utils
gazebo_video_monitor_utils contains utility scripts that are meant to interact with the gazebo video monitor plugins.
gazebo_video_monitor_utils contains utility scripts that are meant to interact with the gazebo video monitor plugins.
 
1 2021-08-22 gazebo_video_monitor_plugins
gazebo_video_monitor_plugins is a package that lets the user record videos of a
gazebo_video_monitor_plugins is a package that lets the user record videos of a
 
1 2021-08-22 gazebo_video_monitor_msgs
gazebo_video_monitor_msgs defines interfaces for the gazebo_video_monitor_plugins package.
gazebo_video_monitor_msgs defines interfaces for the gazebo_video_monitor_plugins package.
 
1 2022-08-23 gazebo_ros_pkgs
Interface for using ROS with the
Interface for using ROS with the
 
1 2022-08-23 gazebo_ros_control
gazebo_ros_control
gazebo_ros_control
 
1 2022-08-23 gazebo_ros
Provides ROS plugins that offer message and service publishers for interfacing with
Provides ROS plugins that offer message and service publishers for interfacing with
 
1 2022-08-23 gazebo_plugins
Robot-independent Gazebo plugins for sensors, motors and dynamic reconfigurable components.
Robot-independent Gazebo plugins for sensors, motors and dynamic reconfigurable components.
 
1 2022-08-23 gazebo_msgs
Message and service data structures for interacting with Gazebo from ROS.
Message and service data structures for interacting with Gazebo from ROS.
 
1 2022-08-23 gazebo_dev
Provides a cmake config for the default version of Gazebo for the ROS distribution.
Provides a cmake config for the default version of Gazebo for the ROS distribution.
 
1 2016-05-06 gateway_msgs
Messages used by the gateway model.
Messages used by the gateway model.
 
1 2024-09-19 fuse_viz
The fuse_viz package provides visualization tools for fuse.
The fuse_viz package provides visualization tools for fuse.
 
1 2024-09-19 fuse_variables
The fuse_variables package provides a set of commonly used variable types, such as 2D and 3D positions, orientations, velocities, and accelerations.
The fuse_variables package provides a set of commonly used variable types, such as 2D and 3D positions, orientations, velocities, and accelerations.
 
1 2024-09-19 fuse_tutorials
Package containing source code for the fuse tutorials
Package containing source code for the fuse tutorials
 
1 2024-09-19 fuse_publishers
The fuse_publishers package provides a set of common publisher plugins.
The fuse_publishers package provides a set of common publisher plugins.
 
1 2024-09-19 fuse_optimizers
The fuse_optimizers package provides a set of optimizer implementations. An optimizer is the object responsible for coordinating the sensors and motion model inputs, computing the optimal state values, and providing access to to the optimal state via the publishers.
The fuse_optimizers package provides a set of optimizer implementations. An optimizer is the object responsible for coordinating the sensors and motion model inputs, computing the optimal state values, and providing access to to the optimal state via the publishers.
 
1 2024-09-19 fuse_msgs
The fuse_msgs package contains messages capable of holding serialized fuse objects
The fuse_msgs package contains messages capable of holding serialized fuse objects
 
1 2024-09-19 fuse_models
fuse plugins that implement various kinematic and sensor models
fuse plugins that implement various kinematic and sensor models
 
1 2024-09-19 fuse_loss
The fuse_loss package provides a set of commonly used loss functions, such as the basic ones provided by Ceres.
The fuse_loss package provides a set of commonly used loss functions, such as the basic ones provided by Ceres.
 
1 2024-09-19 fuse_graphs
The fuse_graphs package provides some concrete implementations of the fuse_core::Graph interface.
The fuse_graphs package provides some concrete implementations of the fuse_core::Graph interface.
 
1 2024-09-19 fuse_doc
The fuse_doc package provides documentation and examples for the fuse package.
The fuse_doc package provides documentation and examples for the fuse package.
 
1 2024-09-19 fuse_core
The fuse_core package provides the base class interfaces for the various fuse components. Concrete implementations of these interfaces are provided in other packages.
The fuse_core package provides the base class interfaces for the various fuse components. Concrete implementations of these interfaces are provided in other packages.
 
1 2024-09-19 fuse_constraints
The fuse_constraints package provides a set of commonly used constraint types, such as direct measurements on state variables (absolute constraints) or measurements of the state changes (relative constraints).
The fuse_constraints package provides a set of commonly used constraint types, such as direct measurements on state variables (absolute constraints) or measurements of the state changes (relative constraints).
 
1 2024-09-19 fuse
The fuse metapackage
The fuse metapackage
 
1 2020-02-07 fsrobo_r_trajectory_filters
plugins for filtering trajectories.
plugins for filtering trajectories.
 
1 2020-02-07 fsrobo_r_msgs
The fsrobo_r_msgs package
The fsrobo_r_msgs package
 
1 2020-02-07 fsrobo_r_moveit_config
An automatically generated package with all the configuration and launch files for using the fsrobo_r with the MoveIt! Motion Planning Framework
An automatically generated package with all the configuration and launch files for using the fsrobo_r with the MoveIt! Motion Planning Framework
 
1 2020-02-07 fsrobo_r_driver
The fsrobo_r_driver package
The fsrobo_r_driver package
 
1 2020-02-07 fsrobo_r_description
 
1 2020-02-07 fsrobo_r_bringup
The fsrobo_r_bringup package
The fsrobo_r_bringup package
 
1 2020-02-07 fsrobo_r
Meta package for FSRobo-R
Meta package for FSRobo-R
 
1 2022-03-26 freight_bringup
Bringup for freight
Bringup for freight
 
1 2020-03-18 freenect_stack
A libfreenect-based ROS driver for the Microsoft Kinect
A libfreenect-based ROS driver for the Microsoft Kinect
 
1 2020-03-18 freenect_launch
Launch files for freenect_camera to produce rectified, registered or disparity images. Also produce point clouds and registered point clouds. Based on the openni_launch package.
Launch files for freenect_camera to produce rectified, registered or disparity images. Also produce point clouds and registered point clouds. Based on the openni_launch package.
 
1 2020-03-18 freenect_camera
A libfreenect-based ROS driver for the Microsoft Kinect. This is a port of the OpenNI driver that uses libfreenect instead, because on some systems with some devices it works better.
A libfreenect-based ROS driver for the Microsoft Kinect. This is a port of the OpenNI driver that uses libfreenect instead, because on some systems with some devices it works better.
 
1 2022-09-16 franka_visualization
This package contains visualization tools for Franka Emika.
This package contains visualization tools for Franka Emika.
 
1 2022-09-16 franka_ros
franka_ros is a metapackage for all Franka Emika ROS packages
franka_ros is a metapackage for all Franka Emika ROS packages
 
2 2022-09-16 franka_msgs
franka_msgs provides messages specific to Franka Emika research robots
franka_msgs provides messages specific to Franka Emika research robots
 
1 2022-09-16 franka_hw
franka_hw provides hardware interfaces for using Franka Emika research robots with ros_control
franka_hw provides hardware interfaces for using Franka Emika research robots with ros_control
 
2 2022-09-16 franka_gripper
This package implements the franka gripper of type Franka Hand for the use in ros
This package implements the franka gripper of type Franka Hand for the use in ros
 
1 2022-09-16 franka_gazebo
This package offers the FrankaHWSim Class to simulate a Franka Robot in Gazebo
This package offers the FrankaHWSim Class to simulate a Franka Robot in Gazebo
 
2 2022-09-16 franka_example_controllers
franka_example_controllers provides example code for controlling Franka Emika research robots with ros_control
franka_example_controllers provides example code for controlling Franka Emika research robots with ros_control
 
2 2022-09-16 franka_description
franka_description contains URDF files and meshes of Franka Emika robots
franka_description contains URDF files and meshes of Franka Emika robots
 
1 2022-09-16 franka_control
franka_control provides a hardware node to control a Franka Emika research robot
franka_control provides a hardware node to control a Franka Emika research robot
 
1 2022-03-15 frame_editor
The frame_editor package
The frame_editor package
 
1 2024-07-24 foxglove_msgs
foxglove_msgs provides visualization messages that are supported by Foxglove.
foxglove_msgs provides visualization messages that are supported by Foxglove.
 
1 2024-11-08 foxglove_bridge
ROS Foxglove Bridge
ROS Foxglove Bridge
 
1 2020-05-13 four_wheel_steering_msgs
ROS messages for robots using FourWheelSteering.
ROS messages for robots using FourWheelSteering.
 
1 2023-11-13 four_wheel_steering_controller
Controller for a four wheel steering mobile base.
Controller for a four wheel steering mobile base.
 
2 2023-04-24 forward_local_planner
forward_local_planner package.
forward_local_planner package.
 
2 2023-04-24 forward_global_planner
The forward_global_planner package.
The forward_global_planner package.
 
2 2023-11-13 forward_command_controller
forward_command_controller
forward_command_controller
 
1 2023-11-13 force_torque_sensor_controller
Controller to publish state of force-torque sensors
Controller to publish state of force-torque sensors
 
1 2020-09-15 force_torque_sensor
The force_torque_sensor package
The force_torque_sensor package
 
1 2022-11-22 fmi_adapter_examples
Provides small examples for use of the fmi_adapter package
Provides small examples for use of the fmi_adapter package
 
1 2022-11-22 fmi_adapter
Wraps FMUs for co-simulation
Wraps FMUs for co-simulation
 
1 2021-08-23 floam
A generic Lidar SLAM package based on FLOAM which was based on ALOAM by HKUST and LOAM by CMU
A generic Lidar SLAM package based on FLOAM which was based on ALOAM by HKUST and LOAM by CMU
 
1 2021-03-26 flir_ptu_viz
Launchfiles and rviz configs to assist with visualizing the FLIR PTUs.
Launchfiles and rviz configs to assist with visualizing the FLIR PTUs.
 
1 2021-03-26 flir_ptu_driver
Driver for the FLIR pan/tilt units.
Driver for the FLIR pan/tilt units.
 
1 2021-03-26 flir_ptu_description
URDF description the FLIR PTUs, currently the D46.
URDF description the FLIR PTUs, currently the D46.
 
1 2021-03-17 flir_boson_usb
A simple USB camera driver for the FLIR BOSON using OpenCV
A simple USB camera driver for the FLIR BOSON using OpenCV
 
2 2020-12-11 flexbe_widget
flexbe_widget implements some smaller scripts for the behavior engine.
flexbe_widget implements some smaller scripts for the behavior engine.
 
2 2020-12-11 flexbe_testing
flexbe_testing provides a framework for unit testing states.
flexbe_testing provides a framework for unit testing states.
 
2 2020-12-11 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.
 
2 2020-12-11 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.
 
2 2020-12-11 flexbe_msgs
flexbe_msgs provides the messages used by FlexBE.
flexbe_msgs provides the messages used by FlexBE.
 
2 2020-12-11 flexbe_mirror
flexbe_mirror implements functionality to remotely mirror an executed behavior.
flexbe_mirror implements functionality to remotely mirror an executed behavior.
 
2 2020-12-11 flexbe_input
flexbe_input enables to send data to onboard behavior when required.
flexbe_input enables to send data to onboard behavior when required.
 
2 2020-12-11 flexbe_core
flexbe_core provides the core components for the FlexBE behavior engine.
flexbe_core provides the core components for the FlexBE behavior engine.
 
2 2020-12-11 flexbe_behavior_engine
A meta-package to aggregate all the FlexBE packages
A meta-package to aggregate all the FlexBE packages
 
2 2024-04-29 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 2018-10-07 flatbuffers
Google flatbuffers.
Google flatbuffers.
 
1 2023-07-05 fkie_potree_rviz_plugin
Render large point clouds in rviz
Render large point clouds in rviz
 
1 2021-09-10 fkie_message_filters
Improved ROS message filters
Improved ROS message filters
 
1 2024-09-24 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:
 
1 2022-12-11 find_object_2d
The find_object_2d package
The find_object_2d package
 
1 2022-05-10 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 2021-06-15 file_uploader_msgs
Messages and actions for S3 file uploader.
Messages and actions for S3 file uploader.
 
1 2022-02-08 file_management
AWS CloudWatch management library used to manage offline files.
AWS CloudWatch management library used to manage offline files.
 
1 2021-07-19 fiducials
Localization using fiducial markers
Localization using fiducial markers
 
1 2021-07-19 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 2021-07-19 fiducial_msgs
Package containing message definitions for fiducials
Package containing message definitions for fiducials
 
1 2024-07-10 ffha
ffha: PDDL Planner (http://ipc.informatik.uni-freiburg.de)
ffha: PDDL Planner (http://ipc.informatik.uni-freiburg.de)
 
1 2024-07-10 ff
ff: pddl planner. see http://www.loria.fr/~hoffmanj/ff.html
ff: pddl planner. see http://www.loria.fr/~hoffmanj/ff.html
 
1 2021-05-13 fetchit_challenge
The fetchit_challenge package
The fetchit_challenge package
 
1 2020-10-06 fetch_tools
Commands for performing common operations when developing on the robots. For help, run `fetch -h` and `fetch COMMAND -h`.
Commands for performing common operations when developing on the robots. For help, run `fetch -h` and `fetch COMMAND -h`.
 
1 2021-03-07 fetch_teleop
Teleoperation for fetch and freight.
Teleoperation for fetch and freight.
 
1 2021-05-13 fetch_simulation
Fetch Simulation, packages for working with Fetch and Freight in Gazebo
Fetch Simulation, packages for working with Fetch and Freight in Gazebo
 
1 2019-06-14 fetch_simple_linear_controller
Position feedback controller for simple linear motion of the fetch robot's end-effector.
Position feedback controller for simple linear motion of the fetch robot's end-effector.
 
1 2021-03-07 fetch_ros
Fetch ROS, packages for working with Fetch and Freight
Fetch ROS, packages for working with Fetch and Freight
 
1 2019-10-24 fetch_open_auto_dock
An open-source version of the Fetch charge docking system.
An open-source version of the Fetch charge docking system.
 
1 2021-03-07 fetch_navigation
Configuration and launch files for running ROS navigation on Fetch.
Configuration and launch files for running ROS navigation on Fetch.
 
1 2021-03-07 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 2021-03-07 fetch_maps
The fetch_maps package
The fetch_maps package
 
1 2021-03-07 fetch_ikfast_plugin
Kinematics plugin for Fetch robot, generated through IKFast
Kinematics plugin for Fetch robot, generated through IKFast
 
1 2021-05-13 fetch_gazebo_demo
Demos for fetch_gazebo package.
Demos for fetch_gazebo package.
 
1 2021-05-13 fetch_gazebo
Gazebo package for Fetch.
Gazebo package for Fetch.
 
1 2022-03-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 2020-10-24 fetch_driver_msgs
Messages for the fetch_drivers package
Messages for the fetch_drivers package
 
1 2021-03-07 fetch_description
URDF for Fetch Robot.
URDF for Fetch Robot.
 
1 2021-03-07 fetch_depth_layer
The fetch_depth_layer package
The fetch_depth_layer package
 
1 2021-03-07 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 2022-03-26 fetch_bringup
Bringup for fetch
Bringup for fetch
 
1 2020-10-24 fetch_auto_dock_msgs
Messages for fetch_auto_dock package
Messages for fetch_auto_dock package
 
1 2023-12-04 fcl
FCL: the Flexible Collision Library
FCL: the Flexible Collision Library
 
2 2022-04-14 fath_pivot_mount_description
URDF Macro for adding an adjustable, fath pivot mount used for cameras and other sensors
URDF Macro for adding an adjustable, fath pivot mount used for cameras and other sensors
 
1 2022-06-20 fake_localization
A ROS node that simply forwards odometry information.
A ROS node that simply forwards odometry information.
 
1 2023-01-26 fake_joint_launch
Collection of the launch files for fake_joint_driver.
Collection of the launch files for fake_joint_driver.
 
1 2023-01-26 fake_joint_driver
The fake_joint_driver package
The fake_joint_driver package
 
1 2023-01-26 fake_joint
This metapackage depends on fake-joint related package for ros_control.
This metapackage depends on fake-joint related package for ros_control.
 
2 2021-05-17 fadecandy_msgs
ROS msgs for fadecandy LED controllers
ROS msgs for fadecandy LED controllers
 
2 2021-05-17 fadecandy_driver
ROS driver for fadecandy LED controllers
ROS driver for fadecandy LED controllers
 
1 2021-02-20 face_detector
Face detection in images.
Face detection in images.
 
1 2021-01-07 explore_lite
Lightweight frontier-based exploration.
Lightweight frontier-based exploration.
 
1 2018-12-19 exotica_val_description
val_description version including our updated meshes for unit testing and visualisation. Based on the OpenHumanoids fork of the val_description package by NASA JSC. The most current version of the original package can be found at http://gitlab.com/nasa-jsc-robotics/val_description
val_description version including our updated meshes for unit testing and visualisation. Based on the OpenHumanoids fork of the val_description package by NASA JSC. The most current version of the original package can be found at http://gitlab.com/nasa-jsc-robotics/val_description
 
1 2024-05-27 exotica_time_indexed_rrt_connect_solver
Time-Indexed RRT-Connect solver (Humanoids 2018)
Time-Indexed RRT-Connect solver (Humanoids 2018)
 
1 2024-05-27 exotica_scipy_solver
SciPy-based Python solvers for Exotica
SciPy-based Python solvers for Exotica
 
1 2024-05-27 exotica_quadrotor_dynamics_solver
Quadrotor dynamics solver plug-in for Exotica
Quadrotor dynamics solver plug-in for Exotica
 
1 2024-05-27 exotica_python
Python bindings for EXOTica
Python bindings for EXOTica
 
1 2024-05-27 exotica_pinocchio_dynamics_solver
Dynamics solver plug-in using Pinocchio for Exotica
Dynamics solver plug-in using Pinocchio for Exotica
 
1 2024-05-27 exotica_pendulum_dynamics_solver
Pendulum dynamics solver plug-in for Exotica
Pendulum dynamics solver plug-in for Exotica
 
1 2024-05-27 exotica_ompl_solver
Exotica solvers based on the Open Motion Planning Libary (OMPL)
Exotica solvers based on the Open Motion Planning Libary (OMPL)
 
1 2024-05-27 exotica_ompl_control_solver
Kinodynamic Control Solvers from OMPL
Kinodynamic Control Solvers from OMPL
 
1 2024-05-27 exotica_levenberg_marquardt_solver
A Levenberg-Marquardt solver for EXOTica
A Levenberg-Marquardt solver for EXOTica
 
1 2024-05-27 exotica_ilqr_solver
ILQR Solver (Li and Todorov, 2004)
ILQR Solver (Li and Todorov, 2004)
 
1 2024-05-27 exotica_ilqg_solver
ILQG Solver (Todorov and Li, 2004)
ILQG Solver (Todorov and Li, 2004)
 
1 2024-05-27 exotica_ik_solver
Regularised and weighted pseudo-inverse unconstrained end-pose solver
Regularised and weighted pseudo-inverse unconstrained end-pose solver
 
1 2024-05-27 exotica_examples
Package containing examples and system tests for EXOTica.
Package containing examples and system tests for EXOTica.
 
1 2024-05-27 exotica_dynamics_solvers
Metapackage for all dynamics solvers bundled with core EXOTica.
Metapackage for all dynamics solvers bundled with core EXOTica.
 
1 2024-05-27 exotica_double_integrator_dynamics_solver
Double integrator dynamics solver plug-in for Exotica
Double integrator dynamics solver plug-in for Exotica
 
1 2024-05-27 exotica_ddp_solver
Various DDP Solvers
Various DDP Solvers
 
1 2024-05-27 exotica_core_task_maps
Common taskmaps provided with EXOTica.
Common taskmaps provided with EXOTica.
 
1 2024-05-27 exotica_core
The Extensible Optimization Toolset (EXOTica) is a library for defining problems for robot motion planning.
The Extensible Optimization Toolset (EXOTica) is a library for defining problems for robot motion planning.
 
1 2024-05-27 exotica_collision_scene_fcl_latest
Collision checking and distance computation using the latest version of the FCL library.
Collision checking and distance computation using the latest version of the FCL library.
 
1 2024-05-27 exotica_cartpole_dynamics_solver
Cartpole dynamics solver plug-in for Exotica
Cartpole dynamics solver plug-in for Exotica
 
1 2024-05-27 exotica_aico_solver
Implementation of the Approximate Inference Control algorithm (AICO)
Implementation of the Approximate Inference Control algorithm (AICO)
 
1 2024-05-27 exotica
The Extensible Optimization Toolset (EXOTica) is a library for defining problems for robot motion planning. This package serves similar to a metapackage and contains dependencies onto all core-released exotica packages. It also builds the documentation.
The Extensible Optimization Toolset (EXOTica) is a library for defining problems for robot motion planning. This package serves similar to a metapackage and contains dependencies onto all core-released exotica packages. It also builds the documentation.
 
1 2023-06-28 executive_smach_visualization
This metapackage depends on the SMACH visualization tools.
This metapackage depends on the SMACH visualization tools.
 
1 2023-06-13 executive_smach
This metapackage depends on the SMACH library and ROS SMACH integration packages.
This metapackage depends on the SMACH library and ROS SMACH integration packages.
 
1 2024-07-17 eusurdf
urdf models converted from euslisp
urdf models converted from euslisp
 
1 2024-07-17 euslisp_model_conversion_tester
euslisp_model_conversion_tester
euslisp_model_conversion_tester
 
1 2022-11-06 euslime
EusLisp meets SLIME
EusLisp meets SLIME
 
1 2024-07-17 euscollada
euscollada
euscollada
 
1 2024-01-22 eus_teleop
The eus_teleop package
The eus_teleop package
 
1 2024-01-22 eus_qpoases
eus_qpoases
eus_qpoases
 
1 2024-01-22 eus_qp
eus_qp is an interface of euslisp to solve qp problems with linear constraints.
eus_qp is an interface of euslisp to solve qp problems with linear constraints.
 
1 2024-01-22 eus_nlopt
eus_nlopt
eus_nlopt
 
1 2024-07-17 eus_assimp
eus_assimp
eus_assimp
 
1 2022-11-09 ethercat_trigger_controllers
Controllers to operate the digital output of the motor controller boards and the projector board. This package has not been reviewed and should be considered unstable.
Controllers to operate the digital output of the motor controller boards and the projector board. This package has not been reviewed and should be considered unstable.
 
1 2018-06-16 ethercat_manager
ROS-Industrial support stack for facilitating communication with EtherCAT networks. The code is mainly copied from https://github.com/ros-industrial/robotiq/blob/jade-devel/robotiq_ethercat/src/ethercat_manager.cpp
ROS-Industrial support stack for facilitating communication with EtherCAT networks. The code is mainly copied from https://github.com/ros-industrial/robotiq/blob/jade-devel/robotiq_ethercat/src/ethercat_manager.cpp
 
1 2024-09-24 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 2021-04-27 ethercat_grant
Makes it possible to run the ros_ethercat_loop without using sudo. Forked from pr2-grant
Makes it possible to run the ros_ethercat_loop without using sudo. Forked from pr2-grant
 
1 2023-11-30 ess_imu_ros1_uart_driver
ROS1 package for Epson IMU using UART interface based on C++ wrapper of Linux C driver
ROS1 package for Epson IMU using UART interface based on C++ wrapper of Linux C driver
 
1 2022-06-24 er_public_msgs
Enabled Robotics public messages package
Enabled Robotics public messages package
 
1 2024-03-11 epos2_motor_controller
EPOS2 motor controller driver
EPOS2 motor controller driver
 
1 2024-11-18 end_effector
End-Effector package: provides a ROS-based set of standard interfaces to command robotics end-effectors in an agnostic fashion
End-Effector package: provides a ROS-based set of standard interfaces to command robotics end-effectors in an agnostic fashion
 
1 2024-11-02 eiquadprog
Eiquadprog a QP solver using active sets
Eiquadprog a QP solver using active sets
 
1 2024-10-30 eigenpy
Bindings between Numpy and Eigen using Boost.Python
Bindings between Numpy and Eigen using Boost.Python
 
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 2021-09-02 eigen_conversions
Conversion functions between: - Eigen and KDL - Eigen and geometry_msgs.
Conversion functions between: - Eigen and KDL - Eigen and geometry_msgs.
 
2 2023-04-24 eg_random_generator
The eg_random_generator package
The eg_random_generator package
 
2 2023-04-24 eg_conditional_generator
The eg_conditional_generator package
The eg_conditional_generator package
 
2 2023-11-13 effort_controllers
effort_controllers
effort_controllers
 
1 2018-09-11 ecl_utilities
Includes various supporting tools and utilities for c++ programming.
Includes various supporting tools and utilities for c++ programming.
 
1 2018-09-11 ecl_type_traits
Extends c++ type traits and implements a few more to boot.
Extends c++ type traits and implements a few more to boot.
 
1 2019-08-21 ecl_tools
Tools and utilities for ecl development.
Tools and utilities for ecl development.
 
1 2016-06-15 ecl_time_lite
Provides a portable set of time functions that are especially useful for porting other code or being wrapped by higher level c++ classes.
Provides a portable set of time functions that are especially useful for porting other code or being wrapped by higher level c++ classes.
 
1 2018-09-11 ecl_time
Timing utilities are very dependent on the system api provided for their use. This package provides a means for handling different timing models. Current support - posix rt : complete. - macosx : posix timers only, missing absolute timers. - win : none.
Timing utilities are very dependent on the system api provided for their use. This package provides a means for handling different timing models. Current support - posix rt : complete. - macosx : posix timers only, missing absolute timers. - win : none.