Package Summary

Tags No category tags.
Version 4.1.1
License Apache License 2.0
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros-perception/vision_msgs.git
VCS Type git
VCS Version ros2
Last Updated 2024-01-23
Dev Status DEVELOPED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

Messages for interfacing with various computer vision pipelines, such as object detectors.

Additional Links

No additional links.

Maintainers

  • Adam Allevato
  • Adam Allevato

Authors

  • Adam Allevato
README
No README found. See repository README.
CHANGELOG

Changelog for package vision_msgs

4.0.0 (2022-03-19)

  • Merge pull request #67 from ijnek/ijnek-point-2d Add Point2d message, and use it in Pose2D
  • Update msg/Point2D.msg Co-authored-by: Adam Allevato <Kukanani@users.noreply.github.com>
  • add Point2D message
  • replace deprecated pose2d with pose (#64)

    • replace deprecated geometry_msgs/Pose2D with geometry_msgs/Pose
    • replace Pose2D with Pose.
    • add Pose2D.msg
    • undo some changes made

    * Update msg/Pose2D.msg Co-authored-by: Adam Allevato <Kukanani@users.noreply.github.com> Co-authored-by: Adam Allevato <Kukanani@users.noreply.github.com>

  • Clarify array messages in readme

  • Trailing newline in bbox2Darray

  • Add bbox array msgs to CMakeLists

  • Added BoundingBox2DArray message

  • Contributors: Adam Allevato, Fruchtzwerg94, Kenji Brameld

3.0.1 (2021-07-20)

  • Patch for how C++14 is set for ROS2 (#58)
  • Contributors: Dustin Franklin

3.0.0 (2021-04-13)

  • Add license snippet in CONTRIBUTING.md
  • Decouple source data from the detection/classification messages. (#53) * Decouple source data from the detection/classification messages. This commit drops dependency on sensor_msgs

    • Improved documentation.
  • Merge pull request #52 from mintar/clarify-class-object-id Rename tracking_id -> id, id -> class_id

  • Rename DetectionXD.tracking_id -> id

  • Rename ObjectHypothesis.id -> class_id

  • Merge pull request #51 from ros-perception/clarify-bbox-size Clarify comment for size fields in bounding box messages

  • Revert confusing comment about bbox orientation

  • Merge pull request #50 from ros-perception/remove-is-tracking-field Remove is_tracking field

  • Remove other mentions to is_tracking field

  • Clarify bbox size comment

  • Remove tracking_id from Detection3D as well

  • Remove is_tracking field This field does not seem useful, and we are not aware of anyone using it at this time. [VisionInfo]{.title-ref} is probably a better place for this information anyway, if it were needed. See #47 for earlier discussions.

  • Clarify: ObjectHypothesis[] ~= Classification (#49) * Clarify: ObjectHypothesis[] ~= Classification https://github.com/ros-perception/vision_msgs/issues/46 requested Array message types for ObjectHypothesis and/or ObjectHypothesisWithPose. As pointed out in the issue, these already exist in the form of the [ClassificationXD]{.title-ref} and [DetectionXD]{.title-ref} message types.

    • Clarify ObjectHypothesisWithPose[] ~= Detection
  • Use composition in ObjectHypothesisWithPose (#48)

  • Contributors: Adam Allevato, Martin G

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Recent questions tagged vision_msgs at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 4.1.1
License Apache License 2.0
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros-perception/vision_msgs.git
VCS Type git
VCS Version ros2
Last Updated 2024-01-23
Dev Status DEVELOPED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

Messages for interfacing with various computer vision pipelines, such as object detectors.

Additional Links

No additional links.

Maintainers

  • Adam Allevato
  • Adam Allevato

Authors

  • Adam Allevato
README
No README found. See repository README.
CHANGELOG

Changelog for package vision_msgs

4.0.0 (2022-03-19)

  • Merge pull request #67 from ijnek/ijnek-point-2d Add Point2d message, and use it in Pose2D
  • Update msg/Point2D.msg Co-authored-by: Adam Allevato <Kukanani@users.noreply.github.com>
  • add Point2D message
  • replace deprecated pose2d with pose (#64)

    • replace deprecated geometry_msgs/Pose2D with geometry_msgs/Pose
    • replace Pose2D with Pose.
    • add Pose2D.msg
    • undo some changes made

    * Update msg/Pose2D.msg Co-authored-by: Adam Allevato <Kukanani@users.noreply.github.com> Co-authored-by: Adam Allevato <Kukanani@users.noreply.github.com>

  • Clarify array messages in readme

  • Trailing newline in bbox2Darray

  • Add bbox array msgs to CMakeLists

  • Added BoundingBox2DArray message

  • Contributors: Adam Allevato, Fruchtzwerg94, Kenji Brameld

3.0.1 (2021-07-20)

  • Patch for how C++14 is set for ROS2 (#58)
  • Contributors: Dustin Franklin

3.0.0 (2021-04-13)

  • Add license snippet in CONTRIBUTING.md
  • Decouple source data from the detection/classification messages. (#53) * Decouple source data from the detection/classification messages. This commit drops dependency on sensor_msgs

    • Improved documentation.
  • Merge pull request #52 from mintar/clarify-class-object-id Rename tracking_id -> id, id -> class_id

  • Rename DetectionXD.tracking_id -> id

  • Rename ObjectHypothesis.id -> class_id

  • Merge pull request #51 from ros-perception/clarify-bbox-size Clarify comment for size fields in bounding box messages

  • Revert confusing comment about bbox orientation

  • Merge pull request #50 from ros-perception/remove-is-tracking-field Remove is_tracking field

  • Remove other mentions to is_tracking field

  • Clarify bbox size comment

  • Remove tracking_id from Detection3D as well

  • Remove is_tracking field This field does not seem useful, and we are not aware of anyone using it at this time. [VisionInfo]{.title-ref} is probably a better place for this information anyway, if it were needed. See #47 for earlier discussions.

  • Clarify: ObjectHypothesis[] ~= Classification (#49) * Clarify: ObjectHypothesis[] ~= Classification https://github.com/ros-perception/vision_msgs/issues/46 requested Array message types for ObjectHypothesis and/or ObjectHypothesisWithPose. As pointed out in the issue, these already exist in the form of the [ClassificationXD]{.title-ref} and [DetectionXD]{.title-ref} message types.

    • Clarify ObjectHypothesisWithPose[] ~= Detection
  • Use composition in ObjectHypothesisWithPose (#48)

  • Contributors: Adam Allevato, Martin G

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Recent questions tagged vision_msgs at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 4.1.1
License Apache License 2.0
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros-perception/vision_msgs.git
VCS Type git
VCS Version ros2
Last Updated 2024-01-23
Dev Status DEVELOPED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

Messages for interfacing with various computer vision pipelines, such as object detectors.

Additional Links

No additional links.

Maintainers

  • Adam Allevato
  • Adam Allevato

Authors

  • Adam Allevato
README
No README found. See repository README.
CHANGELOG

Changelog for package vision_msgs

4.0.0 (2022-03-19)

  • Merge pull request #67 from ijnek/ijnek-point-2d Add Point2d message, and use it in Pose2D
  • Update msg/Point2D.msg Co-authored-by: Adam Allevato <Kukanani@users.noreply.github.com>
  • add Point2D message
  • replace deprecated pose2d with pose (#64)

    • replace deprecated geometry_msgs/Pose2D with geometry_msgs/Pose
    • replace Pose2D with Pose.
    • add Pose2D.msg
    • undo some changes made

    * Update msg/Pose2D.msg Co-authored-by: Adam Allevato <Kukanani@users.noreply.github.com> Co-authored-by: Adam Allevato <Kukanani@users.noreply.github.com>

  • Clarify array messages in readme

  • Trailing newline in bbox2Darray

  • Add bbox array msgs to CMakeLists

  • Added BoundingBox2DArray message

  • Contributors: Adam Allevato, Fruchtzwerg94, Kenji Brameld

3.0.1 (2021-07-20)

  • Patch for how C++14 is set for ROS2 (#58)
  • Contributors: Dustin Franklin

3.0.0 (2021-04-13)

  • Add license snippet in CONTRIBUTING.md
  • Decouple source data from the detection/classification messages. (#53) * Decouple source data from the detection/classification messages. This commit drops dependency on sensor_msgs

    • Improved documentation.
  • Merge pull request #52 from mintar/clarify-class-object-id Rename tracking_id -> id, id -> class_id

  • Rename DetectionXD.tracking_id -> id

  • Rename ObjectHypothesis.id -> class_id

  • Merge pull request #51 from ros-perception/clarify-bbox-size Clarify comment for size fields in bounding box messages

  • Revert confusing comment about bbox orientation

  • Merge pull request #50 from ros-perception/remove-is-tracking-field Remove is_tracking field

  • Remove other mentions to is_tracking field

  • Clarify bbox size comment

  • Remove tracking_id from Detection3D as well

  • Remove is_tracking field This field does not seem useful, and we are not aware of anyone using it at this time. [VisionInfo]{.title-ref} is probably a better place for this information anyway, if it were needed. See #47 for earlier discussions.

  • Clarify: ObjectHypothesis[] ~= Classification (#49) * Clarify: ObjectHypothesis[] ~= Classification https://github.com/ros-perception/vision_msgs/issues/46 requested Array message types for ObjectHypothesis and/or ObjectHypothesisWithPose. As pointed out in the issue, these already exist in the form of the [ClassificationXD]{.title-ref} and [DetectionXD]{.title-ref} message types.

    • Clarify ObjectHypothesisWithPose[] ~= Detection
  • Use composition in ObjectHypothesisWithPose (#48)

  • Contributors: Adam Allevato, Martin G

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Recent questions tagged vision_msgs at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 3.0.2
License Apache License 2.0
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros-perception/vision_msgs.git
VCS Type git
VCS Version galactic
Last Updated 2023-07-26
Dev Status DEVELOPED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

Messages for interfacing with various computer vision pipelines, such as object detectors.

Additional Links

No additional links.

Maintainers

  • Adam Allevato
  • Adam Allevato

Authors

  • Adam Allevato
README
No README found. See repository README.
CHANGELOG

Changelog for package vision_msgs

3.0.2 (2022-03-20)

  • Build BoundingBox3DArray
  • Contributors: Adam Allevato

3.0.1 (2021-07-20)

  • Patch for how C++14 is set for ROS2 (#58)
  • Contributors: Dustin Franklin

3.0.0 (2021-04-13)

  • Add license snippet in CONTRIBUTING.md
  • Decouple source data from the detection/classification messages. (#53) * Decouple source data from the detection/classification messages. This commit drops dependency on sensor_msgs

    • Improved documentation.
  • Merge pull request #52 from mintar/clarify-class-object-id Rename tracking_id -> id, id -> class_id

  • Rename DetectionXD.tracking_id -> id

  • Rename ObjectHypothesis.id -> class_id

  • Merge pull request #51 from ros-perception/clarify-bbox-size Clarify comment for size fields in bounding box messages

  • Revert confusing comment about bbox orientation

  • Merge pull request #50 from ros-perception/remove-is-tracking-field Remove is_tracking field

  • Remove other mentions to is_tracking field

  • Clarify bbox size comment

  • Remove tracking_id from Detection3D as well

  • Remove is_tracking field This field does not seem useful, and we are not aware of anyone using it at this time. [VisionInfo]{.title-ref} is probably a better place for this information anyway, if it were needed. See #47 for earlier discussions.

  • Clarify: ObjectHypothesis[] ~= Classification (#49) * Clarify: ObjectHypothesis[] ~= Classification https://github.com/ros-perception/vision_msgs/issues/46 requested Array message types for ObjectHypothesis and/or ObjectHypothesisWithPose. As pointed out in the issue, these already exist in the form of the [ClassificationXD]{.title-ref} and [DetectionXD]{.title-ref} message types.

    • Clarify ObjectHypothesisWithPose[] ~= Detection
  • Use composition in ObjectHypothesisWithPose (#48)

  • Contributors: Adam Allevato, Martin G

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Recent questions tagged vision_msgs at Robotics Stack Exchange