Ycarus Gentoo ebuild

ros-overlay

These ebuilds come from .

If you have some problems, go to the official site first.

ros-galactic

acado_vendor : ament package for ACADO toolkit for MPC code generation ( https://wiki.ros.org )

ackermann_msgs : ROS2 messages for robots using Ackermann steering. ( https://wiki.ros.org )

action_msgs : Messages and service definitions common among all ROS actions. ( https://wiki.ros.org )

action_tutorials_cpp : C++ action tutorial cpp code ( https://wiki.ros.org )

action_tutorials_interfaces : Action tutorials action ( https://wiki.ros.org )

action_tutorials_py : Python action tutorial code ( https://wiki.ros.org )

actionlib_msgs : A package containing some message definitions used in the implementation of[...] ( https://wiki.ros.org )

ament_black : The ability to check code against style conventions using ( https://wiki.ros.org )

ament_clang_format : The ability to check code against style conventions using ( https://wiki.ros.org )

ament_clang_tidy : The ability to check code against style conventions using ( https://wiki.ros.org )

ament_cmake : The entry point package for the ament buildsystem in CMake. ( https://wiki.ros.org )

ament_cmake_auto : The auto-magic functions for ease to use of the ament buildsystem in CMake. ( https://wiki.ros.org )

ament_cmake_black : The CMake API for ament_black to lint Python code using black. ( https://wiki.ros.org )

ament_cmake_catch2 : Allows integrating catch2 tests in the ament buildsystem with CMake ( https://wiki.ros.org )

ament_cmake_clang_format : The CMake API for ament_clang_format to lint C / C++ code using clang format. ( https://wiki.ros.org )

ament_cmake_clang_tidy : The CMake API for ament_clang_tidy to lint C / C++ code using clang tidy. ( https://wiki.ros.org )

ament_cmake_copyright : The CMake API for ament_copyright to check every source file contains copyr[...] ( https://wiki.ros.org )

ament_cmake_core : The core of the ament buildsystem in CMake. ( https://wiki.ros.org )

ament_cmake_cppcheck : The CMake API for ament_cppcheck to perform static code analysis on C/C++ ( https://wiki.ros.org )

ament_cmake_cpplint : The CMake API for ament_cpplint to lint C / C++ code using cpplint. ( https://wiki.ros.org )

ament_cmake_export_definitions : The ability to export definitions to downstream packages in the ament build[...] ( https://wiki.ros.org )

ament_cmake_export_dependencies : The ability to export dependencies to downstream packages in the ament buil[...] ( https://wiki.ros.org )

ament_cmake_export_include_directories : The ability to export include directories to downstream packages in the ame[...] ( https://wiki.ros.org )

ament_cmake_export_interfaces : The ability to export interfaces to downstream packages in the ament builds[...] ( https://wiki.ros.org )

ament_cmake_export_libraries : The ability to export libraries to downstream packages in the ament buildsy[...] ( https://wiki.ros.org )

ament_cmake_export_link_flags : The ability to export link flags to downstream packages in the ament builds[...] ( https://wiki.ros.org )

ament_cmake_export_targets : The ability to export targets to downstream packages in the ament buildsyst[...] ( https://wiki.ros.org )

ament_cmake_flake8 : The CMake API for ament_flake8 to check code syntax and style conventions ( https://wiki.ros.org )

ament_cmake_gmock : The ability to add Google mock-based tests in the ament buildsystem in CMake. ( https://wiki.ros.org )

ament_cmake_google_benchmark : The ability to add Google Benchmark tests in the ament buildsystem in CMake. ( https://wiki.ros.org )

ament_cmake_gtest : The ability to add gtest-based tests in the ament buildsystem in CMake. ( https://wiki.ros.org )

ament_cmake_include_directories : The functionality to order include directories according to a chain of pref[...] ( https://wiki.ros.org )

ament_cmake_libraries : The functionality to deduplicate libraries in the ament buildsystem in CMake. ( https://wiki.ros.org )

ament_cmake_lint_cmake : The CMake API for ament_lint_cmake to lint CMake code using cmakelint. ( https://wiki.ros.org )

ament_cmake_mypy : The CMake API for ament_mypy to perform static type analysis on python code[...] ( https://wiki.ros.org )

ament_cmake_nose : The ability to add nose-based tests in the ament buildsystem in CMake. ( https://wiki.ros.org )

ament_cmake_pclint : The CMake API for ament_pclint to perform static code analysis on C/C++ ( https://wiki.ros.org )

ament_cmake_pep257 : The CMake API for ament_pep257 to check code against the style conventions [...] ( https://wiki.ros.org )

ament_cmake_pycodestyle : The CMake API for ament_pycodestyle to check code against the style convent[...] ( https://wiki.ros.org )

ament_cmake_pyflakes : The CMake API for ament_pyflakes to check code using pyflakes. ( https://wiki.ros.org )

ament_cmake_pytest : The ability to run Python tests using pytest in the ament buildsystem in CMake. ( https://wiki.ros.org )

ament_cmake_python : The ability to use Python in the ament buildsystem in CMake. ( https://wiki.ros.org )

ament_cmake_ros : The ROS specific CMake bits in the ament buildsystem. ( https://wiki.ros.org )

ament_cmake_target_dependencies : The ability to add definitions, include directories and libraries of a pack[...] ( https://wiki.ros.org )

ament_cmake_test : The ability to add tests in the ament buildsystem in CMake. ( https://wiki.ros.org )

ament_cmake_uncrustify : The CMake API for ament_uncrustify to check code against styleconventions ( https://wiki.ros.org )

ament_cmake_version : The ability to override the exported package version in the ament buildsystem. ( https://wiki.ros.org )

ament_cmake_xmllint : The CMake API for ament_xmllint to check XML file using xmmlint. ( https://wiki.ros.org )

ament_copyright : The ability to check source files for copyright and license ( https://wiki.ros.org )

ament_cppcheck : The ability to perform static code analysis on C/C++ code using Cppcheck ( https://wiki.ros.org )

ament_cpplint : The ability to check code against the Google style conventions using ( https://wiki.ros.org )

ament_flake8 : The ability to check code for style and syntax conventions with flake8. ( https://wiki.ros.org )

ament_index_cpp : C++ API to access the ament resource index. ( https://wiki.ros.org )

ament_index_python : Python API to access the ament resource index. ( https://wiki.ros.org )

ament_lint : Providing common API for ament linter packages. ( https://wiki.ros.org )

ament_lint_auto : The auto-magic functions for ease to use of the ament linters in CMake. ( https://wiki.ros.org )

ament_lint_cmake : The ability to lint CMake code using cmakelint and generate xUnit test ( https://wiki.ros.org )

ament_lint_common : The list of commonly used linters in the ament buildsytem in CMake. ( https://wiki.ros.org )

ament_mypy : Support for mypy static type checking in ament. ( https://wiki.ros.org )

ament_nodl : Ament extension for exporting NoDL .xml files ( https://wiki.ros.org )

ament_package : The parser for the manifest files in the ament buildsystem. ( https://wiki.ros.org )

ament_pclint : The ability to perform static code analysis on C/C++ code using pclint ( https://wiki.ros.org )

ament_pep257 : The ability to check code against the style conventions in PEP 8 and ( https://wiki.ros.org )

ament_pycodestyle : The ability to check code against the style conventions in PEP 8 and ( https://wiki.ros.org )

ament_pyflakes : The ability to check code using pyflakes and generate xUnit test ( https://wiki.ros.org )

ament_uncrustify : The ability to check code against style conventions using uncrustify ( https://wiki.ros.org )

ament_xmllint : The ability to check XML files like the package manifest using xmllint ( https://wiki.ros.org )

angles : This package provides a set of simple math utilities to work ( http://wiki.ros.org/angles )

apex_containers : Containers ( https://wiki.ros.org )

apex_test_tools : The package Apex.OS Test Tools contains test helpers ( https://wiki.ros.org )

apriltag : AprilTag detector library ( https://april.eecs.umich.edu/software/apriltag.html )

asio_cmake_module : A CMake module for using the ASIO network library ( https://github.com/ros-drivers/transport_drivers )

async_web_server_cpp : Asynchronous Web/WebSocket Server in C++ ( http://ros.org/wiki/async_web_server_cpp )

autoware_auto_msgs : Interfaces between core Autoware.Auto components ( https://wiki.ros.org )

aws_robomaker_small_warehouse_world : AWS RoboMaker package for a warehouse world to use in manufacturing and log[...] ( https://wiki.ros.org )

azure-iot-sdk-c : Azure IoT C SDKs and Libraries ( https://wiki.ros.org )

backward_ros : The backward_ros package is a ros wrapper of backward-cpp from https://gith[...] ( https://wiki.ros.org )

bond : A bond allows two processes, A and B, to know when the other has ( http://www.ros.org/wiki/bond )

bond_core : A bond allows two processes, A and B, to know when the other has ( http://www.ros.org/wiki/bond_core )

bondcpp : C++ implementation of bond, a mechanism for checking when ( http://www.ros.org/wiki/bondcpp )

boost_geometry_util : Utility library for boost geometry ( https://wiki.ros.org )

builtin_interfaces : A package containing message and service definitions for types defined in t[...] ( https://wiki.ros.org )

camera_calibration_parsers : camera_calibration_parsers contains routines for reading and writing camera[...] ( http://ros.org/wiki/camera_calibration_parsers )

camera_info_manager : This package provides a C++ interface for camera calibration ( http://ros.org/wiki/camera_info_manager )

can_msgs : CAN related message types. ( http://wiki.ros.org/can_msgs )

cartographer_ros : Cartographer is a system that provides real-time simultaneous localization\[...] ( https://github.com/ros2/cartographer_ros )

cartographer_ros_msgs : ROS messages for the cartographer_ros package. ( https://github.com/ros2/cartographer_ros )

cascade_lifecycle_msgs : Messages for rclcpp_cascade_lifecycle package ( https://wiki.ros.org )

chomp_motion_planner : chomp_motion_planner ( http://ros.org/wiki/chomp_motion_planner )

class_loader : The class_loader package is a ROS-independent package for loading plugins d[...] ( http://ros.org/wiki/class_loader )

color_names : The color_names package ( https://wiki.ros.org )

common_interfaces : common_interfaces contains messages and services that are widely used by ot[...] ( https://wiki.ros.org )

composition : Examples for composing multiple nodes in a single process. ( https://wiki.ros.org )

composition_interfaces : A package containing message and service definitions for managing composabl[...] ( https://wiki.ros.org )

compressed_depth_image_transport : Compressed_depth_image_transport provides a plugin to image_transport for t[...] ( http://www.ros.org/wiki/image_transport_plugins )

compressed_image_transport : Compressed_image_transport provides a plugin to image_transport for transpa[...] ( http://www.ros.org/wiki/image_transport_plugins )

console_bridge_vendor : Wrapper around console_bridge, providing nothing but a dependency on consol[...] ( https://github.com/ros/console_bridge )

control_box_rst : The control_box_rst package provides C++ libraries for predictive control, [...] ( http://wiki.ros.org/control_box_rst )

control_msgs : control_msgs contains base messages and actions useful for ( http://ros.org/wiki/control_msgs )

control_toolbox : The control toolbox contains modules that are useful across all controllers. ( http://ros.org/wiki/control_toolbox )

controller_interface : Description of controller_interface ( https://wiki.ros.org )

controller_manager : Description of controller_manager ( https://wiki.ros.org )

controller_manager_msgs : Messages and services for the controller manager. ( http://ros.org/wiki/controller_manager_msgs )

costmap_queue : The costmap_queue package ( https://wiki.ros.org )

cudnn_cmake_module : Exports a CMake module to find cuDNN. ( https://wiki.ros.org )

cv_bridge : This contains CvBridge, which converts between ROS2 ( http://www.ros.org/wiki/cv_bridge )

cyclonedds : Eclipse Cyclone DDS is a very performant and robust open-source DDS impleme[...] ( https://projects.eclipse.org/projects/iot.cyclonedds )

demo_nodes_cpp : C++ nodes which were previously in the ros2/examples repository but are now[...] ( https://wiki.ros.org )

demo_nodes_cpp_native : C++ nodes which access the native handles of the rmw implemenation. ( https://wiki.ros.org )

demo_nodes_py : Python nodes which were previously in the ros2/examples repository but are [...] ( https://wiki.ros.org )

depth_image_proc : Contains components for processing depth images such as those ( https://index.ros.org/p/depth_image_proc/github-ros-perception-image_pipeline/ )

depthimage_to_laserscan : depthimage_to_laserscan ( http://ros.org/wiki/depthimage_to_laserscan )

desktop : A package which extends \'ros_base\' and includes high level packages like [...] ( https://wiki.ros.org )

diagnostic_aggregator : diagnostic_aggregator ( http://www.ros.org/wiki/diagnostic_aggregator )

diagnostic_msgs : A package containing some diagnostics related message and service definitions. ( https://wiki.ros.org )

diagnostic_updater : diagnostic_updater contains tools for easily updating diagnostics. it is co[...] ( http://www.ros.org/wiki/diagnostic_updater )

diff_drive_controller : Controller for a differential drive mobile base. ( https://wiki.ros.org )

dolly : Meta-package for Dolly, the robot sheep. ( https://wiki.ros.org )

dolly_follow : Follow node for Dolly, the robot sheep. ( https://wiki.ros.org )

dolly_gazebo : Launch Gazebo simulation with Dolly robot. ( https://wiki.ros.org )

dolly_ignition : Launch Ignition simulation with Dolly robot. ( https://wiki.ros.org )

domain_bridge : ROS 2 Domain Bridge ( https://wiki.ros.org )

domain_coordinator : A tool to coordinate unique ROS_DOMAIN_IDs across multiple processes ( https://wiki.ros.org )

dummy_map_server : dummy map server node ( https://wiki.ros.org )

dummy_robot_bringup : dummy robot bringup ( https://wiki.ros.org )

dummy_sensors : dummy sensor nodes ( https://wiki.ros.org )

dwb_core : TODO ( https://wiki.ros.org )

dwb_critics : The dwb_critics package ( https://wiki.ros.org )

dwb_msgs : Message/Service definitions specifically for the dwb_core ( https://wiki.ros.org )

dwb_plugins : Standard implementations of the GoalChecker ( https://wiki.ros.org )

dynamixel_sdk : This package is wrapping version of ROBOTIS Dynamixel SDK for ROS 2. The RO[...] ( http://wiki.ros.org/dynamixel_sdk )

dynamixel_sdk_custom_interfaces : ROS2 custom interface examples using ROBOTIS DYNAMIXEL SDK ( http://wiki.ros.org/dynamixel_sdk )

dynamixel_sdk_examples : ROS2 examples using ROBOTIS DYNAMIXEL SDK ( http://wiki.ros.org/dynamixel_sdk )

dynamixel_workbench : Dynamixel-Workbench is dynamixel solution for ROS. ( http://wiki.ros.org/dynamixel_workbench )

dynamixel_workbench_msgs : This package includes ROS messages and services for dynamixel_workbench pac[...] ( http://wiki.ros.org/dynamixel_workbench_msgs )

dynamixel_workbench_toolbox : This package is composed of \'dynamixel_item\', \'dynamixel_tool\', \'dynam[...] ( http://wiki.ros.org/dynamixel_workbench_toolbox )

ecl_build : Collection of cmake/make build tools primarily for ecl development itself, [...] ( http://wiki.ros.org/ecl_build )

ecl_command_line : Embeds the TCLAP library inside the ecl. This is a very convenient ( http://wiki.ros.org/ecl_command_line )

ecl_concepts : Introduces a compile time concept checking mechanism that can be used ( http://wiki.ros.org/ecl_concepts )

ecl_config : These tools inspect and describe your system with macros, types ( http://wiki.ros.org/ecl_config )

ecl_console : Color codes for ansii consoles. ( http://wiki.ros.org/ecl_console )

ecl_containers : The containers included here are intended to extend the stl containers. ( http://wiki.ros.org/ecl_containers )

ecl_converters : Some fast/convenient type converters, mostly for char strings or strings. ( http://wiki.ros.org/ecl_converters )

ecl_converters_lite : These are a very simple version of some of the functions in ecl_converters\[...] ( http://wiki.ros.org/ecl_converters_lite )

ecl_core : A set of tools and interfaces extending the capabilities of c++ to ( http://www.ros.org/wiki/ecl_core )

ecl_core_apps : This includes a suite of programs demo\'ing various aspects of the ( http://wiki.ros.org/ecl_core_apps )

ecl_devices : Provides an extensible and standardised framework for input-output devices. ( http://wiki.ros.org/ecl_devices )

ecl_eigen : This provides an Eigen implementation for ecl\'s linear algebra. ( http://wiki.ros.org/ecl_eigen )

ecl_errors : This library provides lean and mean error mechanisms. ( http://wiki.ros.org/ecl_errors )

ecl_exceptions : Template based exceptions - these are simple and practical ( http://wiki.ros.org/ecl_exceptions )

ecl_filesystem : Cross platform filesystem utilities \(until c++11 makes its way in\). ( http://wiki.ros.org/ecl_filesystem )

ecl_formatters : The formatters here simply format various input types to a specified ( http://wiki.ros.org/ecl_formatters )

ecl_geometry : Any tools relating to mathematical geometry. ( http://wiki.ros.org/ecl_geometry )

ecl_io : Most implementations \(windows, posix, ...\) have slightly different api fo[...] ( http://wiki.ros.org/ecl_io )

ecl_ipc : Interprocess mechanisms vary greatly across platforms - sysv, posix, win32,[...] ( http://wiki.ros.org/ecl_ipc )

ecl_license : Maintains the ecl licenses and also provides an install ( http://wiki.ros.org/ecl_license )

ecl_linear_algebra : Ecl frontend to a linear matrix package \(currently eigen\). ( http://wiki.ros.org/ecl_linear_algebra )

ecl_lite : Libraries and utilities for embedded and low-level linux development. ( http://www.ros.org/wiki/ecl_lite )

ecl_manipulators : Deploys various manipulation algorithms, currently just ( http://wiki.ros.org/ecl_manipulators )

ecl_math : This package provides simple support to cmath, filling in holes ( http://wiki.ros.org/ecl_math )

ecl_mobile_robot : Contains transforms \(e.g. differential drive inverse kinematics\) ( http://wiki.ros.org/ecl_mobile_robot )

ecl_mpl : Metaprogramming tools move alot of runtime calculations to be shifted to ( http://wiki.ros.org/ecl_mpl )

ecl_sigslots : Provides a signal/slot mechanism \(in the same vein as qt sigslots, ( http://ros.org/wiki/ecl_sigslots )

ecl_sigslots_lite : This avoids use of dynamic storage \(malloc/new\) and thread safety \(mutex[...] ( http://wiki.ros.org/ecl_sigslots_lite )

ecl_statistics : Common statistical structures and algorithms for control systems. ( http://wiki.ros.org/ecl_statistics )

ecl_streams : These are lightweight text streaming classes that connect to standardised ( http://wiki.ros.org/ecl_streams )

ecl_threads : This package provides the c++ extensions for a variety of threaded ( http://wiki.ros.org/ecl_threads )

ecl_time : Timing utilities are very dependent on the system api provided for their us[...] ( http://wiki.ros.org/ecl_time )

ecl_time_lite : Provides a portable set of time functions that are especially useful for ( http://wiki.ros.org/ecl_time_lite )

ecl_tools : Tools and utilities for ecl development. ( http://www.ros.org/wiki/ecl_tools )

ecl_type_traits : Extends c++ type traits and implements a few more to boot. ( http://wiki.ros.org/ecl_type_traits )

ecl_utilities : Includes various supporting tools and utilities for c++ programming. ( http://wiki.ros.org/ecl_utilities )

effort_controllers : Generic controller for forwarding commands. ( https://wiki.ros.org )

eigen3_cmake_module : Exports a custom CMake module to find Eigen3. ( https://wiki.ros.org )

eigen_stl_containers : This package provides a set of typedef\'s that allow ( http://eigen.tuxfamily.org/dox/TopicUnalignedArrayAssert.html )

example_interfaces : Contains message and service definitions used by the examples. ( https://wiki.ros.org )

examples_rclcpp_cbg_executor : Example for multiple Executor instances in one process, using the callback-[...] ( https://wiki.ros.org )

examples_rclcpp_minimal_action_client : Minimal action client examples ( https://wiki.ros.org )

examples_rclcpp_minimal_action_server : Minimal action server examples ( https://wiki.ros.org )

examples_rclcpp_minimal_client : Examples of minimal service clients ( https://wiki.ros.org )

examples_rclcpp_minimal_composition : Minimalist examples of composing nodes in the same ( https://wiki.ros.org )

examples_rclcpp_minimal_publisher : Examples of minimal publisher nodes ( https://wiki.ros.org )

examples_rclcpp_minimal_service : A minimal service server which adds two numbers ( https://wiki.ros.org )

examples_rclcpp_minimal_subscriber : Examples of minimal subscribers ( https://wiki.ros.org )

examples_rclcpp_minimal_timer : Examples of minimal nodes which have timers ( https://wiki.ros.org )

examples_rclcpp_multithreaded_executor : Package containing example of how to implement a multithreaded executor ( https://wiki.ros.org )

examples_rclpy_executors : Examples of creating and using exectors to run multiple nodes in the same p[...] ( https://wiki.ros.org )

examples_rclpy_guard_conditions : Examples of using guard conditions. ( https://wiki.ros.org )

examples_rclpy_minimal_action_client : Examples of minimal action clients using rclpy. ( https://wiki.ros.org )

examples_rclpy_minimal_action_server : Examples of minimal action servers using rclpy. ( https://wiki.ros.org )

examples_rclpy_minimal_client : Examples of minimal service clients using rclpy. ( https://wiki.ros.org )

examples_rclpy_minimal_publisher : Examples of minimal publishers using rclpy. ( https://wiki.ros.org )

examples_rclpy_minimal_service : Examples of minimal service servers using rclpy. ( https://wiki.ros.org )

examples_rclpy_minimal_subscriber : Examples of minimal subscribers using rclpy. ( https://wiki.ros.org )

examples_rclpy_pointcloud_publisher : Example on how to publish a Pointcloud2 message ( https://wiki.ros.org )

examples_tf2_py : Has examples of using the tf2 Python API. ( https://wiki.ros.org )

fastcdr : CDR serialization implementation. ( https://wiki.ros.org )

fastrtps : Implementation of RTPS standard. ( https://wiki.ros.org )

fastrtps_cmake_module : Provide CMake module to find eProsima FastRTPS. ( https://wiki.ros.org )

filters : This library provides a standardized interface for processing data as a seq[...] ( https://wiki.ros.org/filters )

fluent_rviz : A library which makes Rviz fluent. Powered by C++17 ( https://wiki.ros.org )

fmi_adapter : Wraps FMUs for co-simulation ( http://wiki.ros.org/fmi_adapter )

fmi_adapter_examples : Provides small examples for use of the fmi_adapter package ( http://wiki.ros.org/fmi_adapter )

fmilibrary_vendor : Wrapper \(aka vendor package\) around the FMILibrary by Modelon AB \(JModel[...] ( https://jmodelica.org/ )

foonathan_memory_vendor : Foonathan/memory vendor package for Fast-RTPS. ( https://wiki.ros.org )

force_torque_sensor_broadcaster : Controller to publish state of force-torque sensors. ( https://wiki.ros.org )

forward_command_controller : Generic controller for forwarding commands. ( https://wiki.ros.org )

four_wheel_steering_msgs : ROS messages for robots using FourWheelSteering. ( http://ros.org/wiki/four_wheel_steering_msgs )

gazebo_dev : Provides a cmake config for the default version of Gazebo for the ROS distr[...] ( http://gazebosim.org/tutorials?cat=connect_ros )

gazebo_msgs : Message and service data structures for interacting with Gazebo from ROS2. ( http://gazebosim.org/tutorials?cat=connect_ros )

gazebo_plugins : Robot-independent Gazebo plugins for sensors, motors and dynamic reconfigur[...] ( http://gazebosim.org/tutorials?cat=connect_ros )

gazebo_ros : Utilities to interface with a href=\"http://gazebosim.org\"Gazebo/a thr[...] ( http://gazebosim.org/tutorials?cat=connect_ros )

gazebo_ros2_control : gazebo_ros2_control ( http://ros.org/wiki/gazebo_ros_control )

gazebo_ros2_control_demos : gazebo_ros2_control_demos ( http://ros.org/wiki/gazebo_ros_control )

gazebo_ros_pkgs : Interface for using ROS with the a href=\"http://gazebosim.org/\"Gazebo/[...] ( http://gazebosim.org/tutorials?cat=connect_ros )

gc_spl_2022 : GameController-Robot communication in RoboCup SPL at RoboCup2022 ( https://wiki.ros.org )

geodesy : Python and C++ interfaces for manipulating geodetic coordinates. ( http://wiki.ros.org/geodesy )

geographic_info : Geographic information metapackage. ( http://wiki.ros.org/geographic_info )

geographic_msgs : ROS messages for Geographic Information Systems. ( http://wiki.ros.org/geographic_msgs )

geometric_shapes : This package contains generic definitions of geometric shapes and bodies. ( http://ros.org/wiki/geometric_shapes )

geometry2 : A metapackage to bring in the default packages second generation Transform [...] ( http://www.ros.org/wiki/geometry2 )

geometry_msgs : A package containing some geometry related message definitions. ( https://wiki.ros.org )

geometry_tutorials : Metapackage of geometry tutorials ROS. ( http://www.ros.org/wiki/geometry_tutorials )

gmock_vendor : The package provides GoogleMock. ( https://wiki.ros.org )

gps_msgs : GPS messages for use in GPS drivers ( http://ros.org/wiki/gps_common )

gps_tools : GPS routines for use in GPS drivers ( http://ros.org/wiki/gps_common )

gps_umd : gps_umd metapackage ( http://ros.org/wiki/gps_umd )

gpsd_client : connects to a GPSd server and broadcasts GPS fixes ( http://ros.org/wiki/gpsd_client )

graph_msgs : ROS messages for publishing graphs of different data types ( https://github.com/davetcoleman/graph_msgs )

grbl_msgs : ROS2 Messages package for GRBL devices ( https://wiki.ros.org )

gripper_controllers : The gripper_controllers package ( https://wiki.ros.org )

gscam : A ROS camera driver that uses gstreamer to connect to ( https://wiki.ros.org )

gtest_vendor : The package provides GoogleTest. ( https://wiki.ros.org )

hardware_interface : ROS2 ros_control hardware interface ( https://wiki.ros.org )

hash_library_vendor : ROS2 vendor package for stbrumme/hash-library ( https://github.com/stbrumme/hash-library )

hls_lfcd_lds_driver : ROS package for LDS\(HLS-LFCD2\). ( http://wiki.ros.org/hls_lfcd_lds_driver )

iceoryx_binding_c : Eclipse iceoryx inter-process-communication \(IPC\) middleware C-Language B[...] ( https://iceoryx.io )

iceoryx_posh : Eclipse iceoryx inter-process-communication \(IPC\) middleware Posix Shared[...] ( https://iceoryx.io )

iceoryx_utils : Eclipse iceoryx inter-process-communication \(IPC\) middleware basic buildi[...] ( https://iceoryx.io )

ifm3d_core : Library and Utilities for working with ifm pmd-based 3D ToF Cameras ( https://github.com/ifm/ifm3d )

ign_ros2_control_demos : ign_ros2_control_demos ( https://github.com/ignitionrobotics/ign_ros2_control/blob/main/README.md )

image_common : Common code for working with images in ROS. ( http://www.ros.org/wiki/image_common )

image_geometry : \`image_geometry\` contains C++ and Python libraries for interpreting image[...] ( http://www.ros.org/wiki/image_geometry )

image_pipeline : image_pipeline fills the gap between getting raw images from a camera drive[...] ( https://index.ros.org/p/image_pipeline/github-ros-perception-image_pipeline/ )

image_proc : Single image rectification and color processing. ( https://index.ros.org/p/image_proc/github-ros-perception-image_pipeline/ )

image_publisher : Contains a node publish an image stream from single image file ( https://index.ros.org/p/image_publisher/github-ros-perception-image_pipeline/ )

image_rotate : p ( https://index.ros.org/p/image_rotate/github-ros-perception-image_pipeline/ )

image_tools : Tools to capture and play back images to and from DDS subscriptions and pub[...] ( https://wiki.ros.org )

image_transport : image_transport should always be used to subscribe to and publish images. I[...] ( http://ros.org/wiki/image_transport )

image_transport_plugins : A set of plugins for publishing and subscribing to sensor_msgs/Image topics[...] ( http://www.ros.org/wiki/image_transport_plugins )

image_view : A simple viewer for ROS image topics. Includes a specialized viewer ( https://index.ros.org/p/image_view/github-ros-perception-image_pipeline/ )

imu_complementary_filter : Filter which fuses angular velocities, accelerations, and \(optionally\) ma[...] ( http://www.mdpi.com/1424-8220/15/8/19302 )

imu_filter_madgwick : Filter which fuses angular velocities, accelerations, and \(optionally\) ma[...] ( http://ros.org/wiki/imu_filter_madgwick )

imu_sensor_broadcaster : Controller to publish readings of IMU sensors. ( https://wiki.ros.org )

imu_tools : Various tools for IMU devices ( http://ros.org/wiki/imu_tools )

interactive_markers : 3D interactive marker communication library for RViz and similar tools. ( http://ros.org/wiki/interactive_markers )

intra_process_demo : Demonstrations of intra process communication. ( https://wiki.ros.org )

io_context : A library to write Synchronous and Asynchronous networking applications ( https://github.com/ros-drivers/transport_drivers )

irobot_create_common_bringup : Provides common launch and configuration scripts for a simulated iRobot\(R\[...] ( https://wiki.ros.org )

irobot_create_control : Provides the diff-drive controller for the iRobot\(R\) Create\(R\) 3 Educat[...] ( https://wiki.ros.org )

irobot_create_description : Provides the model description for the iRobot\(R\) Create\(R\) 3 Educationa[...] ( https://wiki.ros.org )

irobot_create_gazebo_bringup : Provides launch and configuration scripts for a Gazebo simulated iRobot\(R\[...] ( https://wiki.ros.org )

irobot_create_gazebo_plugins : Provides the Gazebo plugins for the iRobot\(R\) Create\(R\) 3 Educational R[...] ( https://wiki.ros.org )

irobot_create_gazebo_sim : Metapackage for the iRobot\(R\) Create\(R\) 3 robot Gazebo simulatora href[...] ( https://wiki.ros.org )

irobot_create_ignition_bringup : Provides launch and configuration scripts for a Ignition simulated iRobot\([...] ( https://wiki.ros.org )

irobot_create_ignition_sim : Metapackage for the iRobot\(R\) Create\(R\) 3 robot Ignition simulator ( https://wiki.ros.org )

irobot_create_ignition_toolbox : Nodes and tools for simulating in Ignition iRobot\(R\) Create\(R\) 3 Educat[...] ( https://wiki.ros.org )

irobot_create_msgs : Package containing action, message, and service definitions used by the iRo[...] ( https://wiki.ros.org )

irobot_create_nodes : ROS 2 Nodes for the simulated iRobot\(R\) Create\(R\) 3 Educational Robot. ( https://wiki.ros.org )

joint_state_broadcaster : Broadcaster to publish joint state ( https://wiki.ros.org )

joint_state_publisher : This package contains a tool for setting and publishing joint state values [...] ( http://www.ros.org/wiki/joint_state_publisher )

joint_state_publisher_gui : This package contains a GUI tool for setting and publishing joint state val[...] ( http://www.ros.org/wiki/joint_state_publisher )

joint_trajectory_controller : Controller for executing joint-space trajectories on a group of joints ( https://wiki.ros.org )

joy : The joy package contains joy_node, a node that interfaces a ( https://github.com/ros2/joystick_drivers )

joy_linux : ROS2 driver for a generic Linux joystick. ( https://github.com/ros/joystick_drivers )

joy_teleop : A \(to be\) generic joystick interface to control a robot ( https://wiki.ros.org )

kdl_parser : The Kinematics and Dynamics Library \(KDL\) defines a tree structure ( https://github.com/ros2/kdl_parser )

key_teleop : A text-based interface to send a robot movement commands. ( https://wiki.ros.org )

kobuki_core : Pure C++ driver library for Kobuki. ( https://kobuki.readthedocs.io/en/release-1.0.x/ )

kobuki_ros_interfaces : p ( https://index.ros.org/k/kobuki_ros_interfaces/github-kobuki-base-kobuki_ros_interfaces )

kobuki_velocity_smoother : Bound incoming velocity messages according to robot velocity and accelerati[...] ( https://index.ros.org/p/kobuki_velocity_smoother/github-kobuki-base-velocity_smoother/ )

laser_filters : Assorted filters designed to operate on 2D planar laser scanners, ( http://ros.org/wiki/laser_filters )

laser_geometry : This package contains a class for converting from a 2D laser scan as define[...] ( http://ros.org/wiki/laser_geometry )

laser_proc : laser_proc ( http://ros.org/wiki/laser_proc )

launch : The ROS launch tool. ( https://wiki.ros.org )

launch_param_builder : Python library for loading parameters in launch files ( https://wiki.ros.org )

launch_ros : ROS specific extensions to the launch tool. ( https://wiki.ros.org )

launch_system_modes : System modes specific extensions to the launch tool, i.e. launch actions, e[...] ( https://wiki.ros.org )

launch_testing : A package to create tests which involve launch files and multiple processes. ( https://wiki.ros.org )

launch_testing_ament_cmake : A package providing cmake functions for running launch tests from the build. ( https://wiki.ros.org )

launch_testing_ros : A package providing utilities for writing ROS2 enabled launch tests. ( https://wiki.ros.org )

launch_xml : XML frontend for the launch package. ( https://wiki.ros.org )

launch_yaml : YAML frontend for the launch package. ( https://wiki.ros.org )

libcurl_vendor : Wrapper around libcurl, it provides a fixed CMake module and an ExternalPro[...] ( https://github.com/curl/curl )

libg2o : The libg2o library from http://openslam.org/g2o.html ( https://github.com/RainerKuemmerle/g2o )

libmavconn : MAVLink communication library. ( http://wiki.ros.org/mavros )

libphidget22 : This package wraps the libphidget22 to use it as a ROS dependency ( http://ros.org/wiki/libphidget22 )

librealsense2 : Library for controlling and capturing data from the Intel\(R\) RealSense\(T[...] ( https://github.com/IntelRealSense/librealsense/ )

libstatistics_collector : Lightweight aggregation utilities to collect statistics and measure message[...] ( https://wiki.ros.org )

libyaml_vendor : Vendored version of libyaml. ( https://github.com/yaml/libyaml )

lifecycle : Package containing demos for lifecycle implementation ( https://wiki.ros.org )

lifecycle_msgs : A package containing some lifecycle related message and service definitions. ( https://wiki.ros.org )

log_view : The log_view package provides a ncurses based terminal GUI for ( https://wiki.ros.org )

logging_demo : Examples for using and configuring loggers. ( https://wiki.ros.org )

lua_vendor : TODO: Package description ( https://wiki.ros.org )

magic_enum : Static reflection for enums \(to string, from string, iteration\) for moder[...] ( https://wiki.ros.org )

map_msgs : This package defines messages commonly used in mapping packages. ( http://ros.org/wiki/map_msgs )

mapviz : mapviz ( https://github.com/swri-robotics/mapviz )

mapviz_interfaces : ROS interfaces used by Mapviz ( https://github.com/swri-robotics/mapviz )

mapviz_plugins : Common plugins for the Mapviz visualization tool ( https://github.com/swri-robotics/mapviz )

marti_can_msgs : marti_can_msgs ( https://github.com/swri-robotics/marti_messages )

marti_common_msgs : marti_common_msgs ( https://github.com/swri-robotics/marti_messages )

marti_dbw_msgs : marti_dbw_msgs ( https://github.com/swri-robotics/marti_messages )

marti_introspection_msgs : marti_introspection_msgs ( https://github.com/swri-robotics/marti_messages )

marti_nav_msgs : marti_nav_msgs ( https://github.com/swri-robotics/marti_messages )

marti_perception_msgs : marti_perception_msgs ( https://github.com/swri-robotics/marti_messages )

marti_sensor_msgs : marti_sensor_msgs ( https://github.com/swri-robotics/marti_messages )

marti_status_msgs : marti_status_msgs ( https://github.com/swri-robotics/marti_messages )

marti_visualization_msgs : marti_visualization_msgs ( https://github.com/swri-robotics/marti_messages )

massrobotics_amr_sender : MassRobotics AMR Interop Sender ( https://wiki.ros.org )

mavros_msgs : mavros_msgs defines messages for a href=\"http://wiki.ros.org/mavros\"MAV[...] ( http://wiki.ros.org/mavros_msgs )

mcap_vendor : mcap vendor package ( https://wiki.ros.org )

menge_vendor : Menge is a powerful, cross-platform, modular framework for crowd simulation[...] ( https://wiki.ros.org )

message_filters : A set of ROS2 message filters which take in messages and may output those m[...] ( https://github.com/intel/ros2_message_filters )

micro_ros_diagnostic_bridge : Translates micro-ROS diagnostic messages to vanilla ROS 2 diagnostic messages. ( https://wiki.ros.org )

micro_ros_diagnostic_msgs : Ccontains messages and service definitions for micro-ROS diagnostics. ( https://wiki.ros.org )

micro_ros_msgs : Definitions for the ROS 2 msgs entities information used by micro-ROS to le[...] ( https://wiki.ros.org )

microstrain_inertial_driver : The ros_mscl package provides a driver for the LORD/Microstrain inertial pr[...] ( https://github.com/LORD-MicroStrain/microstrain_inertial )

microstrain_inertial_examples : Example listener for Parker LORD Sensing inertial device driver ros_mscl \([...] ( https://github.com/LORD-MicroStrain/microstrain_inertial )

microstrain_inertial_msgs : A package that contains ROS message corresponding to microstrain message types. ( https://github.com/LORD-MicroStrain/microstrain_inertial )

microstrain_inertial_rqt : The microstrain_inertial_rqt package provides several RQT widgets to view t[...] ( https://github.com/LORD-MicroStrain/microstrain_inertial )

mimick_vendor : Wrapper around mimick, it provides an ExternalProject build of mimick. ( https://github.com/Snaipe/Mimick )

moveit : Meta package that contains all essential packages of MoveIt 2 ( http://moveit.ros.org )

moveit_chomp_optimizer_adapter : MoveIt planning request adapter utilizing chomp for solution optimization ( https://wiki.ros.org )

moveit_common : Common support functionality used throughout MoveIt ( http://moveit.ros.org )

moveit_configs_utils : Python library for loading moveit config parameters in launch files ( https://wiki.ros.org )

moveit_core : Core libraries used by MoveIt ( http://moveit.ros.org )

moveit_hybrid_planning : Hybrid planning components of MoveIt 2 ( http://moveit.ros.org )

moveit_kinematics : Package for all inverse kinematics solvers in MoveIt ( http://moveit.ros.org )

moveit_msgs : Messages, services and actions used by MoveIt ( http://moveit.ros.org )

moveit_planners : Meta package that installs all available planners for MoveIt ( http://moveit.ros.org )

moveit_planners_chomp : The interface for using CHOMP within MoveIt ( https://wiki.ros.org )

moveit_plugins : Metapackage for MoveIt plugins. ( http://moveit.ros.org )

moveit_resources : Resources used for MoveIt testing ( http://moveit.ros.org )

moveit_resources_fanuc_description : Fanuc Resources used for MoveIt testing ( http://moveit.ros.org )

moveit_resources_fanuc_moveit_config : p ( http://moveit.ros.org )

moveit_resources_panda_description : panda Resources used for MoveIt testing ( http://moveit.ros.org )

moveit_resources_panda_moveit_config : p ( http://moveit.ros.org/ )

moveit_resources_pr2_description : PR2 Resources used for MoveIt! testing ( http://moveit.ros.org )

moveit_resources_prbt_ikfast_manipulator_plugin : The prbt_ikfast_manipulator_plugin package ( http://moveit.ros.org )

moveit_resources_prbt_moveit_config : p ( http://moveit.ros.org )

moveit_resources_prbt_pg70_support : PRBT support for Schunk pg70 gripper. ( http://moveit.ros.org )

moveit_resources_prbt_support : Mechanical, kinematic and visual description ( http://moveit.ros.org )

moveit_ros : Components of MoveIt that use ROS ( http://moveit.ros.org )

moveit_ros_benchmarks : Enhanced tools for benchmarks in MoveIt ( http://moveit.ros.org )

moveit_ros_control_interface : ros_control controller manager interface for MoveIt ( https://wiki.ros.org )

moveit_ros_move_group : The move_group node for MoveIt ( http://moveit.ros.org )

moveit_ros_occupancy_map_monitor : Components of MoveIt connecting to occupancy map ( http://moveit.ros.org )

moveit_ros_planning : Planning components of MoveIt that use ROS ( http://moveit.ros.org )

moveit_ros_planning_interface : Components of MoveIt that offer simpler interfaces to planning and execution ( http://moveit.ros.org )

moveit_ros_robot_interaction : Components of MoveIt that offer interaction via interactive markers ( http://moveit.ros.org )

moveit_ros_visualization : Components of MoveIt that offer visualization ( http://moveit.ros.org )

moveit_ros_warehouse : Components of MoveIt connecting to MongoDB ( http://moveit.ros.org )

moveit_runtime : moveit_runtime meta package contains MoveIt packages that are essential for[...] ( http://moveit.ros.org )

moveit_servo : Provides real-time manipulator Cartesian and joint servoing. ( https://ros-planning.github.io/moveit_tutorials )

moveit_setup_assistant : Generates a configuration package that makes it easy to use MoveIt ( http://moveit.ros.org )

moveit_simple_controller_manager : A generic, simple controller manager plugin for MoveIt. ( http://moveit.ros.org )

moveit_visual_tools : Helper functions for displaying and debugging MoveIt data in Rviz via publi[...] ( https://github.com/ros-planning/moveit_visual_tools )

mrpt2 : ( )

multires_image : multires_image ( https://github.com/swri-robotics/mapviz )

nao_button_sim : Allows simulating button presses through command line interface ( https://wiki.ros.org )

nao_command_msgs : Package defining command msgs to be sent to NAO robot. ( https://wiki.ros.org )

nao_lola : Packages that allow communicating with the NAO’s Lola middle-ware. ( https://wiki.ros.org )

nao_sensor_msgs : Package defining sensor msgs to be received from NAO robot. ( https://wiki.ros.org )

naoqi_bridge_msgs : The naoqi_bridge_msgs package provides custom messages for running Aldebara[...] ( https://wiki.ros.org )

naoqi_driver : Driver module between Aldebaran\'s NAOqiOS and ROS2. It publishes all senso[...] ( https://wiki.ros.org )

naoqi_libqi : Aldebaran\'s libqi: a core library for NAOqiOS development ( http://doc.aldebaran.com/libqi )

naoqi_libqicore : Aldebaran\'s libqicore: a layer on top of libqi ( https://github.com/aldebaran/libqicore )

nav2_amcl : p ( https://wiki.ros.org )

nav2_behavior_tree : TODO ( https://wiki.ros.org )

nav2_bringup : Bringup scripts and configurations for the Nav2 stack ( https://wiki.ros.org )

nav2_bt_navigator : TODO ( https://wiki.ros.org )

nav2_common : Common support functionality used throughout the navigation 2 stack ( https://wiki.ros.org )

nav2_controller : Controller action interface ( https://wiki.ros.org )

nav2_core : A set of headers for plugins core to the Nav2 stack ( https://wiki.ros.org )

nav2_costmap_2d : This package provides an implementation of a 2D costmap that takes in senso[...] ( https://wiki.ros.org )

nav2_dwb_controller : ROS2 controller \(DWB\) metapackage ( https://wiki.ros.org )

nav2_gazebo_spawner : Package for spawning a robot model into Gazebo for Nav2 ( https://wiki.ros.org )

nav2_lifecycle_manager : A controller/manager for the lifecycle nodes of the Navigation 2 system ( https://wiki.ros.org )

nav2_map_server : Refactored map server for ROS2 Navigation ( https://wiki.ros.org )

nav2_msgs : Messages and service files for the Nav2 stack ( https://wiki.ros.org )

nav2_navfn_planner : TODO ( https://wiki.ros.org )

nav2_planner : TODO ( https://wiki.ros.org )

nav2_recoveries : TODO ( https://wiki.ros.org )

nav2_regulated_pure_pursuit_controller : Regulated Pure Pursuit Controller ( https://wiki.ros.org )

nav2_rotation_shim_controller : Rotation Shim Controller ( https://wiki.ros.org )

nav2_rviz_plugins : Navigation 2 plugins for rviz ( https://wiki.ros.org )

nav2_simple_commander : An importable library for writing mobile robot applications in python3 ( https://wiki.ros.org )

nav2_smac_planner : Smac global planning plugin: A*, Hybrid-A*, State Lattice ( https://wiki.ros.org )

nav2_system_tests : TODO ( https://wiki.ros.org )

nav2_theta_star_planner : Theta* Global Planning Plugin ( https://wiki.ros.org )

nav2_util : TODO ( https://wiki.ros.org )

nav2_voxel_grid : voxel_grid provides an implementation of an efficient 3D voxel grid. The oc[...] ( https://wiki.ros.org )

nav2_waypoint_follower : A waypoint follower navigation server ( https://wiki.ros.org )

nav_2d_msgs : Basic message types for two dimensional navigation, extending from geometry[...] ( https://wiki.ros.org )

nav_2d_utils : A handful of useful utility functions for nav_2d packages. ( https://wiki.ros.org )

nav_msgs : A package containing some navigation related message and service definitions. ( https://wiki.ros.org )

navigation2 : ROS2 Navigation Stack ( https://wiki.ros.org )

neo_simulation2 : ROS-2 Simulation packages for neobotix robots ( https://wiki.ros.org )

nerian_stereo : Driver node for ROS 2 for Scarlet, SceneScan and SP1 stereo vision sensors [...] ( http://wiki.ros.org/nerian_stereo )

nmea_hardware_interface : ros2 hardware interface for nmea_gps ( https://wiki.ros.org )

nmea_msgs : The nmea_msgs package contains messages related to data in the NMEA format. ( http://ros.org/wiki/nmea_msgs )

nodl_python : Implementation of the NoDL API in Python. ( https://wiki.ros.org )

nodl_to_policy : Package to generate a ROS 2 Access Control Policy from the NoDL description[...] ( https://wiki.ros.org )

nonpersistent_voxel_layer : include ( http://wiki.ros.org/non-persisent-voxel-layer )

novatel_gps_driver : Driver for NovAtel receivers ( https://github.com/swri-robotics/novatel_gps_driver )

novatel_gps_msgs : Messages for proprietary \(non-NMEA\) sentences from Novatel GPS receivers. ( https://github.com/swri-robotics/novatel_gps_driver )

ntpd_driver : ntpd_driver sends TimeReference message time to ntpd server ( http://wiki.ros.org/ntpd_driver )

ntrip_client : NTRIP client that will publish RTCM corrections to a ROS topic, and optiona[...] ( https://github.com/LORD-MicroStrain/ntrip_client )

object_recognition_msgs : Object_recognition_msgs contains the ROS message and the actionlib definiti[...] ( http://www.ros.org/wiki/object_recognition )

octomap_mapping : Mapping tools to be used with the a href=\"https://octomap.github.io/\"Oc[...] ( http://ros.org/wiki/octomap_mapping )

octomap_msgs : This package provides messages and serializations / conversion for the a h[...] ( http://ros.org/wiki/octomap_msgs )

octomap_ros : octomap_ros provides conversion functions between ROS and OctoMap\'s native[...] ( http://ros.org/wiki/octomap_ros )

octomap_rviz_plugins : A set of plugins for displaying occupancy information decoded from binary o[...] ( http://ros.org/wiki/octomap_rviz_plugins )

octomap_server : octomap_server loads a 3D map \(as Octree-based OctoMap\) and distributes i[...] ( http://www.ros.org/wiki/octomap_server )

ompl : OMPL is a free sampling-based motion planning library. ( https://ompl.kavrakilab.org )

openvslam : OpenVSLAM: A Versatile Visual SLAM Framework ( https://openvslam-community.readthedocs.io/ )

orocos_kdl : This package contains a recent version of the Kinematics and Dynamics ( http://wiki.ros.org/orocos_kdl )

osqp_vendor : ( )

osrf_pycommon : Commonly needed Python modules, used by Python software developed at OSRF. ( https://wiki.ros.org )

osrf_testing_tools_cpp : Testing tools for C++, and is used in various OSRF projects. ( https://wiki.ros.org )

ouster_msgs : ROS2 messages for ouster lidar driver ( https://wiki.ros.org )

ouxt_common : common settings for OUXT Polaris ROS2 packages ( https://wiki.ros.org )

ouxt_lint_common : common linter settings for OUXT Polaris ROS2 packages ( https://wiki.ros.org )

pal_statistics : The pal_statistics package ( https://wiki.ros.org )

pal_statistics_msgs : Statistics msgs package ( https://wiki.ros.org )

pcl_conversions : Provides conversions from PCL data types and ROS message types ( http://wiki.ros.org/pcl_conversions )

pcl_msgs : Package containing PCL \(Point Cloud Library\)-related ROS messages. ( http://wiki.ros.org/pcl_msgs )

pcl_ros : PCL \(Point Cloud Library\) ROS interface stack. PCL-ROS is the preferred ( http://ros.org/wiki/perception_pcl )

pendulum_control : Demonstrates ROS 2\'s realtime capabilities with a simulated inverted pendulum. ( https://wiki.ros.org )

pendulum_msgs : Custom messages for real-time pendulum control. ( https://wiki.ros.org )

pepper_meshes : Meshes for the Pepper robot, for ROS2 ( http://github.com/ros-naoqi/pepper_meshes2/ )

perception_pcl : PCL \(Point Cloud Library\) ROS interface stack. PCL-ROS is the preferred ( http://ros.org/wiki/perception_pcl )

performance_test : Tool to test performance of ROS2 and DDS data layers and communication. ( https://wiki.ros.org )

performance_test_fixture : Test fixture and CMake macro for using osrf_testing_tools_cpp with Google B[...] ( https://wiki.ros.org )

phidgets_accelerometer : Driver for the Phidgets Accelerometer devices ( https://wiki.ros.org )

phidgets_analog_inputs : Driver for the Phidgets Analog Input devices ( https://wiki.ros.org )

phidgets_api : A C++ Wrapper for the Phidgets C API ( http://ros.org/wiki/phidgets_api )

phidgets_digital_inputs : Driver for the Phidgets Digital Input devices ( https://wiki.ros.org )

phidgets_digital_outputs : Driver for the Phidgets Digital Output devices ( https://wiki.ros.org )

phidgets_drivers : API and ROS drivers for Phidgets devices ( http://ros.org/wiki/phidgets_drivers )

phidgets_gyroscope : Driver for the Phidgets Gyroscope devices ( https://wiki.ros.org )

phidgets_high_speed_encoder : Driver for the Phidgets high speed encoder devices ( https://wiki.ros.org )

phidgets_ik : Driver for the Phidgets InterfaceKit devices ( https://wiki.ros.org )

phidgets_magnetometer : Driver for the Phidgets Magnetometer devices ( https://wiki.ros.org )

phidgets_motors : Driver for the Phidgets Motor devices ( https://wiki.ros.org )

phidgets_msgs : Custom ROS messages for Phidgets drivers ( https://wiki.ros.org )

phidgets_spatial : Driver for the Phidgets Spatial 3/3/3 devices ( http://ros.org/wiki/phidgets_spatial )

phidgets_temperature : Driver for the Phidgets Temperature devices ( https://wiki.ros.org )

picknik_ament_copyright : Check PickNik-specific copyright headers. ( https://wiki.ros.org )

pilz_industrial_motion_planner : MoveIt plugin to generate industrial trajectories PTP, LIN, CIRC and sequen[...] ( http://moveit.ros.org )

pilz_industrial_motion_planner_testutils : Helper scripts and functionality to test industrial motion generation ( http://moveit.ros.org )

plansys2_bringup : Bringup scripts and configurations for the ROS2 Planning System ( https://wiki.ros.org )

plansys2_bt_actions : This package contains the Problem Expert module for the ROS2 Planning System ( https://wiki.ros.org )

plansys2_core : This package contains the PDDL-based core for the ROS2 Planning System ( https://wiki.ros.org )

plansys2_domain_expert : This package contains the Domain Expert module for the ROS2 Planning System ( https://wiki.ros.org )

plansys2_executor : This package contains the Executor module for the ROS2 Planning System ( https://wiki.ros.org )

plansys2_lifecycle_manager : A controller/manager for the lifecycle nodes of the ROS2 Planning System ( https://wiki.ros.org )

plansys2_msgs : Messages and service files for the ROS2 Planning System ( https://wiki.ros.org )

plansys2_pddl_parser : This package contains a library for parsing PDDL domains and problems. ( https://wiki.ros.org )

plansys2_planner : This package contains the PDDL-based Planner module for the ROS2 Planning S[...] ( https://wiki.ros.org )

plansys2_popf_plan_solver : This package contains the PDDL-based Planner module for the ROS2 Planning S[...] ( https://wiki.ros.org )

plansys2_problem_expert : This package contains the Problem Expert module for the ROS2 Planning System ( https://wiki.ros.org )

plansys2_terminal : A terminal tool for monitor and manage the ROS2 Planning System ( https://wiki.ros.org )

plansys2_tools : A set of tools for monitoring ROS2 Planning System ( https://wiki.ros.org )

plotjuggler_msgs : Special Messages for PlotJuggler ( https://wiki.ros.org )

pluginlib : The pluginlib package provides tools for writing and dynamically loading pl[...] ( http://www.ros.org/wiki/pluginlib )

point_cloud_msg_wrapper : ( https://wiki.ros.org )

pointcloud_to_laserscan : Converts a 3D Point Cloud into a 2D laser scan. This is useful for making d[...] ( http://ros.org/wiki/perception_pcl )

popf : The POPF package ( https://wiki.ros.org )

position_controllers : Generic controller for forwarding commands. ( https://wiki.ros.org )

py_trees_ros_interfaces : Interfaces used by py_trees_ros and py_trees_ros_tutorials. ( http://ros.org/wiki/py_trees_ros_interfaces )

pybind11_vendor : Wrapper around pybind11. ( https://github.com/pybind/pybind11 )

python_cmake_module : Provide CMake module with extra functionality for Python. ( https://wiki.ros.org )

python_qt_binding : This stack provides Python bindings for Qt. ( http://ros.org/wiki/python_qt_binding )

qpoases_vendor : Wrapper around qpOASES to make it available to the ROS ecosystem. ( https://projects.coin-or.org/qpOASES )

qt_dotgraph : qt_dotgraph provides helpers to work with dot graphs. ( http://ros.org/wiki/qt_dotgraph )

qt_gui : qt_gui provides the infrastructure for an integrated graphical user interfa[...] ( http://ros.org/wiki/qt_gui )

qt_gui_app : qt_gui_app provides the main to start an instance of the integrated graphic[...] ( http://ros.org/wiki/qt_gui_app )

qt_gui_core : Integration of the ROS package system and ROS-specific plugins for a Qt-bas[...] ( http://ros.org/wiki/qt_gui_core )

qt_gui_cpp : qt_gui_cpp provides the foundation for C++-bindings for qt_gui and creates [...] ( http://ros.org/wiki/qt_gui_cpp )

qt_gui_py_common : qt_gui_py_common provides common functionality for GUI plugins written in P[...] ( http://ros.org/wiki/qt_gui_py_common )

quality_of_service_demo_cpp : C++ Demo applications for Quality of Service features ( https://wiki.ros.org )

quality_of_service_demo_py : Python Demo applications for Quality of Service features ( https://wiki.ros.org )

quaternion_operation : The quaternion_operation package ( https://wiki.ros.org )

r2r_spl_7 : Robot-To-Robot communication in RoboCup SPL using SPLSM V7 ( https://wiki.ros.org )

radar_msgs : Standard ROS messages for radars ( https://wiki.ros.org )

random_numbers : This library contains wrappers for generating floating point values, integ[...] ( http://ros.org/wiki/random_numbers )

rc_common_msgs : Common msg and srv definitions used by Roboception\'s ROS2 packages ( https://wiki.ros.org )

rc_dynamics_api : The rc_dynamics_api provides an API for easy handling of the dynamic-state [...] ( http://rc-visard.com )

rc_genicam_api : GenICam/GigE Vision Convenience Layer. ( http://wiki.ros.org/rc_genicam_api )

rc_genicam_driver : Driver for rc_visard and rc_cube from Roboception GmbH ( https://wiki.ros.org )

rc_reason_msgs : Msg and srv definitions for rc_reason_clients ( https://wiki.ros.org )

rcdiscover : This package contains tools for the discovery of Roboception devices via Gi[...] ( https://github.com/roboception/rcdiscover )

rcgcd_spl_14 : RoboCup SPL GameController Data V14 ROS msg ( https://wiki.ros.org )

rcgcd_spl_14_conversion : Converts RoboCup SPL GameController Data V14 between ROS msg and UDP raw bytes ( https://wiki.ros.org )

rcgcrd_spl_4 : RoboCup SPL GameController Return Data V4 ROS msg ( https://wiki.ros.org )

rcgcrd_spl_4_conversion : Converts RoboCup SPL GameController Return Data V4 between ROS msg and UDP [...] ( https://wiki.ros.org )

rcl : The ROS client library common implementation. ( https://wiki.ros.org )

rcl_action : Package containing a C-based ROS action implementation ( https://wiki.ros.org )

rcl_interfaces : The ROS client library common interfaces. ( https://wiki.ros.org )

rcl_lifecycle : Package containing a C-based lifecycle implementation ( https://wiki.ros.org )

rcl_logging_interface : Interface that rcl_logging backends needs to implement. ( https://wiki.ros.org )

rcl_logging_log4cxx : C API providing common interface to a shared library wrapping 3rd party log[...] ( https://wiki.ros.org )

rcl_logging_noop : An rcl logger implementation that doesn\'t do anything with log messages. ( https://wiki.ros.org )

rcl_logging_spdlog : Implementation of rcl_logging API for an spdlog backend. ( https://wiki.ros.org )

rcl_yaml_param_parser : Parse a YAML parameter file and populate the C data structure. ( https://wiki.ros.org )

rclc : The ROS client library in C. ( https://wiki.ros.org )

rclc_examples : Example of using rclc_executor ( https://wiki.ros.org )

rclc_lifecycle : rclc lifecycle convenience methods. ( https://wiki.ros.org )

rclc_parameter : Parameter server implementation for micro-ROS nodes ( https://wiki.ros.org )

rclcpp : The ROS client library in C++. ( https://wiki.ros.org )

rclcpp_action : Adds action APIs for C++. ( https://wiki.ros.org )

rclcpp_cascade_lifecycle : Provides a mechanism to make trees of lifecycle nodes to propagate state ch[...] ( https://wiki.ros.org )

rclcpp_components : Package containing tools for dynamically loadable components ( https://wiki.ros.org )

rclcpp_lifecycle : Package containing a prototype for lifecycle implementation ( https://wiki.ros.org )

rclpy : Package containing the Python client. ( https://wiki.ros.org )

rclpy_message_converter : Converts between Python dictionaries and JSON to rclpy messages. ( http://ros.org/wiki/rospy_message_converter )

rclpy_message_converter_msgs : Messages for rclpy_message_converter ( http://ros.org/wiki/rospy_message_converter )

rcpputils : Package containing utility code for C++. ( https://wiki.ros.org )

rcss3d_agent : Launches a RoboCup 3D Simulation Agent, and converts data to and from ROS2 msgs ( https://wiki.ros.org )

rcss3d_agent_basic : Basic rcss3d agent node that uses rcss3d_agent_msgs ( https://wiki.ros.org )

rcss3d_agent_msgs : Custom messages for communicating with rcss3d_agent ( https://wiki.ros.org )

rcutils : Package containing various utility types and functions for C ( https://wiki.ros.org )

realsense2_camera : RealSense camera package allowing access to Intel T265 Tracking module and [...] ( http://www.ros.org/wiki/RealSense )

realsense2_camera_msgs : RealSense camera_msgs package containing realsense camera messages definitions ( http://www.ros.org/wiki/RealSense )

realsense2_description : RealSense description package for Intel 3D D400 cameras ( http://www.ros.org/wiki/RealSense )

realtime_tools : Contains a set of tools that can be used from a hard ( http://ros.org/wiki/realtime_tools )

resource_retriever : This package retrieves data from url-format files such as http://, ( http://ros.org/wiki/resource_retriever )

rmf_battery : Package for modelling battery life of robots ( https://wiki.ros.org )

rmf_building_map_msgs : Messages used to send building maps ( https://wiki.ros.org )

rmf_building_sim_common : Common utility functions for Gazebo and ignition building plugins ( https://wiki.ros.org )

rmf_building_sim_gazebo_plugins : Gazebo plugins so that buildings generated by rmf_building_map_tools can ( https://wiki.ros.org )

rmf_charger_msgs : This package contains messages regarding charging and discharging ( https://wiki.ros.org )

rmf_cmake_uncrustify : ament_cmake_uncrustify with support for parsing a config file. ( https://wiki.ros.org )

rmf_demos : Common launch files for RMF demos ( https://wiki.ros.org )

rmf_demos_assets : Models and other media used for RMF demos ( https://wiki.ros.org )

rmf_demos_dashboard_resources : Resource pack for RMF dashboard ( https://wiki.ros.org )

rmf_demos_gz : Launch files for RMF demos using the Gazebo simulator ( https://wiki.ros.org )

rmf_demos_ign : ( )

rmf_demos_maps : A package containing demo maps for rmf ( https://wiki.ros.org )

rmf_demos_tasks : A package containing scripts for demos ( https://wiki.ros.org )

rmf_dispenser_msgs : A package containing messages used to interface to dispenser workcells ( https://wiki.ros.org )

rmf_door_msgs : Messages used to interface to doors ( https://wiki.ros.org )

rmf_fleet_adapter : Fleet Adapter package for RMF fleets. ( https://wiki.ros.org )

rmf_fleet_adapter_python : Python bindings for the rmf_fleet_adapter ( https://wiki.ros.org )

rmf_fleet_msgs : A package containing messages used to interface to fleet managers ( https://wiki.ros.org )

rmf_ingestor_msgs : A package containing messages used to interface to ingestor workcells ( https://wiki.ros.org )

rmf_lift_msgs : Messages used to interface to lifts. ( https://wiki.ros.org )

rmf_robot_sim_common : Common utility functions for Gazebo and ignition RMF plugins ( https://wiki.ros.org )

rmf_robot_sim_gazebo_plugins : ROS 2 Gazebo plugins for TeleportIngestors, TeleportDispensers and Readonly[...] ( https://wiki.ros.org )

rmf_task : Package for managing tasks in the Robotics Middleware Framework ( https://wiki.ros.org )

rmf_task_msgs : A package containing messages used to specify tasks ( https://wiki.ros.org )

rmf_task_ros2 : A package managing the dispatching of tasks in RMF system. ( https://wiki.ros.org )

rmf_traffic : Package for managing traffic in the Robotics Middleware Framework ( https://wiki.ros.org )

rmf_traffic_editor : traffic editor ( https://wiki.ros.org )

rmf_traffic_editor_assets : Assets for use with traffic_editor. ( https://wiki.ros.org )

rmf_traffic_editor_test_maps : Some test maps for traffic_editor and rmf_building_map_tools. ( https://wiki.ros.org )

rmf_traffic_msgs : A package containing messages used by the RMF traffic management system. ( https://wiki.ros.org )

rmf_traffic_ros2 : A package containing messages used by the RMF traffic management system. ( https://wiki.ros.org )

rmf_utils : Simple C++ programming utilities used by Robotics Middleware Framework packages ( https://wiki.ros.org )

rmf_visualization : Package containing a single launch file to bringup various visualizations ( https://wiki.ros.org )

rmf_visualization_building_systems : A visualizer for doors and lifts ( https://wiki.ros.org )

rmf_visualization_fleet_states : Fleet state visualizer ( https://wiki.ros.org )

rmf_visualization_msgs : A package containing messages used for visualizations ( https://wiki.ros.org )

rmf_visualization_rviz2_plugins : A package containing RViz2 plugins for RMF ( https://wiki.ros.org )

rmf_visualization_schedule : A visualizer for trajectories in rmf schedule ( https://wiki.ros.org )

rmf_workcell_msgs : A package containing messages used by all workcells generically to interfac[...] ( https://wiki.ros.org )

rmw : Contains the ROS middleware API. ( https://wiki.ros.org )

rmw_connextdds : A ROS2 RMW implementation built with RTI Connext DDS Professional. ( https://wiki.ros.org )

rmw_connextdds_common : Common source for RMW implementations built with RTI Connext DDS Profession[...] ( https://wiki.ros.org )

rmw_cyclonedds_cpp : Implement the ROS middleware interface using Eclipse CycloneDDS in C++. ( https://wiki.ros.org )

rmw_dds_common : Define a common interface between DDS implementations of ROS middleware. ( https://wiki.ros.org )

rmw_fastrtps_cpp : Implement the ROS middleware interface using eProsima FastRTPS static code [...] ( https://wiki.ros.org )

rmw_fastrtps_dynamic_cpp : Implement the ROS middleware interface using introspection type support. ( https://wiki.ros.org )

rmw_fastrtps_shared_cpp : Code shared on static and dynamic type support of rmw_fastrtps_cpp. ( https://wiki.ros.org )

rmw_implementation : The decision which ROS middleware implementation should be used for C++. ( https://wiki.ros.org )

rmw_implementation_cmake : CMake functions which can discover and enumerate available implementations. ( https://wiki.ros.org )

robot_state_publisher : This package allows you to publish the state of a robot to ( https://wiki.ros.org )

robot_upstart : The robot_upstart package provides scripts which may be used to install ( https://wiki.ros.org )

ros1_bridge : A simple bridge between ROS 1 and ROS 2 ( https://wiki.ros.org )

ros1_rosbag_storage_vendor : Vendor package for rosbag_storage of ROS1 ( https://wiki.ros.org )

ros2_control : Metapackage for ROS2 control related packages ( https://wiki.ros.org )

ros2_control_test_assets : The package provides shared test resources for ros2_control stack ( https://wiki.ros.org )

ros2_controllers : Metapackage for ROS2 controllers related packages ( https://wiki.ros.org )

ros2_controllers_test_nodes : Demo nodes for showing and testing functionalities of the ros2_control fram[...] ( https://wiki.ros.org )

ros2_ouster : ROS2 Drivers for the Ouster OS-1 Lidar ( https://wiki.ros.org )

ros2_socketcan : Simple wrapper around SocketCAN ( https://wiki.ros.org )

ros2action : The action command for ROS 2 command line tools. ( https://wiki.ros.org )

ros2bag : Entry point for rosbag in ROS 2 ( https://wiki.ros.org )

ros2cli : Framework for ROS 2 command line tools. ( https://wiki.ros.org )

ros2cli_common_extensions : Meta package for ros2cli common extensions ( https://wiki.ros.org )

ros2cli_test_interfaces : A package containing interface definitions for testing ros2cli. ( https://wiki.ros.org )

ros2component : The component command for ROS 2 command line tools. ( https://wiki.ros.org )

ros2controlcli : The ROS 2 command line tools for ROS2 Control. ( https://wiki.ros.org )

ros2interface : The interface command for ROS 2 command line tools ( https://wiki.ros.org )

ros2launch : The launch command for ROS 2 command line tools. ( https://wiki.ros.org )

ros2launch_security : Security extensions for ros2 launch ( https://wiki.ros.org )

ros2launch_security_examples : Examples of how to use the ros2launch_security extension. ( https://wiki.ros.org )

ros2lifecycle : The lifecycle command for ROS 2 command line tools. ( https://wiki.ros.org )

ros2lifecycle_test_fixtures : Package containing fixture nodes for ros2lifecycle tests ( https://wiki.ros.org )

ros2multicast : The multicast command for ROS 2 command line tools. ( https://wiki.ros.org )

ros2node : The node command for ROS 2 command line tools. ( https://wiki.ros.org )

ros2nodl : CLI tools for NoDL files. ( https://wiki.ros.org )

ros2param : The param command for ROS 2 command line tools. ( https://wiki.ros.org )

ros2pkg : The pkg command for ROS 2 command line tools. ( https://wiki.ros.org )

ros2run : The run command for ROS 2 command line tools. ( https://wiki.ros.org )

ros2service : The service command for ROS 2 command line tools. ( https://wiki.ros.org )

ros2test : The test command for ROS 2 launch tests. ( https://wiki.ros.org )

ros2topic : The topic command for ROS 2 command line tools. ( https://wiki.ros.org )

ros2trace : The trace command for ROS 2 command line tools. ( https://index.ros.org/p/ros2trace/ )

ros2trace_analysis : The trace-analysis command for ROS 2 command line tools. ( https://index.ros.org/p/ros2trace_analysis/ )

ros_base : A package which extends \'ros_core\' and includes other basic functionaliti[...] ( https://wiki.ros.org )

ros_core : A package to aggregate the packages required to use publish / subscribe, se[...] ( https://wiki.ros.org )

ros_environment : The package provides the environment variables \`ROS_VERSION\` and \`ROS_DI[...] ( https://github.com/ros/ros_environment )

ros_ign : Meta-package containing interfaces for using ROS 2 with a href=\"https://i[...] ( https://wiki.ros.org )

ros_ign_interfaces : Message and service data structures for interacting with Ignition from ROS2. ( https://wiki.ros.org )

ros_image_to_qimage : A package that converts a ros image msg to a qimage object ( https://wiki.ros.org )

ros_testing : The entry point package to launch testing in ROS. ( https://wiki.ros.org )

ros_workspace : Provides the prefix level environment files for ROS 2 packages. ( https://wiki.ros.org )

rosapi : Provides service calls for getting ros meta-information, like list of ( http://ros.org/wiki/rosapi )

rosapi_msgs : Provides service calls for getting ros meta-information, like list of ( http://ros.org/wiki/rosapi )

rosbag2 : Meta package for rosbag2 related packages ( https://wiki.ros.org )

rosbag2_bag_v2_plugins : Package containing storage and converter plugins for rosbag 1 ( https://wiki.ros.org )

rosbag2_compression : Compression implementations for rosbag2 bags and messages. ( https://wiki.ros.org )

rosbag2_compression_zstd : Zstandard compression library implementation of rosbag2_compression ( https://wiki.ros.org )

rosbag2_cpp : C++ ROSBag2 client library ( https://wiki.ros.org )

rosbag2_interfaces : Interface definitions for controlling rosbag2 ( https://wiki.ros.org )

rosbag2_performance_benchmarking : Code to benchmark rosbag2 ( https://wiki.ros.org )

rosbag2_py : Python API for rosbag2 ( https://wiki.ros.org )

rosbag2_storage : ROS2 independent storage format to store serialized ROS2 messages ( https://wiki.ros.org )

rosbag2_storage_default_plugins : ROSBag2 SQLite3 storage plugin ( https://wiki.ros.org )

rosbag2_storage_mcap : rosbag2 storage plugin using the MCAP file format ( https://wiki.ros.org )

rosbag2_storage_mcap_testdata : message definition test fixtures for MCAP schema recording ( https://wiki.ros.org )

rosbag2_test_common : Commonly used test helper classes and fixtures for rosbag2 ( https://wiki.ros.org )

rosbag2_tests : Tests package for rosbag2 ( https://wiki.ros.org )

rosbag2_transport : Layer encapsulating ROS middleware to allow rosbag2 to be used with or with[...] ( https://wiki.ros.org )

rosbridge_library : The core rosbridge package, responsible for interpreting JSON andperforming[...] ( http://ros.org/wiki/rosbridge_library )

rosbridge_msgs : Package containing message files ( https://wiki.ros.org )

rosbridge_server : A WebSocket interface to rosbridge. ( http://ros.org/wiki/rosbridge_server )

rosbridge_suite : Rosbridge provides a JSON API to ROS functionality for non-ROS programs. ( http://ros.org/wiki/rosbridge_suite )

rosbridge_test_msgs : Message and service definitions used in internal tests for rosbridge packages. ( http://ros.org/wiki/rosbridge_library )

rosgraph_msgs : Messages relating to the ROS Computation Graph. ( https://wiki.ros.org )

rosidl_adapter : API and scripts to parse .msg/.srv/.action files and convert them to .idl. ( https://wiki.ros.org )

rosidl_cli : Command line tools for ROS interface generation. ( https://wiki.ros.org )

rosidl_cmake : The CMake functionality to invoke code generation for ROS interface files. ( https://wiki.ros.org )

rosidl_default_generators : A configuration package defining the default ROS interface generators. ( https://wiki.ros.org )

rosidl_default_runtime : A configuration package defining the runtime for the ROS interfaces. ( https://wiki.ros.org )

rosidl_generator_c : Generate the ROS interfaces in C. ( https://wiki.ros.org )

rosidl_generator_cpp : Generate the ROS interfaces in C++. ( https://wiki.ros.org )

rosidl_generator_dds_idl : Generate the DDS interfaces for ROS interfaces. ( https://wiki.ros.org )

rosidl_generator_py : Generate the ROS interfaces in Python. ( https://wiki.ros.org )

rosidl_parser : The parser for \`.idl\` ROS interface files. ( https://wiki.ros.org )

rosidl_runtime_c : Provides definitions, initialization and finalization functions, and macros[...] ( https://wiki.ros.org )

rosidl_runtime_cpp : Provides definitions and templated functions for getting and working with r[...] ( https://wiki.ros.org )

rosidl_runtime_py : Runtime utilities for working with generated ROS interfaces in Python. ( https://wiki.ros.org )

rosidl_typesupport_c : Generate the type support for C messages. ( https://wiki.ros.org )

rosidl_typesupport_cpp : Generate the type support for C++ messages. ( https://wiki.ros.org )

rosidl_typesupport_fastrtps_c : Generate the C interfaces for eProsima FastRTPS. ( https://wiki.ros.org )

rosidl_typesupport_fastrtps_cpp : Generate the C++ interfaces for eProsima FastRTPS. ( https://wiki.ros.org )

rosidl_typesupport_interface : The interface for rosidl typesupport packages. ( https://wiki.ros.org )

rosidl_typesupport_introspection_c : Generate the message type support for dynamic message construction in C. ( https://wiki.ros.org )

rosidl_typesupport_introspection_cpp : Generate the message type support for dynamic message construction in C++. ( https://wiki.ros.org )

rplidar_ros : The rplidar ros package, support rplidar A2/A1 and A3/S1 ( https://wiki.ros.org )

rpyutils : Package containing various utility types and functions for Python ( https://wiki.ros.org )

rqt : rqt is a Qt-based framework for GUI development for ROS. It consists of thr[...] ( http://ros.org/wiki/rqt )

rqt_action : rqt_action provides a feature to introspect all available ROS ( http://wiki.ros.org/rqt_action )

rqt_bag : rqt_bag provides a GUI plugin for displaying and replaying ROS bag files. ( http://wiki.ros.org/rqt_bag )

rqt_bag_plugins : rqt_bag provides a GUI plugin for displaying and replaying ROS bag files. ( http://wiki.ros.org/rqt_bag )

rqt_common_plugins : rqt_common_plugins metapackage provides ROS backend graphical tools suite t[...] ( http://ros.org/wiki/rqt_common_plugins )

rqt_console : rqt_console provides a GUI plugin for displaying and filtering ROS messages. ( http://wiki.ros.org/rqt_console )

rqt_graph : rqt_graph provides a GUI plugin for visualizing the ROS ( http://wiki.ros.org/rqt_graph )

rqt_gui : rqt_gui provides the main to start an instance of the ROS integrated graphi[...] ( http://ros.org/wiki/rqt_gui )

rqt_gui_cpp : rqt_gui_cpp enables GUI plugins to use the C++ client library for ROS. ( http://ros.org/wiki/rqt_gui_cpp )

rqt_gui_py : rqt_gui_py enables GUI plugins to use the Python client library for ROS. ( http://ros.org/wiki/rqt_gui_py )

rqt_image_overlay : An rqt plugin to display overlays for custom msgs on an image using plugins. ( https://wiki.ros.org )

rqt_image_overlay_layer : Provides an rqt_image_overlay_layer plugin interface, and a template impele[...] ( https://wiki.ros.org )

rqt_image_view : rqt_image_view provides a GUI plugin for displaying images using image_tran[...] ( http://wiki.ros.org/rqt_image_view )

rqt_moveit : An rqt-based tool that assists monitoring tasks ( http://wiki.ros.org/rqt_moveit )

rqt_msg : A Python GUI plugin for introspecting available ROS message types. ( http://wiki.ros.org/rqt_msg )

rqt_plot : rqt_plot provides a GUI plugin visualizing numeric values in a 2D plot usin[...] ( http://wiki.ros.org/rqt_plot )

rqt_publisher : rqt_publisher provides a GUI plugin for publishing arbitrary messages with [...] ( http://wiki.ros.org/rqt_publisher )

rqt_py_common : rqt_py_common provides common functionality for rqt plugins written in Pyth[...] ( http://ros.org/wiki/rqt_py_common )

rqt_py_console : rqt_py_console is a Python GUI plugin providing an interactive Python console. ( http://wiki.ros.org/rqt_py_console )

rqt_reconfigure : This rqt plugin provides a way to view and edit parameters on nodes. ( http://wiki.ros.org/rqt_reconfigure )

rqt_robot_dashboard : rqt_robot_dashboard provides an infrastructure for building robot dashboard[...] ( http://wiki.ros.org/rqt_robot_dashboard )

rqt_robot_monitor : rqt_robot_monitor displays diagnostics_agg topics messages that ( http://wiki.ros.org/rqt_robot_monitor )

rqt_robot_steering : rqt_robot_steering provides a GUI plugin for steering a robot using Twist m[...] ( http://wiki.ros.org/rqt_robot_steering )

rqt_runtime_monitor : rqt_runtime_monitor provides a GUI plugin viewing DiagnosticsArray messages. ( http://wiki.ros.org/rqt_runtime_monitor )

rqt_service_caller : rqt_service_caller provides a GUI plugin for calling arbitrary services. ( http://wiki.ros.org/rqt_service_caller )

rqt_shell : rqt_shell is a Python GUI plugin providing an interactive shell. ( http://wiki.ros.org/rqt_shell )

rqt_srv : A Python GUI plugin for introspecting available ROS message types. ( http://wiki.ros.org/rqt_srv )

rqt_tf_tree : rqt_tf_tree provides a GUI plugin for visualizing the ROS TF frame tree. ( http://wiki.ros.org/rqt_tf_tree )

rqt_top : RQT plugin for monitoring ROS processes. ( http://wiki.ros.org/rqt_top )

rqt_topic : rqt_topic provides a GUI plugin for displaying debug information about ROS [...] ( http://wiki.ros.org/rqt_topic )

rslidar_msg : Messages for the rslidar_sdk package ( https://wiki.ros.org )

rt_manipulators_cpp : RT Manipulators C++ Library ( https://wiki.ros.org )

rt_manipulators_examples : Examples for RT Manipulators C++ Library ( https://wiki.ros.org )

rtabmap_ros : RTAB-Map\'s ros-pkg. RTAB-Map is a RGB-D SLAM approach with real-time const[...] ( https://github.com/introlab/rtabmap_ros/issues )

rttest : Instrumentation library for real-time performance testing ( https://wiki.ros.org )

ruckig : Instantaneous Motion Generation for Robots and Machines. ( https://wiki.ros.org )

run_move_group : Demo launch file for running a MoveGroup setup ( https://wiki.ros.org )

run_moveit_cpp : TODO: Package description ( https://wiki.ros.org )

run_ompl_constrained_planning : Demo ompl constrained planning capabilities ( https://wiki.ros.org )

rviz2 : 3D visualization tool for ROS. ( https://github.com/ros2/rviz/blob/ros2/README.md )

rviz_assimp_vendor : Wrapper around assimp, providing nothing but a dependency on assimp, on som[...] ( http://assimp.sourceforge.net/index.html )

rviz_common : Common rviz API, used by rviz plugins and applications. ( https://github.com/ros2/rviz/blob/ros2/README.md )

rviz_default_plugins : Several default plugins for rviz to cover the basic functionality. ( https://github.com/ros2/rviz/blob/ros2/README.md )

rviz_imu_plugin : RVIZ plugin for IMU visualization ( http://ros.org/wiki/rviz_imu_plugin )

rviz_ogre_vendor : Wrapper around ogre3d, it provides a fixed CMake module and an ExternalProj[...] ( https://www.ogre3d.org/ )

rviz_rendering : Library which provides the 3D rendering functionality in rviz. ( https://github.com/ros2/rviz/blob/ros2/README.md )

rviz_rendering_tests : Example plugin for RViz - documents and tests RViz plugin development ( https://github.com/ros2/rviz )

rviz_visual_testing_framework : 3D testing framework for RViz. ( http://ros.org/wiki/rviz2 )

rviz_visual_tools : Utility functions for displaying and debugging data in Rviz via published m[...] ( https://github.com/PickNikRobotics/rviz_visual_tools )

sbg_driver : ROS driver package for communication with the SBG navigation systems. ( http://wiki.ros.org/sbg_driver )

sdformat_test_files : Example SDFormat XML files for testing tools using hthis format. ( https://github.com/ros/sdformat_test_files )

sdformat_urdf : URDF plugin to parse SDFormat XML into URDF C++ DOM objects. ( https://github.com/ros/sdformat_urdf )

sdl2_vendor : Vendor library for SDL2. ( https://wiki.ros.org )

self_test : self_test ( http://www.ros.org/wiki/self_test )

sensor_msgs : A package containing some sensor data related message and service definitions. ( https://wiki.ros.org )

sensor_msgs_py : A package for easy creation and reading of PointCloud2 messages in Python. ( https://wiki.ros.org )

serial_driver : A template class and associated utilities which encapsulate basic reading f[...] ( https://github.com/ros-drivers/transport_drivers )

shape_msgs : A package containing some message definitions which describe geometric shapes. ( https://wiki.ros.org )

shared_queues_vendor : Vendor package for concurrent queues from moodycamel ( https://wiki.ros.org )

sick_safetyscanners2 : ROS2 Driver for the SICK safetyscanners ( https://wiki.ros.org )

sick_safetyscanners2_interfaces : Interfaces for the sick_safetyscanners ros2 driver ( https://wiki.ros.org )

sick_safetyscanners_base : Provides an Interface to read the sensor output of a SICK ( https://wiki.ros.org )

simple_actions : Simple library for using the \`rclpy/rclcpp\` action libraries ( https://wiki.ros.org )

simple_launch : Python helper class for the ROS 2 launch system ( https://wiki.ros.org )

slam_toolbox : This package provides a sped up improved slam karto with updated SDK and vi[...] ( https://wiki.ros.org )

slider_publisher : This packages proposes a slider-based publisher node similar to the joint_s[...] ( https://wiki.ros.org )

smacc2 : An Event-Driven, Asynchronous, Behavioral State Machine Library for ROS2 \([...] ( https://wiki.ros.org )

smacc2_msgs : Messages and services used in smacc2. ( https://wiki.ros.org )

smclib : The State Machine Compiler \(SMC\) from http://smc.sourceforge.net/ ( http://smc.sourceforge.net/ )

snowbot_operating_system : The weather outside is frightful ( https://wiki.ros.org )

soccer_marker_generation : Generates rviz display markers from soccer msgs ( https://wiki.ros.org )

soccer_object_msgs : Package providing interfaces for objects in a soccer domain. ( https://wiki.ros.org )

soccer_vision_msgs : Package providing interfaces to be used in a soccer domain. ( https://wiki.ros.org )

sol_vendor : vendor package for the sol2 library ( https://wiki.ros.org )

sophus : C++ implementation of Lie Groups using Eigen. ( https://github.com/strasdat/sophus )

spacenav : ROS interface to the 3Dconnexion SpaceNavigator 6DOF joystick. ( http://www.ros.org/wiki/spacenav_node )

spatio_temporal_voxel_layer : The spatio-temporal 3D obstacle costmap package ( https://wiki.ros.org )

spdlog_vendor : Wrapper around spdlog, providing nothing but a dependency on spdlog, on som[...] ( https://github.com/gabime/spdlog )

splsm_7 : RoboCup Standard Platform League Standard Message V7 ROS msg ( https://wiki.ros.org )

splsm_7_conversion : Converts Standard Platform League Standard Message V7 between ROS msg and U[...] ( https://wiki.ros.org )

sqlite3_vendor : SQLite 3 vendor package ( https://wiki.ros.org )

srdfdom : Parser for Semantic Robot Description Format \(SRDF\). ( http://ros.org/wiki/srdfdom )

sros2 : Command line tools for managing SROS2 keys ( https://wiki.ros.org )

sros2_cmake : CMake macros to configure security ( https://wiki.ros.org )

statistics_msgs : Message definitions for reporting statistics for topics and system resources. ( https://wiki.ros.org )

std_msgs : A package containing some standard message definitions. ( https://wiki.ros.org )

std_srvs : A package containing some standard service definitions. ( https://wiki.ros.org )

stereo_image_proc : Stereo and single image rectification and disparity processing. ( https://index.ros.org/p/stereo_image_proc/github-ros-perception-image_pipeline/ )

stereo_msgs : A package containing some stereo camera related message definitions. ( https://wiki.ros.org )

stubborn_buddies : Demo that uses node composition of lifecycle nodes to achieve fail-over rob[...] ( https://wiki.ros.org )

stubborn_buddies_msgs : Messages to support library of stubborn buddies ( https://wiki.ros.org )

swri_console : A rosout GUI viewer developed at Southwest Research Insititute as an ( http://ros.org/wiki/swri_console )

swri_console_util : swri_console_util ( https://github.com/swri-robotics/marti_common )

swri_dbw_interface : This package provides documentation on common interface conventions for ( https://github.com/swri-robotics/marti_common )

swri_geometry_util : swri_geometry_util ( https://github.com/swri-robotics/marti_common )

swri_image_util : swri_image_util ( https://github.com/swri-robotics/marti_common )

swri_math_util : swri_math_util ( https://github.com/swri-robotics/marti_common )

swri_opencv_util : swri_opencv_util ( https://github.com/swri-robotics/marti_common )

swri_prefix_tools : Contains scripts that are useful as prefix commands for nodes ( https://github.com/swri-robotics/marti_common )

swri_roscpp : swri_roscpp ( https://wiki.ros.org )

swri_route_util : This library provides functionality to simplify working with the ( https://wiki.ros.org )

swri_serial_util : swri_serial_util ( https://github.com/swri-robotics/marti_common )

swri_system_util : swri_system_util ( https://github.com/swri-robotics/marti_common )

swri_transform_util : The swri_transform_util package contains utility functions and classes for\[...] ( https://github.com/swri-robotics/marti_common )

system_fingerprint : The system_fingerprint package ( https://wiki.ros.org )

system_modes : The system modes concept assumes that a robotics system is built ( https://micro.ros.org/docs/concepts/client_library/lifecycle_and_system_modes/ )

system_modes_examples : Example systems and according launch files for the system_modes ( https://micro.ros.org/docs/concepts/client_library/lifecycle_and_system_modes/ )

system_modes_msgs : Interface package, containing message definitions and service definitions ( https://micro.ros.org/docs/concepts/client_library/lifecycle_and_system_modes/ )

tango_icons_vendor : tango_icons_vendor provides the public domain Tango icons for non-linux sys[...] ( http://ros.org/wiki/qt_gui_icons )

teleop_tools : A set of generic teleoperation tools for any robot. ( https://wiki.ros.org )

teleop_tools_msgs : The teleop_tools_msgs package ( https://wiki.ros.org )

teleop_twist_joy : Generic joystick teleop for twist robots. ( http://wiki.ros.org/teleop_twist_joy )

teleop_twist_keyboard : A robot-agnostic teleoperation node to convert keyboard commands to Twist ( http://wiki.ros.org/teleop_twist_keyboard )

tensorrt_cmake_module : Exports a CMake module to find TensorRT. ( https://wiki.ros.org )

test_apex_test_tools : Test package, which uses things exported by apex_test_tools ( https://wiki.ros.org )

test_bond : Contains tests for \[\[bond\]\], including tests for \[\[bondcpp\]\]. ( http://www.ros.org/wiki/test_bond )

test_interface_files : A package containing message definitions and fixtures used exclusively for [...] ( https://wiki.ros.org )

test_launch_system_modes : Launch tests for the launch_system_modes package, i.e. launch actions, even[...] ( https://micro.ros.org/docs/concepts/client_library/lifecycle_and_system_modes/ )

test_msgs : A package containing message definitions and fixtures used exclusively for [...] ( https://wiki.ros.org )

tf2 : tf2 is the second generation of the transform library, which lets ( http://www.ros.org/wiki/tf2 )

tf2_bullet : tf2_bullet ( http://www.ros.org/wiki/tf2_bullet )

tf2_eigen : tf2_eigen ( https://wiki.ros.org )

tf2_eigen_kdl : Conversion functions between: ( https://wiki.ros.org )

tf2_geometry_msgs : tf2_geometry_msgs ( http://www.ros.org/wiki/tf2_ros )

tf2_kdl : KDL binding for tf2 ( http://ros.org/wiki/tf2 )

tf2_msgs : tf2_msgs ( http://www.ros.org/wiki/tf2_msgs )

tf2_py : The tf2_py package ( http://ros.org/wiki/tf2_py )

tf2_ros : This package contains the C++ ROS bindings for the tf2 library ( http://www.ros.org/wiki/tf2_ros )

tf2_ros_py : This package contains the ROS Python bindings for the tf2 library ( http://www.ros.org/wiki/tf2_ros )

tf2_sensor_msgs : Small lib to transform sensor_msgs with tf. Most notably, PointCloud2 ( http://www.ros.org/wiki/tf2_ros )

tf2_tools : tf2_tools ( http://www.ros.org/wiki/tf2_tools )

tf_transformations : Reimplementation of the tf/transformations.py library for common Python spa[...] ( https://wiki.ros.org )

theora_image_transport : Theora_image_transport provides a plugin to image_transport for ( http://www.ros.org/wiki/image_transport_plugins )

tile_map : Tile map provides a slippy map style interface for visualizing ( https://github.com/swri-robotics/mapviz )

tinyxml2_vendor : Wrapper around tinyxml2, providing nothing but a dependency on tinyxml2, on[...] ( https://wiki.ros.org )

tinyxml_vendor : CMake shim over the tinxml library. ( https://wiki.ros.org )

tlsf : TLSF allocator version 2.4.6 ( https://wiki.ros.org )

tlsf_cpp : C++ stdlib-compatible wrapper around tlsf allocator and ROS2 examples ( https://wiki.ros.org )

topic_monitor : Package containing tools for monitoring ROS 2 topics. ( https://wiki.ros.org )

topic_statistics_demo : C++ demo application for topic statistics feature. ( https://wiki.ros.org )

topic_tools : TODO: Package description ( https://wiki.ros.org )

topic_tools_interfaces : topic_tools_interfaces contains messages and services for topic_tools ( https://wiki.ros.org )

tracetools : Tracing wrapper for ROS 2. ( https://index.ros.org/p/tracetools/ )

tracetools_launch : Launch integration for tracing. ( https://index.ros.org/p/tracetools_launch/ )

tracetools_read : Tools for reading traces. ( https://index.ros.org/p/tracetools_read/ )

tracetools_test : Testing utilities and tests for the tracetools package. ( https://index.ros.org/p/tracetools_test/ )

trajectory_msgs : A package containing some robot trajectory message definitions. ( https://wiki.ros.org )

transmission_interface : transmission_interface contains data structures for representing mechanical[...] ( https://wiki.ros.org )

turtle_tf2_cpp : turtle_tf2_cpp demonstrates how to write a ROS2 C++ tf2 broadcaster and lis[...] ( https://wiki.ros.org )

turtle_tf2_py : turtle_tf2_py demonstrates how to write a ROS2 Python tf2 broadcaster and l[...] ( https://wiki.ros.org )

turtlebot3 : ROS 2 packages for TurtleBot3 ( http://turtlebot3.robotis.com )

turtlebot3_bringup : ROS 2 launch scripts for starting the TurtleBot3 ( http://turtlebot3.robotis.com )

turtlebot3_cartographer : ROS 2 launch scripts for cartographer ( http://turtlebot3.robotis.com )

turtlebot3_description : 3D models of the TurtleBot3 for simulation and visualization ( http://turtlebot3.robotis.com )

turtlebot3_example : This package provides four basic examples for TurtleBot3 \(i.e., interactiv[...] ( http://turtlebot3.robotis.com )

turtlebot3_fake_node : Package for TurtleBot3 fake node. With this package, simple tests can be do[...] ( http://turtlebot3.robotis.com )

turtlebot3_gazebo : Gazebo simulation package for the TurtleBot3 ( http://turtlebot3.robotis.com )

turtlebot3_msgs : Message and service types: custom messages and services for TurtleBot3 pack[...] ( http://wiki.ros.org/turtlebot3_msgs )

turtlebot3_navigation2 : ROS 2 launch scripts for navigation2 ( http://turtlebot3.robotis.com )

turtlebot3_node : TurtleBot3 driver node that include diff drive controller, odometry and tf node ( http://turtlebot3.robotis.com )

turtlebot3_simulations : ROS 2 packages for TurtleBot3 simulations ( http://turtlebot3.robotis.com )

turtlebot3_teleop : Teleoperation node using keyboard for TurtleBot3. ( http://turtlebot3.robotis.com )

turtlebot4_bringup : Turtlebot4 Robot Bringup ( https://wiki.ros.org )

turtlebot4_cpp_examples : TurtleBot 4 C++ Examples ( https://wiki.ros.org )

turtlebot4_cpp_tutorials : TurtleBot 4 C++ Tutorials ( https://wiki.ros.org )

turtlebot4_description : Turtlebot4 Description package ( https://wiki.ros.org )

turtlebot4_desktop : Turtlebot4 Desktop Metapackage ( https://wiki.ros.org )

turtlebot4_diagnostics : Turtlebot4 Diagnostics ( https://wiki.ros.org )

turtlebot4_examples : Turtlebot4 Examples Metapackage ( https://wiki.ros.org )

turtlebot4_ignition_bringup : TurtleBot 4 Ignition Simulator bringup ( https://wiki.ros.org )

turtlebot4_ignition_toolbox : Turtlebot4 Ignition Toolbox ( https://wiki.ros.org )

turtlebot4_msgs : Turtlebot4 Messages ( https://wiki.ros.org )

turtlebot4_navigation : Turtlebot4 Navigation ( https://wiki.ros.org )

turtlebot4_node : Turtlebot4 Node ( https://wiki.ros.org )

turtlebot4_python_examples : TurtleBot 4 Python Examples ( https://wiki.ros.org )

turtlebot4_python_tutorials : TurtleBot 4 Python Tutorials ( https://wiki.ros.org )

turtlebot4_robot : Turtlebot4 Robot Metapackage ( https://wiki.ros.org )

turtlebot4_simulator : TODO: Package description ( https://wiki.ros.org )

turtlebot4_tests : Turtlebot4 System Tests ( https://wiki.ros.org )

turtlebot4_tutorials : Turtlebot4 Tutorials Metapackage ( https://wiki.ros.org )

turtlebot4_viz : Visualization launchers and helpers for Turtlebot4 ( https://wiki.ros.org )

turtlesim : turtlesim is a tool made for teaching ROS and ROS packages. ( http://www.ros.org/wiki/turtlesim )

twist_mux : Twist multiplexer, which multiplex several velocity commands \(topics\) and[...] ( https://wiki.ros.org )

twist_stamper : ROS2 package for converting between Twist and TwistStamped messages ( https://github.com/joshnewans/twist_stamper/issues )

ublox : Provides a ublox_gps node for u-blox GPS receivers, messages, and serializa[...] ( http://wiki.ros.org/ublox )

ublox_dgnss : Provides a ublox_dgnss node for a u-blox GPS DGNSS receiver using Gen 9 UBX[...] ( https://github.com/aussierobots/ublox_dgnss )

ublox_dgnss_node : Provides a ublox_gnss node for a u-blox GPS GNSS receiver using Gen 9 UBX P[...] ( https://github.com/aussierobots/ublox_dgnss )

ublox_gps : Driver for u-blox GPS devices. ( http://ros.org/wiki/ublox )

ublox_msgs : ublox_msgs contains raw messages for u-blox GNSS devices. ( http://ros.org/wiki/ublox )

ublox_serialization : ublox_serialization provides header files for serialization of ROS messages[...] ( http://ros.org/wiki/ublox )

ublox_ubx_interfaces : UBLOX UBX Interfaces ( https://github.com/aussierobots/ublox_dgnss )

ublox_ubx_msgs : UBLOX UBX ROS2 Msgs ( https://github.com/aussierobots/ublox_dgnss )

udp_driver : A library to write Synchronous and Asynchronous networking applications, RO[...] ( https://github.com/ros-drivers/transport_drivers )

udp_msgs : ROS2 udp_msgs package ( https://wiki.ros.org )

uncrustify_vendor : Wrapper around uncrustify, providing nothing but a dependency on uncrustify[...] ( https://github.com/uncrustify/uncrustify )

unique_identifier_msgs : ROS messages for universally unique identifiers. ( http://ros.org/wiki/unique_identifier_msgs )

ur_bringup : Launch file and run-time configurations, e.g. controllers. ( https://github.com/UniversalRobots/Universal_Robots_ROS2_Driver/issues )

ur_calibration : Package for extracting the factory calibration from a UR robot and change i[...] ( https://wiki.ros.org )

ur_controllers : Provides controllers that use the speed scaling interface of Universal Robots. ( https://github.com/UniversalRobots/Universal_Robots_ROS2_Driver/issues )

ur_dashboard_msgs : Messages around the UR Dashboard server. ( https://github.com/UniversalRobots/Universal_Robots_ROS2_Driver/issues )

ur_description : URDF description for Universal Robots ( https://github.com/UniversalRobots/Universal_Robots_ROS2_Description/issues )

ur_moveit_config : An example package with MoveIt2 configurations for UR robots. ( https://wiki.ros.org )

ur_msgs : Message and service definitions for interacting with Universal Robots robot[...] ( https://wiki.ros.org )

ur_robot_driver : The new driver for Universal Robots UR3, UR5 and UR10 robots with CB3 contr[...] ( https://github.com/UniversalRobots/Universal_Robots_ROS2_Driver/issues )

urdf : This package contains a C++ parser for the Unified Robot Description ( https://github.com/ros2/urdf )

urdf_parser_plugin : This package contains a C++ base class for URDF parsers. ( https://github.com/ros2/urdf )

urdf_tutorial : This package contains a number of URDF tutorials. ( http://ros.org/wiki/urdf_tutorial )

urdfdom : A library to access URDFs using the DOM model. ( https://wiki.ros.org )

urdfdom_headers : C++ headers for URDF. ( http://ros.org/wiki/urdf )

urdfdom_py : Python implementation of the URDF parser. ( http://wiki.ros.org/urdfdom_py )

urg_c : The urg_c package ( http://sourceforge.net/projects/urgwidget/ )

urg_node : urg_node ( http://ros.org/wiki/urg_node )

urg_node_msgs : urg_node_msgs ( http://ros.org/wiki/urg_node )

usb_cam : A ROS2 Driver for V4L USB Cameras ( http://wiki.ros.org/usb_cam )

v4l2_camera : A ROS 2 camera driver using Video4Linux2 ( https://wiki.ros.org )

vda5050_msgs : The vda5050_msgs package contains the datatypes \(json objects\) specified [...] ( https://www.vda.de/dam/vda/publications/2019/Logistik/VDA5050.pdf )

vda5050_serializer : The serialization/deserialization functions to be loaded into the mqtt_brid[...] ( https://wiki.ros.org )

velocity_controllers : Generic controller for forwarding commands. ( https://wiki.ros.org )

velodyne : Basic ROS support for the Velodyne 3D LIDARs. ( http://www.ros.org/wiki/velodyne )

velodyne_description : URDF and meshes describing Velodyne laser scanners. ( http://wiki.ros.org/velodyne_description )

velodyne_driver : ROS device driver for Velodyne 3D LIDARs. ( http://www.ros.org/wiki/velodyne_driver )

velodyne_gazebo_plugins : Gazebo plugin to provide simulated data from Velodyne laser scanners. ( http://wiki.ros.org/velodyne_gazebo_plugins )

velodyne_laserscan : Extract a single ring of a Velodyne PointCloud2 and publish it as a LaserSc[...] ( http://ros.org/wiki/velodyne_laserscan )

velodyne_msgs : ROS message definitions for Velodyne 3D LIDARs. ( http://ros.org/wiki/velodyne_msgs )

velodyne_pointcloud : Point cloud conversions for Velodyne 3D LIDARs. ( http://ros.org/wiki/velodyne_pointcloud )

velodyne_simulator : Metapackage allowing easy installation of Velodyne simulation components. ( http://wiki.ros.org/velodyne_simulator )

vision_msgs : Messages for interfacing with various computer vision pipelines, such as ( https://wiki.ros.org )

vision_msgs_layers : Collection of RQt Image Overlay Plugins for Vision Msgs ( https://wiki.ros.org )

vision_opencv : Packages for interfacing ROS2 with OpenCV, a library of programming functio[...] ( http://www.ros.org/wiki/vision_opencv )

visp : ViSP standing for Visual Servoing Platform is a modular cross ( http://www.ros.org/wiki/visp )

visualization_msgs : A package containing some visualization and interaction related message def[...] ( https://wiki.ros.org )

warehouse_ros : Persistent storage of ROS messages ( http://ros.org/wiki/warehouse_ros )

warehouse_ros_sqlite : Implementation of warehouse_ros for sqlite ( http://ros.org/wiki/warehouse_ros )

webots_ros2 : Interface between Webots and ROS2 ( http://wiki.ros.org/webots_ros2 )

webots_ros2_control : ros2_control plugin for Webots ( http://wiki.ros.org/webots_ros2 )

webots_ros2_driver : Implementation of the Webots - ROS 2 interface ( http://wiki.ros.org/webots_ros2 )

webots_ros2_epuck : E-puck2 driver for Webots simulated robot ( http://wiki.ros.org/webots_ros2 )

webots_ros2_mavic : Mavic 2 Pro robot ROS2 interface for Webots. ( http://wiki.ros.org/webots_ros2 )

webots_ros2_msgs : Services and Messages of the webots_ros2 packages. ( http://wiki.ros.org/webots_ros2 )

webots_ros2_tesla : Tesla ROS2 interface for Webots. ( http://wiki.ros.org/webots_ros2 )

webots_ros2_tests : System tests for \`webots_ros2\` packages. ( http://wiki.ros.org/webots_ros2 )

webots_ros2_tiago : TIAGo robots ROS2 interface for Webots. ( http://wiki.ros.org/webots_ros2 )

webots_ros2_turtlebot : TurtleBot3 Burger robot ROS2 interface for Webots. ( http://wiki.ros.org/webots_ros2 )

webots_ros2_universal_robot : Universal Robot ROS2 interface for Webots. ( http://wiki.ros.org/webots_ros2 )

wiimote : The wiimote package allows ROS nodes to communicate with a Nintendo Wiimote[...] ( http://www.ros.org/wiki/wiimote )

wiimote_msgs : Messages used by wiimote package. ( http://www.ros.org/wiki/wiimote )

xacro : Xacro \(XML Macros\) ( http://ros.org/wiki/xacro )

yaml_cpp_vendor : Wrapper around yaml-cpp, it provides a fixed CMake module and an ExternalPr[...] ( https://github.com/jbeder/yaml-cpp )

zmqpp_vendor : Vendor package for zmqpp ( https://wiki.ros.org )

zstd_vendor : Zstd compression vendor package, providing a dependency for Zstd. ( https://facebook.github.io/zstd/ )

Add an ebuild in portage :

The ebuild is now in the portage tree.

You can also use layman : emerge layman then layman -a ros-overlay

For Paludis use this rsync : rsync://gentoo.zugaina.org/ros-overlay-portage

If you have a problem : ycarus(-at-)zugaina.org