Skip to content

Commit

Permalink
Revert confusing comment about bbox orientation
Browse files Browse the repository at this point in the history
  • Loading branch information
Kukanani committed Jan 5, 2021
1 parent a69729c commit 8f289b0
Show file tree
Hide file tree
Showing 2 changed files with 4 additions and 6 deletions.
5 changes: 2 additions & 3 deletions msg/BoundingBox2D.msg
Original file line number Diff line number Diff line change
Expand Up @@ -7,8 +7,7 @@
# The 2D position (in pixels) and orientation of the bounding box center.
geometry_msgs/Pose2D center

# The total size (in pixels) of the bounding box surrounding the
# object. The X and Y axes are relative to the center pose
# (including rotation).
# 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
5 changes: 2 additions & 3 deletions msg/BoundingBox3D.msg
Original file line number Diff line number Diff line change
Expand Up @@ -5,7 +5,6 @@
# The 3D position and orientation of the bounding box center
geometry_msgs/Pose center

# The total size (in meters) of the bounding box surrounding the
# object. The X and Y axes are relative to the center pose
# (including orientation).
# The total size of the bounding box, in meters, surrounding the object's center
# pose.
geometry_msgs/Vector3 size

0 comments on commit 8f289b0

Please sign in to comment.