Skip to content

Commit

Permalink
Merge pull request #1 from ijnek/patch-1
Browse files Browse the repository at this point in the history
Update barcode_reader_node.cpp
  • Loading branch information
ijnek authored Oct 22, 2021
2 parents 921a831 + d9720f9 commit ead60f7
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 @@ -76,7 +76,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 ead60f7

Please sign in to comment.