diff --git a/msg/BoundingBox2D.msg b/msg/BoundingBox2D.msg index e42f54d..85a306d 100644 --- a/msg/BoundingBox2D.msg +++ b/msg/BoundingBox2D.msg @@ -7,7 +7,7 @@ # 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 +# The total size (in pixels) of the bounding box surrounding the object relative # to the pose of its center. float64 size_x float64 size_y diff --git a/msg/BoundingBox3D.msg b/msg/BoundingBox3D.msg index 00713ad..cb8f49d 100644 --- a/msg/BoundingBox3D.msg +++ b/msg/BoundingBox3D.msg @@ -5,6 +5,6 @@ # The 3D position and orientation of the bounding box center geometry_msgs/Pose center -# The size of the bounding box, in meters, surrounding the object's center +# The total size of the bounding box, in meters, surrounding the object's center # pose. geometry_msgs/Vector3 size