Bug report
Required Info:
- Operating System:
- Installation type:
- Version or commit hash:
- DDS implementation:
- Client library (if applicable):
Steps to reproduce issue
In rclcpp node, send static TF using tf2_ros::StaticTransformBroadcaster::sendTransform(). The function was invoked only once, since the TF is unchanged. The observation is the msg was not received by a later subscription. This behavior differs from ROS1.
Try to instanciate the rclcpp node with below QoS profile, problem still observed.
- rclcpp::Qos(rclcpp::KeepLast(1))
- rclcpp::Qos(rclcpp::KeepLast(10))
- rclcpp::Qos(rclcpp::KeepAll())
Please can you suggest any other parameters may lead to the problematic result?
Expected behavior
The static msg was kept for later subscription
Actual behavior
The static msg was not received in later subscription