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

### Operating System: Ubuntu 24 ### ROS version or commit hash: Jazzy ### RMW implementation (if applicable): fastrtps ### RMW Configuration (if applicable): N/A ### Client library (if applicable): rclcpp...

bug

Hi, I recently found an issue with the EventsExecutor relating to timers. If a timer callback is running slower than its period then it will create multiple timer events inside...

Hello, I have a `rclcpp::TimerBase::SharedPtr timer_i2c;` in my code, which I instantiate by `timer_i2c = this->create_wall_timer(1000ms / params_uint8[PARAM_UPDATE_RATE], std::bind(&ROSRider::timer_i2c_callback, this));` However while testing with jazzy I have found out the...

more-information-needed

# Description This is a consistent regression in windows release and windows repeated Reference build: * https://ci.ros2.org/job/nightly_win_rel/3337/ * https://ci.ros2.org/job/nightly_win_rep/3643/ Test regressions: * [rclcpp.test_executor.gtest.missing_result](https://ci.ros2.org/job/nightly_win_rel/3337/testReport/(root)/rclcpp/test_executor_gtest_missing_result/) * [projectroot.test.rclcpp.test_executors_busy_waiting](https://ci.ros2.org/job/nightly_win_rel/3337/testReport/projectroot.test/rclcpp/test_executors_busy_waiting/) Log output: ``` Running main()...

help wanted

When you enable topicstatistics, the `/statistics` messages that are published only contain the node's name, not the subscription/topic - so when you turn on this feature for a node with...

help wanted

Relevant issue here: https://github.com/luxonis/depthai-ros/issues/657 Short description: When using a service for resetting the driver's state (mostly cleaning up classes that have publishers inside them), the driver has a high chance...

more-information-needed

It feels like deadline QoS may be an interesting option for action feedback, but there seem to be no api to specify QoS event callbacks.

help wanted