Ycarus Gentoo ebuild

ros-overlay

These ebuilds come from .

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

ros-foxy

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_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_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_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 )

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

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 )

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 )

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

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 )

costmap_queue : The costmap_queue package ( 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 ( http://ros.org/wiki/depth_image_proc )

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 )

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 )

dynamic_edt_3d : The dynamicEDT3D library implements an inrementally updatable Euclidean dis[...] ( http://octomap.github.io )

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_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_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_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 )

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 )

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_ros_pkgs : Interface for using ROS with the a href=\"http://gazebosim.org/\"Gazebo/[...] ( http://gazebosim.org/tutorials?cat=connect_ros )

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 )

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 )

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 )

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

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

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[...] ( http://www.ros.org/wiki/image_pipeline )

image_proc : Single image rectification and color processing. ( http://www.ros.org/wiki/image_proc )

image_publisher : p ( http://ros.org/wiki/image_publisher )

image_rotate : p ( http://ros.org/wiki/image_rotate )

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 ( http://www.ros.org/wiki/image_view )

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 )

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 )

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 )

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

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_ros : ROS specific extensions to the launch tool. ( 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 )

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

librealsense2 : Library for capturing data from the Intel\(R\) RealSense\(TM\) SR300, D400 [...] ( https://github.com/IntelRealSense/librealsense/ )

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

libyaml_vendor : Wrapper around libyaml, provides the last version \(1.8.0 rc\) that ships w[...] ( 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 )

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

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

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_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 )

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

move_base_msgs : Holds the action description and relevant messages for the move_base package. ( http://wiki.ros.org/move_base_msgs )

mrpt2 : Mobile Robot Programming Toolkit \(MRPT\) version 2.x ( https://www.mrpt.org/ )

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

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

nav2_bringup : Bringup scripts and configurations for the navigation2 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 navigation2 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 navigation2 ( 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 navigation2 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_rviz_plugins : Navigation 2 plugins for rviz ( https://wiki.ros.org )

nav2_system_tests : TODO ( 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 )

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

octomap : The OctoMap library implements a 3D occupancy grid mapping approach, provid[...] ( http://octomap.github.io )

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

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

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

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 )

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 )

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 )

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

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 )

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

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 )

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 )

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_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 )

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

rclcpp_action : Adds action APIs for C++. ( 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 )

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

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

realsense_examples : ROS2 RealSense Package Exampless ( https://wiki.ros.org )

realsense_msgs : Message Definition for ROS2 RealSense Package ( https://wiki.ros.org )

realsense_node : ROS2 realsense node ( https://wiki.ros.org )

realsense_ros : ROS2 RealSense Package ( https://wiki.ros.org )

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 )

rmw : Contains the ROS middleware API. ( 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 )

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_ouster : ROS2 Drivers for the Ouster OS-1 Lidar ( 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 )

ros2component : The component command for ROS 2 command line tools. ( 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 )

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 : ( https://wiki.ros.org )

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

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_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 )

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_converter_default_plugins : Package containing default plugins for format converters ( https://wiki.ros.org )

rosbag2_cpp : C++ ROSBag2 client library ( 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_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 )

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_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 ROS interface files. ( https://wiki.ros.org )

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

rosidl_runtime_cpp : Generate the ROS interfaces in C++. ( 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_connext_c : Generate the C interfaces for RTI Connext. ( 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 )

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_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_view : rqt_image_view provides a GUI plugin for displaying images using image_tran[...] ( http://wiki.ros.org/rqt_image_view )

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_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_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_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 )

rttest : Instrumentation library for real-time performance testing ( 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_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 )

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 )

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 )

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

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

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. ( http://www.ros.org/wiki/stereo_image_proc )

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

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_modes : Model-based distributed configuration handling. ( https://wiki.ros.org )

system_modes_examples : Simple example system for system_modes 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 )

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

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

test_osrf_testing_tools_cpp : Test package, which uses things exported by osrf_testing_tools_cpp. ( 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_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 ROS bindings for the tf2 library, for both Python[...] ( 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 )

theora_image_transport : Theora_image_transport provides a plugin to image_transport for ( http://www.ros.org/wiki/image_transport_plugins )

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 )

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

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

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

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

trajectory_msgs : A package containing some robot trajectory message definitions. ( https://wiki.ros.org )

turtlebot3_msgs : Message and service types: custom messages and services for TurtleBot3 pack[...] ( http://wiki.ros.org/turtlebot3_msgs )

turtlesim : turtlesim is a tool made for teaching ROS and ROS packages. ( http://www.ros.org/wiki/turtlesim )

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 )

urdf : This package contains a C++ parser for the Unified Robot Description ( https://github.com/ros2/urdf )

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 )

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

vision_opencv : Packages for interfacing ROS2 with OpenCV, a library of programming functio[...] ( http://www.ros.org/wiki/vision_opencv )

visualization_msgs : A package containing some visualization and interaction related message def[...] ( https://wiki.ros.org )

webots_ros2 : Interface between Webots and ROS2 ( http://wiki.ros.org/webots_ros2 )

webots_ros2_abb : ABB robots ROS2 interface for Webots. ( http://wiki.ros.org/webots_ros2 )

webots_ros2_core : Core interface between Webots and ROS2 ( http://wiki.ros.org/webots_ros2 )

webots_ros2_demos : Various demos of the Webots-ROS2 interface. ( http://wiki.ros.org/webots_ros2 )

webots_ros2_desktop : Interface between Webots and ROS2 including the Webots package ( http://wiki.ros.org/webots_ros2 )

webots_ros2_epuck : E-puck2 driver for Webots simulated robot ( http://wiki.ros.org/webots_ros2 )

webots_ros2_examples : Minimal example showing how to control a robot with ROS2 in Webots. ( http://wiki.ros.org/webots_ros2 )

webots_ros2_importer : This package allows to convert URDF and XACRO files into Webots PROTO files. ( 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_tiago : TIAGo robots 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 )

webots_ros2_ur_e_description : Universal Robot description for Webots. ( http://wiki.ros.org/webots_ros2 )

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 )

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