From 29ec25828da43f8d5638fb7f94e3da2bac3942ee Mon Sep 17 00:00:00 2001 From: Kenji Brameld Date: Sun, 21 Aug 2022 07:23:44 +0900 Subject: [PATCH] update warning message Signed-off-by: Kenji Brameld --- zbar_ros/src/barcode_reader_node.cpp | 9 ++++++--- 1 file changed, 6 insertions(+), 3 deletions(-) diff --git a/zbar_ros/src/barcode_reader_node.cpp b/zbar_ros/src/barcode_reader_node.cpp index 59f8aa7..5a27811 100644 --- a/zbar_ros/src/barcode_reader_node.cpp +++ b/zbar_ros/src/barcode_reader_node.cpp @@ -133,9 +133,12 @@ void BarcodeReaderNode::imageCb(sensor_msgs::msg::Image::ConstSharedPtr image) static bool alreadyWarnedDeprecation = false; if (!alreadyWarnedDeprecation && count_subscribers("barcode") > 0) { alreadyWarnedDeprecation = true; - RCLCPP_WARN(get_logger(), "A subscription was detected on the deprecated 'barcode'" - "topic. Please subscribe to the new 'symbol' topic with type" - "'zbar_ros_interfaces::msg::Symbol'."); + RCLCPP_WARN( + get_logger(), + "A subscription was detected on the deprecated topic 'barcode'. Please update the node " + "that is subscribing to use the new topic 'symbol' with type " + "'zbar_ros_interfaces::msg::Symbol' instead. The 'barcode' topic will be removed " + "in the next distribution."); } zbar_image.set_data(NULL, 0);