Ycarus Gentoo ebuild

ros-overlay

These ebuilds come from .

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

ros-ardent

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

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

ament_clang_format : 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_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_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_nose : The ability to add nose-based tests in the ament buildsystem in CMake. ( 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_pep8 : The CMake API for ament_pep8 to check code against the style conventions in[...] ( 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_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_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_package : The parser for the manifest files in the ament buildsystem. ( https://wiki.ros.org )

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

ament_pep8 : 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_tools : The command line tools for the ament buildsystem. ( https://wiki.ros.org )

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

astra_camera : Drivers for Orbbec Astra Devices. ( https://wiki.ros.org )

builtin_interfaces : A package containing builtin message and service definitions. ( https://wiki.ros.org )

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

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 )

console_bridge : ROS-independent package for logging that seamlessly pipes into rosconsole/r[...] ( https://wiki.ros.org )

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 )

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

depthimage_to_pointcloud2 : A simple node to convert a depth image and camera info into a PointCloud2. ( https://wiki.ros.org )

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

diagnostic_msgs : A package containing some diagnostics related message and service definitions. ( 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 )

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

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

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

example_interfaces : Contains message and service definitions used by the 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_rclpy_executors : Examples of creating and using exectors to run multiple nodes in the same p[...] ( 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 )

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 )

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

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

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

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

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

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

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

kdl_parser : The Kinematics and Dynamics Library \(KDL\) defines a tree structure ( http://ros.org/wiki/kdl_parser )

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

launch_testing : Helper scripts for tests that use the ROS launch tool. ( https://wiki.ros.org )

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

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_server : map_server provides the ttmap_server/tt ROS a href=\"http://www.ros.or[...] ( http://wiki.ros.org/map_server )

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

opensplice_cmake_module : Provide CMake module to find PrismTech OpenSplice. ( https://wiki.ros.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 )

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

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 )

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

poco_vendor : CMake shim over the poco library. ( https://wiki.ros.org )

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

rcl : The ROS client library common 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 )

rclcpp : The ROS client library in C++. ( 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 )

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

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_fastrtps_cpp : Implement the ROS middleware interface using eProsima FastRTPS static code[...] ( 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 )

rmw_opensplice_cpp : Implement the ROS middleware interface using PrismTech OpenSplice static co[...] ( https://wiki.ros.org )

robot_state_publisher : ROS2 version of the robot_state_publisher package ( https://wiki.ros.org )

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

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

ros2msg : The msg 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 )

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 )

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

ros2topic : The topic command for ROS 2 command line tools. ( 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_workspace : Provides the prefix level environment files for ROS 2 packages. ( 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_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_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 )

rosidl_typesupport_opensplice_c : Generate the C interfaces for PrismTech OpenSplice. ( https://wiki.ros.org )

rosidl_typesupport_opensplice_cpp : Generate the C++ interfaces for PrismTech OpenSplice. ( https://wiki.ros.org )

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

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

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 )

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

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 )

rviz_yaml_cpp_vendor : Wrapper around yaml-cpp, it provides a fixed CMake module and an ExternalPr[...] ( https://github.com/jbeder/yaml-cpp )

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 )

sros2 : Command line tools for managing SROS2 keys ( 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_msgs : A package containing some stereo camera related message definitions. ( 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_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_eigen : tf2_eigen ( https://wiki.ros.org )

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

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

tf2_ros : This package contains the ROS bindings for the tf2 library, for both Python[...] ( http://www.ros.org/wiki/tf2_ros )

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 )

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

turtlebot2_amcl : Demo of turtlebot2 localization with amcl. ( https://wiki.ros.org )

turtlebot2_cartographer : Launch files for turtlebot2 cartographer demo ( https://wiki.ros.org )

turtlebot2_demo : Metapackage aggregating the turtlebot2 demo packages ( https://wiki.ros.org )

turtlebot2_drivers : Set of drivers to talk to the kobuki base. ( https://wiki.ros.org )

turtlebot2_follower : A simple follower using centroid in depth images. ( https://wiki.ros.org )

turtlebot2_teleop : Launch files for turtlebot2 teleop demo ( https://wiki.ros.org )

uncrustify : Package a newer version of uncrustify \(0.61+, b6593c1, April 14th 2015\). ( https://github.com/bengardner/uncrustify )

urdf : This package contains a C++ parser for the Unified Robot Description ( http://ros.org/wiki/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 )

vision_msgs : Messages for interfacing with various computer vision pipelines, such as ( https://wiki.ros.org )

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

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