Versions
v9999 :: 0 :: gentoo
- Modified
- License
- BSD
- USE flags
- test
v1.13.1 :: 0 :: gentoo
- Modified
- License
- BSD
- Keywords
- ~amd64 ~arm
- USE flags
- test
v1.13.0 :: 0 :: gentoo
- Modified
- License
- BSD
- Keywords
- ~amd64 ~arm
- USE flags
- test
USE flags
General
- test
- Enable dependencies and/or preparations necessary to run tests (usually controlled by FEATURES=test but can be toggled independently)
python_single_target
- python3_10
- Build for Python 3.10 only
- python3_8
- Build for Python 3.8 only
- python3_9
- Build for Python 3.9 only
ros_messages
- cxx
- Generate and install C++ messages.
- eus
- Generate and install EusLisp messages.
- lisp
- Generate and install Common-Lisp messages.
- nodejs
- Generate and install Nodejs messages.
- python
- Generate and install Python messages. The PYTHON_TARGETS variable controls the Python versions to build for.
Dependencies
dev-cpp / gtest : Google C++ Testing Framework
dev-lang / python : An interpreted, interactive, object-oriented programming language
dev-python / empy : A powerful and robust templating system for Python
dev-ros / gencpp : ROS C++ message definition and serialization generators
dev-ros / geneus : EusLisp ROS message and service generators
dev-ros / genlisp : Common-Lisp ROS message and service generators
dev-ros / genmsg : Python library for generating ROS message and service data structures
dev-ros / gennodejs : Javascript ROS message and service generators
dev-ros / genpy : Python ROS message and service generators
dev-ros / geometry_msgs : Messages for common geometric primitives such as points, vectors, and poses
dev-ros / message_generation : Build-time dependencies for generating language bindings of messages
dev-ros / message_runtime : Package modeling the run-time dependencies for language bindings of messages
dev-ros / rosunit : Unit-testing package for ROS
dev-ros / std_msgs : Standard ROS Messages
dev-util / catkin : Cmake macros and associated python code used to build some parts of ROS
Runtime Dependencies
dev-lang / python : An interpreted, interactive, object-oriented programming language
dev-ros / gencpp : ROS C++ message definition and serialization generators
dev-ros / geneus : EusLisp ROS message and service generators
dev-ros / genlisp : Common-Lisp ROS message and service generators
dev-ros / gennodejs : Javascript ROS message and service generators
dev-ros / genpy : Python ROS message and service generators
dev-ros / geometry_msgs : Messages for common geometric primitives such as points, vectors, and poses
dev-ros / message_runtime : Package modeling the run-time dependencies for language bindings of messages
Depending packages
dev-ros / amcl : Probabilistic localization system for a robot moving in 2D
dev-ros / base_local_planner : Trajectory Rollout and Dynamic Window approaches to robot navigation on a plane
dev-ros / calibration_msgs : Messages for storing calibration samples to be used in calibration procedures
dev-ros / camera_calibration : Calibration of monocular or stereo cameras
dev-ros / camera_calibration_parsers : Routines for reading and writing camera calibration parameters
dev-ros / camera_info_manager : C++ interface for camera calibration information
dev-ros / costmap_2d : Creates a 2D costmap from sensor data
dev-ros / cv_bridge : Converts between ROS Image messages and OpenCV images
dev-ros / depth_image_proc : Nodelets for processing depth images such as those produced by OpenNI camera
dev-ros / depthimage_to_laserscan : Converts a depth image to a laser scan for use with navigation and localization
dev-ros / dwa_local_planner : Dynamic Window Approach to local robot navigation on a plane
dev-ros / gazebo_msgs : Message and service data structures for interacting with Gazebo from ROS
dev-ros / gazebo_plugins : Robot-independent Gazebo plugins
dev-ros / geodesy : Python and C++ interfaces for manipulating geodetic coordinates
dev-ros / hector_compressed_map_transport : Means for transporting compressed map data through the use of image_transport
dev-ros / hector_imu_attitude_to_tf : Publish the roll/pitch attitude angles reported via a imu message to tf
dev-ros / hector_imu_tools : Tools for processing IMU messages
dev-ros / hector_pose_estimation : hector_pose_estimation node and the hector_pose_estimation nodelet
dev-ros / hector_pose_estimation_core : Extended Kalman Filter (EKF) that estimates the 6DOF pose of the robot
dev-ros / image_cb_detector : Extracts checkerboard corners from ROS images
dev-ros / image_geometry : C++ and Python libraries for interpreting images geometrically
dev-ros / image_proc : Single image rectification and color processing
dev-ros / image_publisher : Publish an image stream from single image file or avi file
dev-ros / image_transport : Transparent support for transporting images in low-bandwidth compressed formats
dev-ros / image_view : Simple viewer for ROS image topics
dev-ros / imu_complementary_filter : Fuses angular velocities, accelerations, and magnetic readings from an IMU
dev-ros / imu_filter_madgwick : Fuses angular velocities, accelerations, and magnetic readings from an IMU
dev-ros / imu_processors : Processors for sensor_msgs::Imu data
dev-ros / imu_transformer : Transforms sensor_msgs::Imu data from one frame into another
dev-ros / joint_state_publisher : Tool for setting and publishing joint state values for a given URDF
dev-ros / laser_assembler : Nodes to assemble point clouds from either LaserScan or PointCloud messages
dev-ros / laser_filters : Assorted filters designed to operate on 2D planar laser scanners
dev-ros / laser_geometry : Class for converting from a 2D laser scan into a point cloud
dev-ros / laser_proc : Converts representations of LaserScan and MultiEchoLaserScan
dev-ros / map_msgs : Messages commonly used in mapping packages
dev-ros / mavros : MAVLink extendable communication node for ROS
dev-ros / mavros_extras : Extra nodes and plugins for mavros
dev-ros / mavros_msgs : Messages for MAVROS
dev-ros / message_to_tf : Translates pose information from different kind of common message types to tf
dev-ros / moveit_msgs : Messages, services and actions used by MoveIt
dev-ros / navfn : Fast interpolated navigation function for creating plans for a mobile base
dev-ros / object_recognition_msgs : ROS message and the actionlib definition used in object_recognition_core
dev-ros / octomap_ros : Conversion functions between ROS / PCL and OctoMap's native types
dev-ros / openni2_camera : ROS drivers for the Asus Xtion and Primesense Devices
dev-ros / pcl_conversions : Provides conversions from PCL data types and ROS message types
dev-ros / pcl_msgs : PCL (Point Cloud Library)-related ROS messages
dev-ros / pcl_ros : PCL (Point Cloud Library) ROS interface stack
dev-ros / pointcloud_to_laserscan : Converts a 3D Point Cloud into a 2D laser scan
dev-ros / polled_camera : C++ classes for implementing a polled camera driver node
dev-ros / robot_localization : Package of nonlinear state estimation nodes
dev-ros / robot_pose_ekf : Estimate the 3D pose of a robot from pose measurements from various sources
dev-ros / robot_state_publisher : Package for publishing the state of a robot to tf
dev-ros / rosbridge_library : Core rosbridge package for parsing JSON and performing the appropriate action
dev-ros / rosserial_embeddedlinux : Libraries and examples for ROSserial usage on Embedded Linux Enviroments
dev-ros / rosserial_windows : Libraries and examples for ROSserial usage on Windows Platforms
dev-ros / rqt_bag_plugins : GUI plugin for displaying and replaying ROS bag files
dev-ros / rqt_image_view : GUI plugin for displaying images using image_transport
dev-ros / rqt_moveit : Assists monitoring tasks for MoveIt! motion planner
dev-ros / rviz : 3D visualization tool for ROS
dev-ros / stage_ros : ROS specific hooks and tools for the Stage simulator
dev-ros / stereo_image_proc : Stereo and single image rectification and disparity processing
dev-ros / stereo_msgs : Messages specific to stereo processing, such as disparity images
dev-ros / tf : Maintains the relationship between frames in a tree structure over time
dev-ros / tf2_sensor_msgs : Transform sensor_msgs with tf. Most notably, PointCloud2
dev-ros / urg_node : ROS wrapper for the Hokuyo urg_c library
dev-ros / visp_auto_tracker : Online automated pattern-based object tracker relying on visual servoing
dev-ros / visp_bridge : Converts between ROS structures and ViSP structures
dev-ros / visp_camera_calibration : Calibration of cameras using a customizable pattern and ViSP library
dev-ros / visp_hand2eye_calibration : Estimates the camera position with respect to its effector using ViSP
dev-ros / visp_tracker : Wraps the ViSP moving edge tracker provided by the ViSP library
ros-meta / common_msgs : Messages that are widely used by other ROS packages
Change logs
- Repository mirror & CI · gentoo
Merge updates from master - Alexis Ballier · gentoo
dev-ros/sensor_msgs: Bump to 1.13.1.
Package-Manager: Portage-3.0.14, Repoman-3.0.2 Signed-off-by: Alexis Ballier <aballier@gentoo.org> - Repository mirror & CI · gentoo
Merge updates from master - Alexis Ballier · gentoo
dev-ros/sensor_msgs: convert to python-single-r1
Package-Manager: Portage-3.0.1, Repoman-2.3.23 Signed-off-by: Alexis Ballier <aballier@gentoo.org> - Repository mirror & CI · gentoo
Merge updates from master - Alexis Ballier · gentoo
dev-ros/sensor_msgs: Remove old
Package-Manager: Portage-2.3.103, Repoman-2.3.23 Signed-off-by: Alexis Ballier <aballier@gentoo.org> - Alexis Ballier · gentoo
dev-ros/sensor_msgs: bump eapi
Package-Manager: Portage-2.3.103, Repoman-2.3.23 Signed-off-by: Alexis Ballier <aballier@gentoo.org> - Alexis Ballier · gentoo
dev-ros/sensor_msgs: Bump to 1.13.0.
Package-Manager: Portage-2.3.103, Repoman-2.3.23 Signed-off-by: Alexis Ballier <aballier@gentoo.org> - Repository mirror & CI · gentoo
Merge updates from master - Michał Górny · gentoo
*/*: Clean PYTHON_COMPAT of obsolete impls
Closes: https://github.com/gentoo/gentoo/pull/14246 Signed-off-by: Michał Górny <mgorny@gentoo.org> - Repository mirror & CI · gentoo
Merge updates from master - Michał Górny · gentoo
*/*: Remove python3_4 PYTHON_COMPAT correctly
Signed-off-by: Michał Górny <mgorny@gentoo.org> - Repository mirror & CI · gentoo
Merge updates from master - Alexis Ballier · gentoo
dev-ros/sensor_msgs: Bump to 1.12.7.
Package-Manager: Portage-2.3.52, Repoman-2.3.12 Signed-off-by: Alexis Ballier <aballier@gentoo.org> - Alexis Ballier · gentoo
dev-ros/sensor_msgs: Bump to 1.12.6.
Package-Manager: Portage-2.3.36, Repoman-2.3.9 - Alexis Ballier · gentoo
dev-ros/sensor_msgs: add rosunit test dep
Package-Manager: Portage-2.3.36, Repoman-2.3.9 - Robin H. Johnson · gentoo
Drop $Id$ per council decision in bug #611234.
Signed-off-by: Robin H. Johnson <robbat2@gentoo.org> - Alexis Ballier · gentoo
dev-ros/sensor_msgs: Add python 3.6, pypy/3 support
Package-Manager: Portage-2.3.3, Repoman-2.3.1 - Alexis Ballier · gentoo
dev-ros/sensor_msgs: remove old
Package-Manager: Portage-2.3.3, Repoman-2.3.1 - T. Malfatti · gentoo
media-libs/portaudio: Version bump - Michał Górny · gentoo
global: Drop dead implementations from PYTHON_COMPAT - Alexis Ballier · gentoo
dev-ros/sensor_msgs: Bump to 1.12.5.
Package-Manager: portage-2.3.1 - Alexis Ballier · gentoo
dev-ros/sensor_msgs: drop boost dep
Package-Manager: portage-2.2.27 Signed-off-by: Alexis Ballier <aballier@gentoo.org> - Alexis Ballier · gentoo
dev-ros/sensor_msgs: Bump to 1.12.4.
Package-Manager: portage-2.2.27 Signed-off-by: Alexis Ballier <aballier@gentoo.org> - Alexis Ballier · gentoo
dev-ros/sensor_msgs: add python 3.5 support
Package-Manager: portage-2.2.27 Signed-off-by: Alexis Ballier <aballier@gentoo.org> - Alexis Ballier · gentoo
dev-ros/sensor_msgs: Initial import. Ebuild by me.
Package-Manager: portage-2.2.21