Skip to content

Commit

Permalink
update warning message
Browse files Browse the repository at this point in the history
Signed-off-by: Kenji Brameld <kenjibrameld@gmail.com>
  • Loading branch information
ijnek committed Aug 20, 2022
1 parent 9babaea commit 29ec258
Showing 1 changed file with 6 additions and 3 deletions.
9 changes: 6 additions & 3 deletions zbar_ros/src/barcode_reader_node.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -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);
Expand Down

0 comments on commit 29ec258

Please sign in to comment.