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

### Description it is not uncommon to create or destroy either subscription or publisher when the parameter is updated. for example, having `/enable_data_generator` parameter in sensor node, and sensor node...

There may be a bug on node shutdown, when: ``` use_intra_process_comms: true start_parameter_services: true start_parameter_event_publisher: false ``` Here below the stacktrace: ``` #1 0x0000aaaaaf844e10 in std::_Sp_counted_base::_M_release (this=0xfffee806c8c0) at /usr/include/c++/11/bits/shared_ptr_base.h:168 #2...

more-information-needed

Avoid potential use after free usage of a registered subscription callback function by allowing user to specify a weak_ptr to be checked for expiry before the associated subscription callback is...

When I create sub-nodes using Node::create_sub_node() and then resolve a private name on this sub-node, the sub-namespace is ignored. ```cpp auto nh_left = this->create_sub_node( "left" ); std::string resolved_service_name = nh_left->get_node_base_interface()->resolve_topic_or_service_name(...

bug
help wanted

It was impossible to create a custom subscriber inherited from rclcpp::Subscriber, I fixed this bug and added a test to check correctness.

more-information-needed

## Bug report **Required Info:** - Operating System: Ubuntu 22.04 (using OSRF Ubuntu 24.04 docker) - Installation type: Binaries - Version or commit hash: Latest Rolling [29.3.0](https://github.com/ros2/rclcpp/releases/tag/29.3.0) - DDS implementation:...

## Feature request #### Feature description The current implementation of [EventHandlerBase::get_number_of_ready_events()](https://github.com/ros2/rclcpp/blob/a0a2a067d84fd6a38ab4f71b691d51ca5aa97ba5/rclcpp/src/rclcpp/event_handler.cpp#L51-L56) always returns `1`. This function was originally introduced in https://github.com/ros2/rclcpp/pull/695 and is only used in [rclcpp/test_qos_event](https://github.com/ros2/rclcpp/blob/88ebea94e9c79499c34f825cf6565827c5ba958e/rclcpp/test/rclcpp/test_qos_event.cpp#L316). However, having an...

This PR is part of the runtime interface reflection subscription feature of REP-2011: https://github.com/ros2/ros2/issues/1374 It's a rebased (and slightly modified version of https://github.com/ros2/rclcpp/pull/2077) # Description This PR includes support for...

Pull request addressing the issues in #2360 #2645. So far, I have added a test that detects starvation in the multi-threaded executor. This test includes a mutually-exclusive callback group with...

more-information-needed

This adds the rclcpp analogue of https://github.com/ros2/rcl/blob/rolling/rcl/src/rcl/type_description_conversions.c This provides a means to convert between the `rosidl_runtime_cpp` type description structs, and their corresponding `type_description_interfaces` messages. Needed to support the message introspection...