rclcpp icon indicating copy to clipboard operation
rclcpp copied to clipboard

rclcpp (ROS Client Library for C++)

Results 317 rclcpp issues
Sort by recently updated
recently updated
newest added

E.g. trying to compile a call to `create_publisher` with a message type using a custom allocator fails since the corresponding typesupport symbol isn't specialized for the custom allocator type.

bug
backlog

Suggestion from @adolfo-rt: Currently the ordering of tasks in the single-threaded executor is not exposed to the user. It should be possible to implement a single-threaded executor in which task...

enhancement
backlog

The `ParameterVariant` class requires the name and value (and thus type) of the variable to be passed to the constructor. To make it easier to use, we should add `set_name()`...

enhancement
backlog

I have the following situation: a node has multiple subscriptions (input data) and a timer callback (processing). While all subscriptions are rather fast (just copy the input data) the processing...

## Bug report **Required Info:** - Operating System: Ubuntu 18 - Installation type: source - Version or commit hash: iron - DDS implementation: cyclone - Client library (if applicable): rclcpp...

## Feature request I wonder if `rclcpp` could support add/minus time with `msg::Time` on the left as caller. In the current delivery, ``` C++ std_msgs::msg::Header header; header.stamp = rclcpp::Duration::from_seconds(1) +...

enhancement
help wanted

## Feature request #### Feature description We(nauticus robotics) have gotten in the habit of using [backward_ros](https://github.com/pal-robotics/backward_ros) when building our packages because it gives us a nice console trace when one...

## Issue report Currently if there are 2 _(or more)_ clients with the same `/service_name`, both will get the server response (one will silently discard it after noticing it wasn't...

backlog

## Bug report **Required Info:** - Operating System: - Ubuntu 22.04 - Installation type: - binaries - Version or commit hash: - humble - DDS implementation: - - Client library...