vision_msgs package from vision_msgs repo

vision_msgs vision_msgs_rviz_plugins

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-07-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ünther, Martin Pecka, root

2.0.0 (2020-08-11)

  • Fix lint error for draconian header guard rule
  • Rename create_aabb to use C++ extension This fixes linting errors which assume that .h means that a file is C (rather than C++).
  • Add CONTRIBUTING.md
  • Fix various linting issues
  • Add gitignore Sync ros2 with master
  • Update test for ros2
  • add BoundingBox3DArray message (#30)
    • add BoundingBoxArray message
  • Make msg gen package deps more specific (#24) Make message_generation and message_runtime use more specific depend tags
  • Merge branch 'kinetic-devel'
  • Removed "proposal" from readme (#23)
  • add tracking ID to the Detection Message (#19)
    • add tracking ID to the Detection
    • modify comments
    • Change UUID messages to strings
    • Improve comment for tracking_id and fix whitespace
  • Convert id to string (#22)
  • Specify that id is explicitly for object class
  • Fix dependency of unit test. (#14)
  • 0.0.1
  • Pre-release commit - setting up versioning and changelog
  • Rolled BoundingRect into BoundingBox2D Added helper functions to make it easier to go from corner-size representation to center-size representation, plus associated tests.
  • Added license
  • Small fixes in message comments (#10)
  • Contributors: Adam Allevato, Leroy Rügemer, Martin Günther, Masaya Kataoka, Ronald Ensing, Shane Loretz, mistermult
  • Switched to ROS2 for package definition files, create_aabb, etc.
  • [ros2] use package format 3 (#12)
  • Contributors: Adam Allevato, Martin Günther, Mikael Arguedas, procopiostein

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Recent questions tagged vision_msgs at Robotics Stack Exchange

vision_msgs package from vision_msgs repo

vision_msgs vision_msgs_rviz_plugins

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-07-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ünther, Martin Pecka, root

2.0.0 (2020-08-11)

  • Fix lint error for draconian header guard rule
  • Rename create_aabb to use C++ extension This fixes linting errors which assume that .h means that a file is C (rather than C++).
  • Add CONTRIBUTING.md
  • Fix various linting issues
  • Add gitignore Sync ros2 with master
  • Update test for ros2
  • add BoundingBox3DArray message (#30)
    • add BoundingBoxArray message
  • Make msg gen package deps more specific (#24) Make message_generation and message_runtime use more specific depend tags
  • Merge branch 'kinetic-devel'
  • Removed "proposal" from readme (#23)
  • add tracking ID to the Detection Message (#19)
    • add tracking ID to the Detection
    • modify comments
    • Change UUID messages to strings
    • Improve comment for tracking_id and fix whitespace
  • Convert id to string (#22)
  • Specify that id is explicitly for object class
  • Fix dependency of unit test. (#14)
  • 0.0.1
  • Pre-release commit - setting up versioning and changelog
  • Rolled BoundingRect into BoundingBox2D Added helper functions to make it easier to go from corner-size representation to center-size representation, plus associated tests.
  • Added license
  • Small fixes in message comments (#10)
  • Contributors: Adam Allevato, Leroy Rügemer, Martin Günther, Masaya Kataoka, Ronald Ensing, Shane Loretz, mistermult
  • Switched to ROS2 for package definition files, create_aabb, etc.
  • [ros2] use package format 3 (#12)
  • Contributors: Adam Allevato, Martin Günther, Mikael Arguedas, procopiostein

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Recent questions tagged vision_msgs at Robotics Stack Exchange

vision_msgs package from vision_msgs repo

vision_msgs vision_msgs_rviz_plugins

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-07-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ünther, Martin Pecka, root

2.0.0 (2020-08-11)

  • Fix lint error for draconian header guard rule
  • Rename create_aabb to use C++ extension This fixes linting errors which assume that .h means that a file is C (rather than C++).
  • Add CONTRIBUTING.md
  • Fix various linting issues
  • Add gitignore Sync ros2 with master
  • Update test for ros2
  • add BoundingBox3DArray message (#30)
    • add BoundingBoxArray message
  • Make msg gen package deps more specific (#24) Make message_generation and message_runtime use more specific depend tags
  • Merge branch 'kinetic-devel'
  • Removed "proposal" from readme (#23)
  • add tracking ID to the Detection Message (#19)
    • add tracking ID to the Detection
    • modify comments
    • Change UUID messages to strings
    • Improve comment for tracking_id and fix whitespace
  • Convert id to string (#22)
  • Specify that id is explicitly for object class
  • Fix dependency of unit test. (#14)
  • 0.0.1
  • Pre-release commit - setting up versioning and changelog
  • Rolled BoundingRect into BoundingBox2D Added helper functions to make it easier to go from corner-size representation to center-size representation, plus associated tests.
  • Added license
  • Small fixes in message comments (#10)
  • Contributors: Adam Allevato, Leroy Rügemer, Martin Günther, Masaya Kataoka, Ronald Ensing, Shane Loretz, mistermult
  • Switched to ROS2 for package definition files, create_aabb, etc.
  • [ros2] use package format 3 (#12)
  • Contributors: Adam Allevato, Martin Günther, Mikael Arguedas, procopiostein

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Recent questions tagged vision_msgs at Robotics Stack Exchange

vision_msgs package from guyueclass repo

robot_hmi ros1_pyqt5_app class1_ros_qt_demo robot_voice xfei_robot double_arm_demo double_arm_description double_arm_moveit_config double_arm_teach marm_description marm_moveit_config marm_standardfirmata_driver fast_lio livox_ros_driver loam_livox r3live cam_laser_calib pcl_tutorials mbot_description mbot_gazebo mbot_navigation mbot_teleop hector_compressed_map_transport hector_geotiff hector_geotiff_plugins hector_imu_attitude_to_tf hector_imu_tools hector_map_server hector_map_tools hector_mapping hector_marker_drawing hector_nav_msgs hector_slam hector_slam_launch hector_trajectory_server probot_anno_moveit_config probot_demo probot_description probot_anno_ikfast_manipulator_plugin lidar_obstacle_detection qr_tf robot_vision tensorflow_object_detector vision_msgs probot_bringup industrial_core industrial_deprecated industrial_msgs industrial_robot_client industrial_robot_simulator industrial_trajectory_filters industrial_utils simple_message c800_description c800_moveit_config moveit_lerp_motion_planner learning_launch learning_parameter learning_service learning_tf learning_topic limo_base limo_bringup limo_demo limo_description limo_visions ares_description bringup racecar_description turtletrajectory fuzzypid pid_identification pid_tuning pigot_stl_model anymal_b_simple_description laikago_controller laikago_description laikago_gazebo laikago_msgs yobotics_description yobotics_gazebo yobotics_teleop mini_cheetah_urdf gazebo_pkg race_navigation teleop_twist_keyboard webots_controller webots_ros humanoid_msgs humanoid_nav_msgs op3_bringup op3_description op3_gui_demo op3_kinematics_dynamics op3_online_walking_module_msgs op3_walking_module op3_walking_module_msgs op3_webots_controller op3_webots_gui robotis_controller_msgs robotis_framework_common robotis_math

Package Summary

Tags No category tags.
Version 0.0.1
License Apache License 2.0
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/guyuehome/guyueclass.git
VCS Type git
VCS Version main
Last Updated 2024-10-11
Dev Status UNMAINTAINED
CI status No Continuous Integration
Released UNRELEASED
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

Authors

  • Adam Allevato

ROS Vision Messages

Introduction

This package defines a set of messages to unify computer vision and object detection efforts in ROS.

Overview

The messages in this package are to define a common outward-facing interface for vision-based pipelines. The set of messages here are meant to enable 2 primary types of pipelines:

  1. “Pure” Classifiers, which identify class probabilities given a single sensor input
  2. Detectors, which identify class probabilities as well as the poses of those classes given a sensor input

The class probabilities are stored with an array of ObjectHypothesis messages, which is essentially a map from integer IDs to float scores and poses.

Message types exist separately for 2D (using sensor_msgs/Image) and 3D (using sensor_msgs\PointCloud2). The metadata that is stored for each object is application-specific, and so this package places very few constraints on the metadata. Each possible detection result must have a unique numerical ID so that it can be unambiguously and efficiently identified in the results messages. Object metadata such as name, mesh, etc. can then be looked up from a database.

The only other requirement is that the metadata database information can be stored in a ROS parameter. We expect a classifier to load the database (or detailed database connection information) to the parameter server in a manner similar to how URDFs are loaded and stored there (see [6]), most likely defined in an XML format. This expectation may be further refined in the future using a ROS Enhancement Proposal, or REP [7].

We also would like classifiers to have a way to signal when the database has been updated, so that listeners can respond accordingly. The database might be updated in the case of online learning. To solve this problem, each classifier can publish messages to a topic signaling that the database has been updated, as well as incrementing a database version that’s continually published with the classifier information.

Messages

  • Classification2D and Classification3D: pure classification without pose
  • Detection2D and Detection3D: classification + pose
  • XArray messages, where X is one of the four message types listed above. A pipeline should emit XArray messages as its forward-facing ROS interface.
  • VisionInfo: Information about a classifier, such as its name and where to find its metadata database.
  • ObjectHypothesis: An id/score pair.
  • ObjectHypothesisWithPose: An id/(score, pose) pair. This accounts for the fact that a single input, say, a point cloud, could have different poses depdending on its class. For example, a flat rectangular prism could either be a smartphone lying on its back, or a book lying on its side.
  • BoundingBox2D, BoundingBox3D: orientable rectangular bounding boxes, specified by the pose of their center and their size.

By using a very general message definition, we hope to cover as many of the various computer vision use cases as possible. Some examples of use cases that can be fully represented are:

  • Bounding box multi-object detectors with tight bounding box predictions, such as YOLO [1]
  • Class-predicting full-image detectors, such as TensorFlow examples trained on the MNIST dataset [2]
  • Full 6D-pose recognition pipelines, such as LINEMOD [3] and those included in the Object Recognition Kitchen [4]
  • Custom detectors that use various point-cloud based features to predict object attributes (one example is [5])

Please see the vision_msgs_examples repository for some sample vision pipelines that emit results using the vision_msgs format.

References

CHANGELOG

Changelog for package vision_msgs

0.0.1 (2017-11-14)

  • Initial commit
  • Contributors: Adam Allevato, Martin Gunther, procopiostein

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Package Dependencies

System Dependencies

No direct system dependencies.

Dependant Packages

Name Deps
learned_lidar_detector
obj_tracker
mavros_interface
br2_tracking
br2_tracking
seek_and_capture_forocoches
recepcionist_forocoches
webots_ros2_driver
webots_ros2_msgs
bob_auxiliary
bob_image_processing
bob_interfaces
bob_recorder
bob_tracking
bob_visualizers
cloisim_ros_camera
tf_classification_py
tf_classification_py
tf_detection_py
tf_detection_py
tf_interfaces
tf_interfaces
tensorflow_object_detector
happypose_ros
ipm_interfaces
ipm_interfaces
ipm_library
ipm_library
isaac_manipulator_interfaces
isaac_manipulator_pick_and_place
isaac_manipulator_servers
isaac_ros_moveit_goal_setter
isaac_ros_vda5050_nav2_client
isaac_ros_nitros_detection2_d_array_type
isaac_ros_nitros_detection3_d_array_type
isaac_ros_detectnet
isaac_ros_rtdetr
isaac_ros_yolov8
isaac_ros_dope
isaac_ros_foundationpose
isaac_ros_pose_proc
kalman_supervisor
metadrive_example_bridge
metaurban_example_bridge
onboard_detector
nexus_common
nexus_detector_msgs
nexus_workcell_orchestrator
openbot_ros
openbot_rviz
opendr_perception
opendr_planning
opendr_simulation
pcdet_ros2
pcl_tutorial
rae_camera
rai_open_set_vision
rai_interfaces
ros2_nanoowl
ros2_nanollm
pp_infer
live_classifier
live_detection
trt_live_classifier
trt_live_detector
robottle
ur_palletization
sky360_image_processing
sky360_interfaces
sky360_monitoring
sky360_tracking
sky360_visualizers
vision_msgs_rviz_plugins
vox_nav_misc
vox_nav_utilities
camera_object_detection
depth_estimation
lidar_object_detection
camera_object_detection_msgs
hd_map
yolov5_isaac_ros
yolov5_ros2
yolov5_ros2
yolov9mit_ros
yolox_ros_cpp

Recent questions tagged vision_msgs at Robotics Stack Exchange

vision_msgs package from vision_msgs repo

vision_msgs

Package Summary

Tags No category tags.
Version 0.0.2
License Apache License 2.0
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/Kukanani/vision_msgs.git
VCS Type git
VCS Version noetic-devel
Last Updated 2022-04-09
Dev Status MAINTAINED
CI status
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

Authors

  • Adam Allevato

ROS Vision Messages

Introduction

This package defines a set of messages to unify computer vision and object detection efforts in ROS.

Overview

The messages in this package are to define a common outward-facing interface for vision-based pipelines. The set of messages here are meant to enable 2 primary types of pipelines:

  1. “Pure” Classifiers, which identify class probabilities given a single sensor input
  2. Detectors, which identify class probabilities as well as the poses of those classes given a sensor input

The class probabilities are stored with an array of ObjectHypothesis messages, which is essentially a map from integer IDs to float scores and poses.

Message types exist separately for 2D (using sensor_msgs/Image) and 3D (using sensor_msgs\PointCloud2). The metadata that is stored for each object is application-specific, and so this package places very few constraints on the metadata. Each possible detection result must have a unique numerical ID so that it can be unambiguously and efficiently identified in the results messages. Object metadata such as name, mesh, etc. can then be looked up from a database.

The only other requirement is that the metadata database information can be stored in a ROS parameter. We expect a classifier to load the database (or detailed database connection information) to the parameter server in a manner similar to how URDFs are loaded and stored there (see [6]), most likely defined in an XML format. This expectation may be further refined in the future using a ROS Enhancement Proposal, or REP [7].

We also would like classifiers to have a way to signal when the database has been updated, so that listeners can respond accordingly. The database might be updated in the case of online learning. To solve this problem, each classifier can publish messages to a topic signaling that the database has been updated, as well as incrementing a database version that’s continually published with the classifier information.

Messages

  • Classification2D and Classification3D: pure classification without pose.
  • BoundingBox2D, BoundingBox3D: orientable rectangular bounding boxes, specified by the pose of their center and their size.
  • Detection2D and Detection3D: classification + pose.
  • XArray messages, where X is one of the six message types listed above. A pipeline should emit XArray messages as its forward-facing ROS interface.
  • VisionInfo: Information about a classifier, such as its name and where to find its metadata database.
  • ObjectHypothesis: An id/score pair.
  • ObjectHypothesisWithPose: An id/(score, pose) pair. This accounts for the fact that a single input, say, a point cloud, could have different poses depdending on its class. For example, a flat rectangular prism could either be a smartphone lying on its back, or a book lying on its side.

By using a very general message definition, we hope to cover as many of the various computer vision use cases as possible. Some examples of use cases that can be fully represented are:

  • Bounding box multi-object detectors with tight bounding box predictions, such as YOLO [1]
  • Class-predicting full-image detectors, such as TensorFlow examples trained on the MNIST dataset [2]
  • Full 6D-pose recognition pipelines, such as LINEMOD [3] and those included in the Object Recognition Kitchen [4]
  • Custom detectors that use various point-cloud based features to predict object attributes (one example is [5])

Please see the vision_msgs_examples repository for some sample vision pipelines that emit results using the vision_msgs format.

References

CHANGELOG

Changelog for package vision_msgs

0.0.2 (2022-04-09)

  • Added BoundingBox2DArray message #60 from Fruchtzwerg94/array_for_2d_bounding_box
  • Upgrade CMake version to avoid CMP0048 warning
  • add BoundingBox3DArray message (#30)
    • add BoundingBoxArray message
  • Make message_generation and message_runtime use more specific depend tags (#24)
  • Fix dependency of unit test. (#14)
  • Minor bugfixes and code style updates
  • Contributors: Adam Allevato, Fruchtzwerg94, Leroy Rügemer, Masaya Kataoka, Ronald Ensing, mistermult

0.0.1 (2017-11-14)

  • Initial commit
  • Contributors: Adam Allevato, Martin Gunther, procopiostein

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Recent questions tagged vision_msgs at Robotics Stack Exchange

vision_msgs package from vision_msgs repo

vision_msgs vision_msgs_rviz_plugins

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/Kukanani/vision_msgs.git
VCS Type git
VCS Version ros2
Last Updated 2024-07-23
Dev Status MAINTAINED
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ünther, Martin Pecka, root

2.0.0 (2020-08-11)

  • Fix lint error for draconian header guard rule
  • Rename create_aabb to use C++ extension This fixes linting errors which assume that .h means that a file is C (rather than C++).
  • Add CONTRIBUTING.md
  • Fix various linting issues
  • Add gitignore Sync ros2 with master
  • Update test for ros2
  • add BoundingBox3DArray message (#30)
    • add BoundingBoxArray message
  • Make msg gen package deps more specific (#24) Make message_generation and message_runtime use more specific depend tags
  • Merge branch 'kinetic-devel'
  • Removed "proposal" from readme (#23)
  • add tracking ID to the Detection Message (#19)
    • add tracking ID to the Detection
    • modify comments
    • Change UUID messages to strings
    • Improve comment for tracking_id and fix whitespace
  • Convert id to string (#22)
  • Specify that id is explicitly for object class
  • Fix dependency of unit test. (#14)
  • 0.0.1
  • Pre-release commit - setting up versioning and changelog
  • Rolled BoundingRect into BoundingBox2D Added helper functions to make it easier to go from corner-size representation to center-size representation, plus associated tests.
  • Added license
  • Small fixes in message comments (#10)
  • Contributors: Adam Allevato, Leroy Rügemer, Martin Günther, Masaya Kataoka, Ronald Ensing, Shane Loretz, mistermult
  • Switched to ROS2 for package definition files, create_aabb, etc.
  • [ros2] use package format 3 (#12)
  • Contributors: Adam Allevato, Martin Günther, Mikael Arguedas, procopiostein

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Recent questions tagged vision_msgs at Robotics Stack Exchange

No version for distro bouncy. Known supported distros are highlighted in the buttons above.
No version for distro crystal. Known supported distros are highlighted in the buttons above.

vision_msgs package from vision_msgs repo

vision_msgs vision_msgs_rviz_plugins

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/Kukanani/vision_msgs.git
VCS Type git
VCS Version ros2
Last Updated 2024-07-23
Dev Status MAINTAINED
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ünther, Martin Pecka, root

2.0.0 (2020-08-11)

  • Fix lint error for draconian header guard rule
  • Rename create_aabb to use C++ extension This fixes linting errors which assume that .h means that a file is C (rather than C++).
  • Add CONTRIBUTING.md
  • Fix various linting issues
  • Add gitignore Sync ros2 with master
  • Update test for ros2
  • add BoundingBox3DArray message (#30)
    • add BoundingBoxArray message
  • Make msg gen package deps more specific (#24) Make message_generation and message_runtime use more specific depend tags
  • Merge branch 'kinetic-devel'
  • Removed "proposal" from readme (#23)
  • add tracking ID to the Detection Message (#19)
    • add tracking ID to the Detection
    • modify comments
    • Change UUID messages to strings
    • Improve comment for tracking_id and fix whitespace
  • Convert id to string (#22)
  • Specify that id is explicitly for object class
  • Fix dependency of unit test. (#14)
  • 0.0.1
  • Pre-release commit - setting up versioning and changelog
  • Rolled BoundingRect into BoundingBox2D Added helper functions to make it easier to go from corner-size representation to center-size representation, plus associated tests.
  • Added license
  • Small fixes in message comments (#10)
  • Contributors: Adam Allevato, Leroy Rügemer, Martin Günther, Masaya Kataoka, Ronald Ensing, Shane Loretz, mistermult
  • Switched to ROS2 for package definition files, create_aabb, etc.
  • [ros2] use package format 3 (#12)
  • Contributors: Adam Allevato, Martin Günther, Mikael Arguedas, procopiostein

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Recent questions tagged vision_msgs at Robotics Stack Exchange

vision_msgs package from vision_msgs repo

vision_msgs vision_msgs_rviz_plugins

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/Kukanani/vision_msgs.git
VCS Type git
VCS Version ros2
Last Updated 2024-07-23
Dev Status MAINTAINED
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ünther, Martin Pecka, root

2.0.0 (2020-08-11)

  • Fix lint error for draconian header guard rule
  • Rename create_aabb to use C++ extension This fixes linting errors which assume that .h means that a file is C (rather than C++).
  • Add CONTRIBUTING.md
  • Fix various linting issues
  • Add gitignore Sync ros2 with master
  • Update test for ros2
  • add BoundingBox3DArray message (#30)
    • add BoundingBoxArray message
  • Make msg gen package deps more specific (#24) Make message_generation and message_runtime use more specific depend tags
  • Merge branch 'kinetic-devel'
  • Removed "proposal" from readme (#23)
  • add tracking ID to the Detection Message (#19)
    • add tracking ID to the Detection
    • modify comments
    • Change UUID messages to strings
    • Improve comment for tracking_id and fix whitespace
  • Convert id to string (#22)
  • Specify that id is explicitly for object class
  • Fix dependency of unit test. (#14)
  • 0.0.1
  • Pre-release commit - setting up versioning and changelog
  • Rolled BoundingRect into BoundingBox2D Added helper functions to make it easier to go from corner-size representation to center-size representation, plus associated tests.
  • Added license
  • Small fixes in message comments (#10)
  • Contributors: Adam Allevato, Leroy Rügemer, Martin Günther, Masaya Kataoka, Ronald Ensing, Shane Loretz, mistermult
  • Switched to ROS2 for package definition files, create_aabb, etc.
  • [ros2] use package format 3 (#12)
  • Contributors: Adam Allevato, Martin Günther, Mikael Arguedas, procopiostein

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Recent questions tagged vision_msgs at Robotics Stack Exchange

vision_msgs package from vision_msgs repo

vision_msgs vision_msgs_rviz_plugins

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ünther, Martin Pecka, root

2.0.0 (2020-08-11)

  • Fix lint error for draconian header guard rule
  • Rename create_aabb to use C++ extension This fixes linting errors which assume that .h means that a file is C (rather than C++).
  • Add CONTRIBUTING.md
  • Fix various linting issues
  • Add gitignore Sync ros2 with master
  • Update test for ros2
  • add BoundingBox3DArray message (#30)
    • add BoundingBoxArray message
  • Make msg gen package deps more specific (#24) Make message_generation and message_runtime use more specific depend tags
  • Merge branch 'kinetic-devel'
  • Removed "proposal" from readme (#23)
  • add tracking ID to the Detection Message (#19)
    • add tracking ID to the Detection
    • modify comments
    • Change UUID messages to strings
    • Improve comment for tracking_id and fix whitespace
  • Convert id to string (#22)
  • Specify that id is explicitly for object class
  • Fix dependency of unit test. (#14)
  • 0.0.1
  • Pre-release commit - setting up versioning and changelog
  • Rolled BoundingRect into BoundingBox2D Added helper functions to make it easier to go from corner-size representation to center-size representation, plus associated tests.
  • Added license
  • Small fixes in message comments (#10)
  • Contributors: Adam Allevato, Leroy Rügemer, Martin Günther, Masaya Kataoka, Ronald Ensing, Shane Loretz, mistermult
  • Switched to ROS2 for package definition files, create_aabb, etc.
  • [ros2] use package format 3 (#12)
  • Contributors: Adam Allevato, Martin Günther, Mikael Arguedas, procopiostein

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Recent questions tagged vision_msgs at Robotics Stack Exchange

vision_msgs package from vision_msgs repo

vision_msgs vision_msgs_rviz_plugins

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/Kukanani/vision_msgs.git
VCS Type git
VCS Version ros2
Last Updated 2024-07-23
Dev Status MAINTAINED
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ünther, Martin Pecka, root

2.0.0 (2020-08-11)

  • Fix lint error for draconian header guard rule
  • Rename create_aabb to use C++ extension This fixes linting errors which assume that .h means that a file is C (rather than C++).
  • Add CONTRIBUTING.md
  • Fix various linting issues
  • Add gitignore Sync ros2 with master
  • Update test for ros2
  • add BoundingBox3DArray message (#30)
    • add BoundingBoxArray message
  • Make msg gen package deps more specific (#24) Make message_generation and message_runtime use more specific depend tags
  • Merge branch 'kinetic-devel'
  • Removed "proposal" from readme (#23)
  • add tracking ID to the Detection Message (#19)
    • add tracking ID to the Detection
    • modify comments
    • Change UUID messages to strings
    • Improve comment for tracking_id and fix whitespace
  • Convert id to string (#22)
  • Specify that id is explicitly for object class
  • Fix dependency of unit test. (#14)
  • 0.0.1
  • Pre-release commit - setting up versioning and changelog
  • Rolled BoundingRect into BoundingBox2D Added helper functions to make it easier to go from corner-size representation to center-size representation, plus associated tests.
  • Added license
  • Small fixes in message comments (#10)
  • Contributors: Adam Allevato, Leroy Rügemer, Martin Günther, Masaya Kataoka, Ronald Ensing, Shane Loretz, mistermult
  • Switched to ROS2 for package definition files, create_aabb, etc.
  • [ros2] use package format 3 (#12)
  • Contributors: Adam Allevato, Martin Günther, Mikael Arguedas, procopiostein

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Recent questions tagged vision_msgs at Robotics Stack Exchange

vision_msgs package from vision_msgs repo

vision_msgs vision_msgs_rviz_plugins

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-07-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ünther, Martin Pecka, root

2.0.0 (2020-08-11)

  • Fix lint error for draconian header guard rule
  • Rename create_aabb to use C++ extension This fixes linting errors which assume that .h means that a file is C (rather than C++).
  • Add CONTRIBUTING.md
  • Fix various linting issues
  • Add gitignore Sync ros2 with master
  • Update test for ros2
  • add BoundingBox3DArray message (#30)
    • add BoundingBoxArray message
  • Make msg gen package deps more specific (#24) Make message_generation and message_runtime use more specific depend tags
  • Merge branch 'kinetic-devel'
  • Removed "proposal" from readme (#23)
  • add tracking ID to the Detection Message (#19)
    • add tracking ID to the Detection
    • modify comments
    • Change UUID messages to strings
    • Improve comment for tracking_id and fix whitespace
  • Convert id to string (#22)
  • Specify that id is explicitly for object class
  • Fix dependency of unit test. (#14)
  • 0.0.1
  • Pre-release commit - setting up versioning and changelog
  • Rolled BoundingRect into BoundingBox2D Added helper functions to make it easier to go from corner-size representation to center-size representation, plus associated tests.
  • Added license
  • Small fixes in message comments (#10)
  • Contributors: Adam Allevato, Leroy Rügemer, Martin Günther, Masaya Kataoka, Ronald Ensing, Shane Loretz, mistermult
  • Switched to ROS2 for package definition files, create_aabb, etc.
  • [ros2] use package format 3 (#12)
  • Contributors: Adam Allevato, Martin Günther, Mikael Arguedas, procopiostein

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Recent questions tagged vision_msgs at Robotics Stack Exchange

vision_msgs package from vision_msgs repo

vision_msgs

Package Summary

Tags No category tags.
Version 0.0.1
License Apache License 2.0
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/Kukanani/vision_msgs.git
VCS Type git
VCS Version lunar-devel
Last Updated 2017-11-14
Dev Status MAINTAINED
CI status 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

Authors

  • Adam Allevato

ROS Vision Messages

Introduction

This package defines a set of messages to unify computer vision and object detection efforts in ROS.

Overview

The messages in this package are to define a common outward-facing interface for vision-based pipelines. The set of messages here are meant to enable 2 primary types of pipelines:

  1. “Pure” Classifiers, which identify class probabilities given a single sensor input
  2. Detectors, which identify class probabilities as well as the poses of those classes given a sensor input

The class probabilities are stored with an array of ObjectHypothesis messages, which is essentially a map from integer IDs to float scores and poses.

Message types exist separately for 2D (using sensor_msgs/Image) and 3D (using sensor_msgs\PointCloud2). The metadata that is stored for each object is application-specific, and so this package places very few constraints on the metadata. Each possible detection result must have a unique numerical ID so that it can be unambiguously and efficiently identified in the results messages. Object metadata such as name, mesh, etc. can then be looked up from a database.

The only other requirement is that the metadata database information can be stored in a ROS parameter. We expect a classifier to load the database (or detailed database connection information) to the parameter server in a manner similar to how URDFs are loaded and stored there (see [6]), most likely defined in an XML format. This expectation may be further refined in the future using a ROS Enhancement Proposal, or REP [7].

We also would like classifiers to have a way to signal when the database has been updated, so that listeners can respond accordingly. The database might be updated in the case of online learning. To solve this problem, each classifier can publish messages to a topic signaling that the database has been updated, as well as incrementing a database version that’s continually published with the classifier information.

Messages

  • Classification2D and Classification3D: pure classification without pose
  • Detection2D and Detection3D: classification + pose
  • XArray messages, where X is one of the four message types listed above. A pipeline should emit XArray messages as its forward-facing ROS interface.
  • VisionInfo: Information about a classifier, such as its name and where to find its metadata database.
  • ObjectHypothesis: An id/score pair.
  • ObjectHypothesisWithPose: An id/(score, pose) pair. This accounts for the fact that a single input, say, a point cloud, could have different poses depdending on its class. For example, a flat rectangular prism could either be a smartphone lying on its back, or a book lying on its side.
  • BoundingBox2D, BoundingBox3D: orientable rectangular bounding boxes, specified by the pose of their center and their size.

By using a very general message definition, we hope to cover as many of the various computer vision use cases as possible. Some examples of use cases that can be fully represented are:

  • Bounding box multi-object detectors with tight bounding box predictions, such as YOLO [1]
  • Class-predicting full-image detectors, such as TensorFlow examples trained on the MNIST dataset [2]
  • Full 6D-pose recognition pipelines, such as LINEMOD [3] and those included in the Object Recognition Kitchen [4]
  • Custom detectors that use various point-cloud based features to predict object attributes (one example is [5])

Please see the vision_msgs_examples repository for some sample vision pipelines that emit results using the vision_msgs format.

References

CHANGELOG

Changelog for package vision_msgs

0.0.1 (2017-11-14)

  • Initial commit
  • Contributors: Adam Allevato, Martin Gunther, procopiostein

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Package Dependencies

System Dependencies

No direct system dependencies.

Dependant Packages

No known dependants.

Recent questions tagged vision_msgs at Robotics Stack Exchange

No version for distro jade. Known supported distros are highlighted in the buttons above.
No version for distro indigo. Known supported distros are highlighted in the buttons above.
No version for distro hydro. Known supported distros are highlighted in the buttons above.

vision_msgs package from vision_msgs repo

vision_msgs

Package Summary

Tags No category tags.
Version 0.0.1
License Apache License 2.0
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/Kukanani/vision_msgs.git
VCS Type git
VCS Version kinetic-devel
Last Updated 2020-12-09
Dev Status MAINTAINED
CI status 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

Authors

  • Adam Allevato

ROS Vision Messages

Introduction

This package defines a set of messages to unify computer vision and object detection efforts in ROS.

Overview

The messages in this package are to define a common outward-facing interface for vision-based pipelines. The set of messages here are meant to enable 2 primary types of pipelines:

  1. “Pure” Classifiers, which identify class probabilities given a single sensor input
  2. Detectors, which identify class probabilities as well as the poses of those classes given a sensor input

The class probabilities are stored with an array of ObjectHypothesis messages, which is essentially a map from integer IDs to float scores and poses.

Message types exist separately for 2D (using sensor_msgs/Image) and 3D (using sensor_msgs\PointCloud2). The metadata that is stored for each object is application-specific, and so this package places very few constraints on the metadata. Each possible detection result must have a unique numerical ID so that it can be unambiguously and efficiently identified in the results messages. Object metadata such as name, mesh, etc. can then be looked up from a database.

The only other requirement is that the metadata database information can be stored in a ROS parameter. We expect a classifier to load the database (or detailed database connection information) to the parameter server in a manner similar to how URDFs are loaded and stored there (see [6]), most likely defined in an XML format. This expectation may be further refined in the future using a ROS Enhancement Proposal, or REP [7].

We also would like classifiers to have a way to signal when the database has been updated, so that listeners can respond accordingly. The database might be updated in the case of online learning. To solve this problem, each classifier can publish messages to a topic signaling that the database has been updated, as well as incrementing a database version that’s continually published with the classifier information.

Messages

  • Classification2D and Classification3D: pure classification without pose
  • Detection2D and Detection3D: classification + pose
  • XArray messages, where X is one of the four message types listed above. A pipeline should emit XArray messages as its forward-facing ROS interface.
  • VisionInfo: Information about a classifier, such as its name and where to find its metadata database.
  • ObjectHypothesis: An id/score pair.
  • ObjectHypothesisWithPose: An id/(score, pose) pair. This accounts for the fact that a single input, say, a point cloud, could have different poses depdending on its class. For example, a flat rectangular prism could either be a smartphone lying on its back, or a book lying on its side.
  • BoundingBox2D, BoundingBox3D: orientable rectangular bounding boxes, specified by the pose of their center and their size.

By using a very general message definition, we hope to cover as many of the various computer vision use cases as possible. Some examples of use cases that can be fully represented are:

  • Bounding box multi-object detectors with tight bounding box predictions, such as YOLO [1]
  • Class-predicting full-image detectors, such as TensorFlow examples trained on the MNIST dataset [2]
  • Full 6D-pose recognition pipelines, such as LINEMOD [3] and those included in the Object Recognition Kitchen [4]
  • Custom detectors that use various point-cloud based features to predict object attributes (one example is [5])

Please see the vision_msgs_examples repository for some sample vision pipelines that emit results using the vision_msgs format.

References

CHANGELOG

Changelog for package vision_msgs

0.0.1 (2017-11-14)

  • Initial commit
  • Contributors: Adam Allevato, Martin Gunther, procopiostein

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Package Dependencies

System Dependencies

No direct system dependencies.

Recent questions tagged vision_msgs at Robotics Stack Exchange

vision_msgs package from vision_msgs repo

vision_msgs

Package Summary

Tags No category tags.
Version 0.0.1
License Apache License 2.0
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/Kukanani/vision_msgs.git
VCS Type git
VCS Version melodic-devel
Last Updated 2017-11-14
Dev Status MAINTAINED
CI status
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

Authors

  • Adam Allevato

ROS Vision Messages

Introduction

This package defines a set of messages to unify computer vision and object detection efforts in ROS.

Overview

The messages in this package are to define a common outward-facing interface for vision-based pipelines. The set of messages here are meant to enable 2 primary types of pipelines:

  1. “Pure” Classifiers, which identify class probabilities given a single sensor input
  2. Detectors, which identify class probabilities as well as the poses of those classes given a sensor input

The class probabilities are stored with an array of ObjectHypothesis messages, which is essentially a map from integer IDs to float scores and poses.

Message types exist separately for 2D (using sensor_msgs/Image) and 3D (using sensor_msgs\PointCloud2). The metadata that is stored for each object is application-specific, and so this package places very few constraints on the metadata. Each possible detection result must have a unique numerical ID so that it can be unambiguously and efficiently identified in the results messages. Object metadata such as name, mesh, etc. can then be looked up from a database.

The only other requirement is that the metadata database information can be stored in a ROS parameter. We expect a classifier to load the database (or detailed database connection information) to the parameter server in a manner similar to how URDFs are loaded and stored there (see [6]), most likely defined in an XML format. This expectation may be further refined in the future using a ROS Enhancement Proposal, or REP [7].

We also would like classifiers to have a way to signal when the database has been updated, so that listeners can respond accordingly. The database might be updated in the case of online learning. To solve this problem, each classifier can publish messages to a topic signaling that the database has been updated, as well as incrementing a database version that’s continually published with the classifier information.

Messages

  • Classification2D and Classification3D: pure classification without pose
  • Detection2D and Detection3D: classification + pose
  • XArray messages, where X is one of the four message types listed above. A pipeline should emit XArray messages as its forward-facing ROS interface.
  • VisionInfo: Information about a classifier, such as its name and where to find its metadata database.
  • ObjectHypothesis: An id/score pair.
  • ObjectHypothesisWithPose: An id/(score, pose) pair. This accounts for the fact that a single input, say, a point cloud, could have different poses depdending on its class. For example, a flat rectangular prism could either be a smartphone lying on its back, or a book lying on its side.
  • BoundingBox2D, BoundingBox3D: orientable rectangular bounding boxes, specified by the pose of their center and their size.

By using a very general message definition, we hope to cover as many of the various computer vision use cases as possible. Some examples of use cases that can be fully represented are:

  • Bounding box multi-object detectors with tight bounding box predictions, such as YOLO [1]
  • Class-predicting full-image detectors, such as TensorFlow examples trained on the MNIST dataset [2]
  • Full 6D-pose recognition pipelines, such as LINEMOD [3] and those included in the Object Recognition Kitchen [4]
  • Custom detectors that use various point-cloud based features to predict object attributes (one example is [5])

Please see the vision_msgs_examples repository for some sample vision pipelines that emit results using the vision_msgs format.

References

CHANGELOG

Changelog for package vision_msgs

0.0.1 (2017-11-14)

  • Initial commit
  • Contributors: Adam Allevato, Martin Gunther, procopiostein

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Package Dependencies

System Dependencies

No direct system dependencies.

Recent questions tagged vision_msgs at Robotics Stack Exchange