Skip to content

Commit

Permalink
Update barcode_reader_node.cpp
Browse files Browse the repository at this point in the history
Fix print formatting

Signed-off-by: ijnek <kenjibrameld@gmail.com>
  • Loading branch information
ijnek committed Aug 20, 2022
1 parent 3133790 commit eeb9e51
Showing 1 changed file with 1 addition and 1 deletion.
2 changes: 1 addition & 1 deletion zbar_ros/src/barcode_reader_node.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -90,7 +90,7 @@ void BarcodeReaderNode::imageCb(sensor_msgs::msg::Image::ConstSharedPtr image)
geometry_msgs::msg::Point point;
point.x = (*point_it).x;
point.y = (*point_it).y;
RCLCPP_DEBUG(get_logger(), " Point: %d, %d", point.x, point.y);
RCLCPP_DEBUG(get_logger(), " Point: %f, %f", point.x, point.y);
symbol.points.push_back(point);
}

Expand Down

0 comments on commit eeb9e51

Please sign in to comment.