Skip to content

Conversation

CursedRock17
Copy link

@CursedRock17 CursedRock17 commented May 1, 2024

This pull request solves the demos side of this ros2_documentation issue in which we switch from std_msgs to example_interfaces because std_msgs was deprecated about 4 years ago.

Signed-off-by: CursedRock17 <[email protected]>
Signed-off-by: CursedRock17 <[email protected]>
Copy link
Collaborator

@fujitatomoya fujitatomoya left a comment

Choose a reason for hiding this comment

The reason will be displayed to describe this comment to others. Learn more.

lgtm with green CI

// (rclcpp::KeepLast(7) -> rclcpp::KeepAll() fails to compile)
rclcpp::QoS qos(rclcpp::KeepLast{7});
pub_ = this->create_publisher<std_msgs::msg::String>("chatter", qos);
pub_ = this->create_publisher<example_interfaces::msg::String>("chatter", qos);
Copy link
Collaborator

Choose a reason for hiding this comment

The reason will be displayed to describe this comment to others. Learn more.

this should resolve ros2/examples#377 (comment)

Copy link
Contributor

@ahcorde ahcorde left a comment

Choose a reason for hiding this comment

The reason will be displayed to describe this comment to others. Learn more.

  • Linux Build Status
  • Linux-aarch64 Build Status
  • Windows Build Status

Signed-off-by: Alejandro Hernández Cordero <[email protected]>
@ahcorde
Copy link
Contributor

ahcorde commented Oct 2, 2025

Pulls: #674
Gist: https://gist.githubusercontent.com/ahcorde/647d48e78542fa5bb1ad866e1ae5c07e/raw/bb2f4f496dd3a37c054d22668ba05be17a06e6a1/ros2.repos
BUILD args: --packages-above-and-dependencies composition demo_nodes_cpp demo_nodes_cpp_native demo_nodes_py image_tools intra_process_demo lifecycle lifecycle_py logging_demo quality_of_service_demo_cpp topic_monitor topic_statistics_demo
TEST args: --packages-above composition demo_nodes_cpp demo_nodes_cpp_native demo_nodes_py image_tools intra_process_demo lifecycle lifecycle_py logging_demo quality_of_service_demo_cpp topic_monitor topic_statistics_demo
ROS Distro: rolling
Job: ci_launcher
ci_launcher ran: https://ci.ros2.org/job/ci_launcher/17152

  • Linux Build Status
  • Linux-aarch64 Build Status
  • Linux-rhel Build Status
  • Windows Build Status

Sign up for free to join this conversation on GitHub. Already have an account? Sign in to comment
Labels
None yet
Projects
None yet
Development

Successfully merging this pull request may close these issues.

3 participants