File: vision_msgs/BoundingBox2D.msg
Raw Message Definition
# A 2D bounding box that can be rotated about its center.
# All dimensions are in pixels, but represented using floating-point
# values to allow sub-pixel precision. If an exact pixel crop is required
# for a rotated bounding box, it can be calculated using Bresenham's line
# algorithm.
# The 2D position (in pixels) and orientation of the bounding box center.
geometry_msgs/Pose2D center
# The size (in pixels) of the bounding box surrounding the object relative
# to the pose of its center.
float64 size_x
float64 size_y
Compact Message Definition