Package Summary
Tags | No category tags. |
Version | 1.12.0 |
License | Apache 2 |
Build type | CATKIN |
Use | RECOMMENDED |
Repository Summary
Description | autoware.ai perf |
Checkout URI | https://github.com/is-whale/autoware_learn.git |
VCS Type | git |
VCS Version | 1.14 |
Last Updated | 2025-03-14 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | No category tags. |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- Abraham Monrroy
Authors
Range Vision Fusion
The Range Vision Fusion node will try match the objects detected on a range sensor, with the ones obtained from a vision detector. A match will be considered found if the 3D projection of the object overlaps at least 50% (configurable) over the 2D object detection. The label from the 2D Image detector will be attached to the corresponding 3D Object. All the matched results will be published.
Requirements
Input Topics
- Camera intrinsics (
sensor_msgs/CameraInfo
) - Camera-LiDAR extrinsics (
tf
) - Object Detections results from a Vision Detector (
autoware_msgs/DetectedObjectArray
) - Object Detections results from a Range Detector (
autoware_msgs/DetectedObjectArray
)
Output Topics
- Fused Detected Objects (
autoware_msgs/DetectedObjectArray
) on the/detection/fusion_tools/objects
topic.
Parameters
Launch file available parameters:
Parameter | Type | Description | Default |
---|---|---|---|
detected_objects_range |
String | Name of the DetectedObjectArray topic to subscribe containing the detections on 3D space. |
/detection/lidar_objects |
detected_objects_vision |
String | Name of the DetectedObjectArray topic to subscribe containing the detections on 2D space. |
/detection/vision_objects |
camera_info_src |
String | Name of the CameraInfo topic that contains the intrinsic matrix for the Image. | /camera_info |
sync_topics |
Bool | Sync detection topics. | false |
min_car_dimensions |
Array | Sets the minimum dimensions for a car bounding box(width, height, depth) in meters. | [2,2,4] |
min_person_dimensions |
Array | Sets the minimum dimensions for a person bounding box (width, height, depth) in meters. | [1,2,1] |
min_truck_dimensions |
Array | Sets the minimum dimensions for a truck/bus bounding box (width, height, depth) in meters. | [2,2,4.5] |
overlap_threshold |
float | A number between 0.1 and 1.0 representing the area of overlap between the detections. | 0.5 |
Example of usage
- Launch a ground filter algorithm from the
Points Preprocessor
in the Sensing tab. (adjust the parameters to your vehicle setup). - Launch Calibration Publisher with the intrinsic and extrinsic calibration between the camera and the range sensor.
- Launch a Vision Detector from the Computing tab (this should be publishing by default
/detectoion/vision_objects
). - Launch a Lidar Detector from the Computing tab (this should be publishing by default
/detectoion/lidar_objects
). - Launch this node.
- Launch
rviz
, and add the topics shown above in the Output section.
Notes
- Detection on Image space should be performed on a Rectified Image, otherwise projection will be incorrect.
- The names of the classes are defined as in the COCO dataset.
Changelog for package range_vision_fusion
1.11.0 (2019-03-21)
- [fix] Install commands for all the packages
(#1861)
-
Initial fixes to detection, sensing, semantics and utils
-
fixing wrong filename on install command
-
Fixes to install commands
-
Hokuyo fix name
-
Fix obj db
-
Obj db include fixes
-
End of final cleaning sweep
-
Incorrect command order in runtime manager
-
Param tempfile not required by runtime_manager
-
- Fixes to runtime manager install commands
-
Remove devel directory from catkin, if any
-
Updated launch files for robosense
-
Updated robosense
-
Fix/add missing install (#1977)
-
Added launch install to lidar_kf_contour_track
-
Added install to op_global_planner
-
Added install to way_planner
-
Added install to op_local_planner
-
Added install to op_simulation_package
-
Added install to op_utilities
-
Added install to sync
-
- Improved installation script for pointgrey packages
-
Fixed nodelet error for gmsl cameras
-
USe install space in catkin as well
-
add install to catkin
-
Fix install directives (#1990)
-
Fixed installation path
-
Fixed params installation path
-
Fixed cfg installation path
- Delete cache on colcon_release
-
- Fix license notice in corresponding package.xml
- Adaptation of Object Filter with new perception workflow
- Initial release of object filter
- Contributors: Abraham Monrroy, Abraham Monrroy Cano, amc-nu
1.10.0 (2019-01-17)
- Fixes for catkin_make
- Switch to Apache 2 license (develop branch)
(#1741)
- Switch to Apache 2
* Replace BSD-3 license header with Apache 2 and reassign copyright to the Autoware Foundation.
- Update license on Python files
- Update copyright years
- Add #ifndef/define _POINTS_IMAGE_H_
- Updated license comment
- Use colcon as the build tool
(#1704)
- Switch to colcon as the build tool instead of catkin
- Added cmake-target
- Added note about the second colcon call
- Added warning about catkin* scripts being deprecated
- Fix COLCON_OPTS
- Added install targets
- Update Docker image tags
- Message packages fixes
- Fix missing dependency
- Feature/perception visualization cleanup
(#1648)
-
- Initial commit for visualization package
-
File truncated at 100 lines see the full file
Package Dependencies
Deps | Name |
---|---|
autoware_build_flags | |
catkin | |
autoware_msgs | |
cv_bridge | |
eigen_conversions | |
image_geometry | |
image_transport | |
jsk_recognition_utils | |
jsk_topic_tools | |
roscpp | |
sensor_msgs | |
tf | |
tf_conversions |
System Dependencies
Name |
---|
yaml-cpp |
Dependant Packages
Launch files
- launch/range_vision_fusion.launch
-
- detected_objects_range [default: /detection/lidar_detector/objects]
- detected_objects_vision [default: /detection/image_detector/objects]
- camera_info_src [default: /camera_info]
- min_car_dimensions [default: [3,2,2]]
- min_person_dimensions [default: [1,2,1]]
- min_truck_dimensions [default: [4,2,2]]
- sync_topics [default: false]
- overlap_threshold [default: 0.6]
- use_vector_map [default: false]
- namespace [default: /detection/fusion_tools]
Messages
Services
Plugins
Recent questions tagged range_vision_fusion at Robotics Stack Exchange
Package Summary
Tags | No category tags. |
Version | 1.12.0 |
License | Apache 2 |
Build type | CATKIN |
Use | RECOMMENDED |
Repository Summary
Description | autoware.ai perf |
Checkout URI | https://github.com/is-whale/autoware_learn.git |
VCS Type | git |
VCS Version | 1.14 |
Last Updated | 2025-03-14 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | No category tags. |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- Abraham Monrroy
Authors
Range Vision Fusion
The Range Vision Fusion node will try match the objects detected on a range sensor, with the ones obtained from a vision detector. A match will be considered found if the 3D projection of the object overlaps at least 50% (configurable) over the 2D object detection. The label from the 2D Image detector will be attached to the corresponding 3D Object. All the matched results will be published.
Requirements
Input Topics
- Camera intrinsics (
sensor_msgs/CameraInfo
) - Camera-LiDAR extrinsics (
tf
) - Object Detections results from a Vision Detector (
autoware_msgs/DetectedObjectArray
) - Object Detections results from a Range Detector (
autoware_msgs/DetectedObjectArray
)
Output Topics
- Fused Detected Objects (
autoware_msgs/DetectedObjectArray
) on the/detection/fusion_tools/objects
topic.
Parameters
Launch file available parameters:
Parameter | Type | Description | Default |
---|---|---|---|
detected_objects_range |
String | Name of the DetectedObjectArray topic to subscribe containing the detections on 3D space. |
/detection/lidar_objects |
detected_objects_vision |
String | Name of the DetectedObjectArray topic to subscribe containing the detections on 2D space. |
/detection/vision_objects |
camera_info_src |
String | Name of the CameraInfo topic that contains the intrinsic matrix for the Image. | /camera_info |
sync_topics |
Bool | Sync detection topics. | false |
min_car_dimensions |
Array | Sets the minimum dimensions for a car bounding box(width, height, depth) in meters. | [2,2,4] |
min_person_dimensions |
Array | Sets the minimum dimensions for a person bounding box (width, height, depth) in meters. | [1,2,1] |
min_truck_dimensions |
Array | Sets the minimum dimensions for a truck/bus bounding box (width, height, depth) in meters. | [2,2,4.5] |
overlap_threshold |
float | A number between 0.1 and 1.0 representing the area of overlap between the detections. | 0.5 |
Example of usage
- Launch a ground filter algorithm from the
Points Preprocessor
in the Sensing tab. (adjust the parameters to your vehicle setup). - Launch Calibration Publisher with the intrinsic and extrinsic calibration between the camera and the range sensor.
- Launch a Vision Detector from the Computing tab (this should be publishing by default
/detectoion/vision_objects
). - Launch a Lidar Detector from the Computing tab (this should be publishing by default
/detectoion/lidar_objects
). - Launch this node.
- Launch
rviz
, and add the topics shown above in the Output section.
Notes
- Detection on Image space should be performed on a Rectified Image, otherwise projection will be incorrect.
- The names of the classes are defined as in the COCO dataset.
Changelog for package range_vision_fusion
1.11.0 (2019-03-21)
- [fix] Install commands for all the packages
(#1861)
-
Initial fixes to detection, sensing, semantics and utils
-
fixing wrong filename on install command
-
Fixes to install commands
-
Hokuyo fix name
-
Fix obj db
-
Obj db include fixes
-
End of final cleaning sweep
-
Incorrect command order in runtime manager
-
Param tempfile not required by runtime_manager
-
- Fixes to runtime manager install commands
-
Remove devel directory from catkin, if any
-
Updated launch files for robosense
-
Updated robosense
-
Fix/add missing install (#1977)
-
Added launch install to lidar_kf_contour_track
-
Added install to op_global_planner
-
Added install to way_planner
-
Added install to op_local_planner
-
Added install to op_simulation_package
-
Added install to op_utilities
-
Added install to sync
-
- Improved installation script for pointgrey packages
-
Fixed nodelet error for gmsl cameras
-
USe install space in catkin as well
-
add install to catkin
-
Fix install directives (#1990)
-
Fixed installation path
-
Fixed params installation path
-
Fixed cfg installation path
- Delete cache on colcon_release
-
- Fix license notice in corresponding package.xml
- Adaptation of Object Filter with new perception workflow
- Initial release of object filter
- Contributors: Abraham Monrroy, Abraham Monrroy Cano, amc-nu
1.10.0 (2019-01-17)
- Fixes for catkin_make
- Switch to Apache 2 license (develop branch)
(#1741)
- Switch to Apache 2
* Replace BSD-3 license header with Apache 2 and reassign copyright to the Autoware Foundation.
- Update license on Python files
- Update copyright years
- Add #ifndef/define _POINTS_IMAGE_H_
- Updated license comment
- Use colcon as the build tool
(#1704)
- Switch to colcon as the build tool instead of catkin
- Added cmake-target
- Added note about the second colcon call
- Added warning about catkin* scripts being deprecated
- Fix COLCON_OPTS
- Added install targets
- Update Docker image tags
- Message packages fixes
- Fix missing dependency
- Feature/perception visualization cleanup
(#1648)
-
- Initial commit for visualization package
-
File truncated at 100 lines see the full file
Package Dependencies
Deps | Name |
---|---|
autoware_build_flags | |
catkin | |
autoware_msgs | |
cv_bridge | |
eigen_conversions | |
image_geometry | |
image_transport | |
jsk_recognition_utils | |
jsk_topic_tools | |
roscpp | |
sensor_msgs | |
tf | |
tf_conversions |
System Dependencies
Name |
---|
yaml-cpp |
Dependant Packages
Launch files
- launch/range_vision_fusion.launch
-
- detected_objects_range [default: /detection/lidar_detector/objects]
- detected_objects_vision [default: /detection/image_detector/objects]
- camera_info_src [default: /camera_info]
- min_car_dimensions [default: [3,2,2]]
- min_person_dimensions [default: [1,2,1]]
- min_truck_dimensions [default: [4,2,2]]
- sync_topics [default: false]
- overlap_threshold [default: 0.6]
- use_vector_map [default: false]
- namespace [default: /detection/fusion_tools]
Messages
Services
Plugins
Recent questions tagged range_vision_fusion at Robotics Stack Exchange
Package Summary
Tags | No category tags. |
Version | 1.12.0 |
License | Apache 2 |
Build type | CATKIN |
Use | RECOMMENDED |
Repository Summary
Description | autoware.ai perf |
Checkout URI | https://github.com/is-whale/autoware_learn.git |
VCS Type | git |
VCS Version | 1.14 |
Last Updated | 2025-03-14 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | No category tags. |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- Abraham Monrroy
Authors
Range Vision Fusion
The Range Vision Fusion node will try match the objects detected on a range sensor, with the ones obtained from a vision detector. A match will be considered found if the 3D projection of the object overlaps at least 50% (configurable) over the 2D object detection. The label from the 2D Image detector will be attached to the corresponding 3D Object. All the matched results will be published.
Requirements
Input Topics
- Camera intrinsics (
sensor_msgs/CameraInfo
) - Camera-LiDAR extrinsics (
tf
) - Object Detections results from a Vision Detector (
autoware_msgs/DetectedObjectArray
) - Object Detections results from a Range Detector (
autoware_msgs/DetectedObjectArray
)
Output Topics
- Fused Detected Objects (
autoware_msgs/DetectedObjectArray
) on the/detection/fusion_tools/objects
topic.
Parameters
Launch file available parameters:
Parameter | Type | Description | Default |
---|---|---|---|
detected_objects_range |
String | Name of the DetectedObjectArray topic to subscribe containing the detections on 3D space. |
/detection/lidar_objects |
detected_objects_vision |
String | Name of the DetectedObjectArray topic to subscribe containing the detections on 2D space. |
/detection/vision_objects |
camera_info_src |
String | Name of the CameraInfo topic that contains the intrinsic matrix for the Image. | /camera_info |
sync_topics |
Bool | Sync detection topics. | false |
min_car_dimensions |
Array | Sets the minimum dimensions for a car bounding box(width, height, depth) in meters. | [2,2,4] |
min_person_dimensions |
Array | Sets the minimum dimensions for a person bounding box (width, height, depth) in meters. | [1,2,1] |
min_truck_dimensions |
Array | Sets the minimum dimensions for a truck/bus bounding box (width, height, depth) in meters. | [2,2,4.5] |
overlap_threshold |
float | A number between 0.1 and 1.0 representing the area of overlap between the detections. | 0.5 |
Example of usage
- Launch a ground filter algorithm from the
Points Preprocessor
in the Sensing tab. (adjust the parameters to your vehicle setup). - Launch Calibration Publisher with the intrinsic and extrinsic calibration between the camera and the range sensor.
- Launch a Vision Detector from the Computing tab (this should be publishing by default
/detectoion/vision_objects
). - Launch a Lidar Detector from the Computing tab (this should be publishing by default
/detectoion/lidar_objects
). - Launch this node.
- Launch
rviz
, and add the topics shown above in the Output section.
Notes
- Detection on Image space should be performed on a Rectified Image, otherwise projection will be incorrect.
- The names of the classes are defined as in the COCO dataset.
Changelog for package range_vision_fusion
1.11.0 (2019-03-21)
- [fix] Install commands for all the packages
(#1861)
-
Initial fixes to detection, sensing, semantics and utils
-
fixing wrong filename on install command
-
Fixes to install commands
-
Hokuyo fix name
-
Fix obj db
-
Obj db include fixes
-
End of final cleaning sweep
-
Incorrect command order in runtime manager
-
Param tempfile not required by runtime_manager
-
- Fixes to runtime manager install commands
-
Remove devel directory from catkin, if any
-
Updated launch files for robosense
-
Updated robosense
-
Fix/add missing install (#1977)
-
Added launch install to lidar_kf_contour_track
-
Added install to op_global_planner
-
Added install to way_planner
-
Added install to op_local_planner
-
Added install to op_simulation_package
-
Added install to op_utilities
-
Added install to sync
-
- Improved installation script for pointgrey packages
-
Fixed nodelet error for gmsl cameras
-
USe install space in catkin as well
-
add install to catkin
-
Fix install directives (#1990)
-
Fixed installation path
-
Fixed params installation path
-
Fixed cfg installation path
- Delete cache on colcon_release
-
- Fix license notice in corresponding package.xml
- Adaptation of Object Filter with new perception workflow
- Initial release of object filter
- Contributors: Abraham Monrroy, Abraham Monrroy Cano, amc-nu
1.10.0 (2019-01-17)
- Fixes for catkin_make
- Switch to Apache 2 license (develop branch)
(#1741)
- Switch to Apache 2
* Replace BSD-3 license header with Apache 2 and reassign copyright to the Autoware Foundation.
- Update license on Python files
- Update copyright years
- Add #ifndef/define _POINTS_IMAGE_H_
- Updated license comment
- Use colcon as the build tool
(#1704)
- Switch to colcon as the build tool instead of catkin
- Added cmake-target
- Added note about the second colcon call
- Added warning about catkin* scripts being deprecated
- Fix COLCON_OPTS
- Added install targets
- Update Docker image tags
- Message packages fixes
- Fix missing dependency
- Feature/perception visualization cleanup
(#1648)
-
- Initial commit for visualization package
-
File truncated at 100 lines see the full file
Package Dependencies
Deps | Name |
---|---|
autoware_build_flags | |
catkin | |
autoware_msgs | |
cv_bridge | |
eigen_conversions | |
image_geometry | |
image_transport | |
jsk_recognition_utils | |
jsk_topic_tools | |
roscpp | |
sensor_msgs | |
tf | |
tf_conversions |
System Dependencies
Name |
---|
yaml-cpp |
Dependant Packages
Launch files
- launch/range_vision_fusion.launch
-
- detected_objects_range [default: /detection/lidar_detector/objects]
- detected_objects_vision [default: /detection/image_detector/objects]
- camera_info_src [default: /camera_info]
- min_car_dimensions [default: [3,2,2]]
- min_person_dimensions [default: [1,2,1]]
- min_truck_dimensions [default: [4,2,2]]
- sync_topics [default: false]
- overlap_threshold [default: 0.6]
- use_vector_map [default: false]
- namespace [default: /detection/fusion_tools]
Messages
Services
Plugins
Recent questions tagged range_vision_fusion at Robotics Stack Exchange
Package Summary
Tags | No category tags. |
Version | 1.12.0 |
License | Apache 2 |
Build type | CATKIN |
Use | RECOMMENDED |
Repository Summary
Description | autoware.ai perf |
Checkout URI | https://github.com/is-whale/autoware_learn.git |
VCS Type | git |
VCS Version | 1.14 |
Last Updated | 2025-03-14 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | No category tags. |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- Abraham Monrroy
Authors
Range Vision Fusion
The Range Vision Fusion node will try match the objects detected on a range sensor, with the ones obtained from a vision detector. A match will be considered found if the 3D projection of the object overlaps at least 50% (configurable) over the 2D object detection. The label from the 2D Image detector will be attached to the corresponding 3D Object. All the matched results will be published.
Requirements
Input Topics
- Camera intrinsics (
sensor_msgs/CameraInfo
) - Camera-LiDAR extrinsics (
tf
) - Object Detections results from a Vision Detector (
autoware_msgs/DetectedObjectArray
) - Object Detections results from a Range Detector (
autoware_msgs/DetectedObjectArray
)
Output Topics
- Fused Detected Objects (
autoware_msgs/DetectedObjectArray
) on the/detection/fusion_tools/objects
topic.
Parameters
Launch file available parameters:
Parameter | Type | Description | Default |
---|---|---|---|
detected_objects_range |
String | Name of the DetectedObjectArray topic to subscribe containing the detections on 3D space. |
/detection/lidar_objects |
detected_objects_vision |
String | Name of the DetectedObjectArray topic to subscribe containing the detections on 2D space. |
/detection/vision_objects |
camera_info_src |
String | Name of the CameraInfo topic that contains the intrinsic matrix for the Image. | /camera_info |
sync_topics |
Bool | Sync detection topics. | false |
min_car_dimensions |
Array | Sets the minimum dimensions for a car bounding box(width, height, depth) in meters. | [2,2,4] |
min_person_dimensions |
Array | Sets the minimum dimensions for a person bounding box (width, height, depth) in meters. | [1,2,1] |
min_truck_dimensions |
Array | Sets the minimum dimensions for a truck/bus bounding box (width, height, depth) in meters. | [2,2,4.5] |
overlap_threshold |
float | A number between 0.1 and 1.0 representing the area of overlap between the detections. | 0.5 |
Example of usage
- Launch a ground filter algorithm from the
Points Preprocessor
in the Sensing tab. (adjust the parameters to your vehicle setup). - Launch Calibration Publisher with the intrinsic and extrinsic calibration between the camera and the range sensor.
- Launch a Vision Detector from the Computing tab (this should be publishing by default
/detectoion/vision_objects
). - Launch a Lidar Detector from the Computing tab (this should be publishing by default
/detectoion/lidar_objects
). - Launch this node.
- Launch
rviz
, and add the topics shown above in the Output section.
Notes
- Detection on Image space should be performed on a Rectified Image, otherwise projection will be incorrect.
- The names of the classes are defined as in the COCO dataset.
Changelog for package range_vision_fusion
1.11.0 (2019-03-21)
- [fix] Install commands for all the packages
(#1861)
-
Initial fixes to detection, sensing, semantics and utils
-
fixing wrong filename on install command
-
Fixes to install commands
-
Hokuyo fix name
-
Fix obj db
-
Obj db include fixes
-
End of final cleaning sweep
-
Incorrect command order in runtime manager
-
Param tempfile not required by runtime_manager
-
- Fixes to runtime manager install commands
-
Remove devel directory from catkin, if any
-
Updated launch files for robosense
-
Updated robosense
-
Fix/add missing install (#1977)
-
Added launch install to lidar_kf_contour_track
-
Added install to op_global_planner
-
Added install to way_planner
-
Added install to op_local_planner
-
Added install to op_simulation_package
-
Added install to op_utilities
-
Added install to sync
-
- Improved installation script for pointgrey packages
-
Fixed nodelet error for gmsl cameras
-
USe install space in catkin as well
-
add install to catkin
-
Fix install directives (#1990)
-
Fixed installation path
-
Fixed params installation path
-
Fixed cfg installation path
- Delete cache on colcon_release
-
- Fix license notice in corresponding package.xml
- Adaptation of Object Filter with new perception workflow
- Initial release of object filter
- Contributors: Abraham Monrroy, Abraham Monrroy Cano, amc-nu
1.10.0 (2019-01-17)
- Fixes for catkin_make
- Switch to Apache 2 license (develop branch)
(#1741)
- Switch to Apache 2
* Replace BSD-3 license header with Apache 2 and reassign copyright to the Autoware Foundation.
- Update license on Python files
- Update copyright years
- Add #ifndef/define _POINTS_IMAGE_H_
- Updated license comment
- Use colcon as the build tool
(#1704)
- Switch to colcon as the build tool instead of catkin
- Added cmake-target
- Added note about the second colcon call
- Added warning about catkin* scripts being deprecated
- Fix COLCON_OPTS
- Added install targets
- Update Docker image tags
- Message packages fixes
- Fix missing dependency
- Feature/perception visualization cleanup
(#1648)
-
- Initial commit for visualization package
-
File truncated at 100 lines see the full file
Package Dependencies
Deps | Name |
---|---|
autoware_build_flags | |
catkin | |
autoware_msgs | |
cv_bridge | |
eigen_conversions | |
image_geometry | |
image_transport | |
jsk_recognition_utils | |
jsk_topic_tools | |
roscpp | |
sensor_msgs | |
tf | |
tf_conversions |
System Dependencies
Name |
---|
yaml-cpp |
Dependant Packages
Launch files
- launch/range_vision_fusion.launch
-
- detected_objects_range [default: /detection/lidar_detector/objects]
- detected_objects_vision [default: /detection/image_detector/objects]
- camera_info_src [default: /camera_info]
- min_car_dimensions [default: [3,2,2]]
- min_person_dimensions [default: [1,2,1]]
- min_truck_dimensions [default: [4,2,2]]
- sync_topics [default: false]
- overlap_threshold [default: 0.6]
- use_vector_map [default: false]
- namespace [default: /detection/fusion_tools]
Messages
Services
Plugins
Recent questions tagged range_vision_fusion at Robotics Stack Exchange
Package Summary
Tags | No category tags. |
Version | 1.12.0 |
License | Apache 2 |
Build type | CATKIN |
Use | RECOMMENDED |
Repository Summary
Description | autoware.ai perf |
Checkout URI | https://github.com/is-whale/autoware_learn.git |
VCS Type | git |
VCS Version | 1.14 |
Last Updated | 2025-03-14 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | No category tags. |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- Abraham Monrroy
Authors
Range Vision Fusion
The Range Vision Fusion node will try match the objects detected on a range sensor, with the ones obtained from a vision detector. A match will be considered found if the 3D projection of the object overlaps at least 50% (configurable) over the 2D object detection. The label from the 2D Image detector will be attached to the corresponding 3D Object. All the matched results will be published.
Requirements
Input Topics
- Camera intrinsics (
sensor_msgs/CameraInfo
) - Camera-LiDAR extrinsics (
tf
) - Object Detections results from a Vision Detector (
autoware_msgs/DetectedObjectArray
) - Object Detections results from a Range Detector (
autoware_msgs/DetectedObjectArray
)
Output Topics
- Fused Detected Objects (
autoware_msgs/DetectedObjectArray
) on the/detection/fusion_tools/objects
topic.
Parameters
Launch file available parameters:
Parameter | Type | Description | Default |
---|---|---|---|
detected_objects_range |
String | Name of the DetectedObjectArray topic to subscribe containing the detections on 3D space. |
/detection/lidar_objects |
detected_objects_vision |
String | Name of the DetectedObjectArray topic to subscribe containing the detections on 2D space. |
/detection/vision_objects |
camera_info_src |
String | Name of the CameraInfo topic that contains the intrinsic matrix for the Image. | /camera_info |
sync_topics |
Bool | Sync detection topics. | false |
min_car_dimensions |
Array | Sets the minimum dimensions for a car bounding box(width, height, depth) in meters. | [2,2,4] |
min_person_dimensions |
Array | Sets the minimum dimensions for a person bounding box (width, height, depth) in meters. | [1,2,1] |
min_truck_dimensions |
Array | Sets the minimum dimensions for a truck/bus bounding box (width, height, depth) in meters. | [2,2,4.5] |
overlap_threshold |
float | A number between 0.1 and 1.0 representing the area of overlap between the detections. | 0.5 |
Example of usage
- Launch a ground filter algorithm from the
Points Preprocessor
in the Sensing tab. (adjust the parameters to your vehicle setup). - Launch Calibration Publisher with the intrinsic and extrinsic calibration between the camera and the range sensor.
- Launch a Vision Detector from the Computing tab (this should be publishing by default
/detectoion/vision_objects
). - Launch a Lidar Detector from the Computing tab (this should be publishing by default
/detectoion/lidar_objects
). - Launch this node.
- Launch
rviz
, and add the topics shown above in the Output section.
Notes
- Detection on Image space should be performed on a Rectified Image, otherwise projection will be incorrect.
- The names of the classes are defined as in the COCO dataset.
Changelog for package range_vision_fusion
1.11.0 (2019-03-21)
- [fix] Install commands for all the packages
(#1861)
-
Initial fixes to detection, sensing, semantics and utils
-
fixing wrong filename on install command
-
Fixes to install commands
-
Hokuyo fix name
-
Fix obj db
-
Obj db include fixes
-
End of final cleaning sweep
-
Incorrect command order in runtime manager
-
Param tempfile not required by runtime_manager
-
- Fixes to runtime manager install commands
-
Remove devel directory from catkin, if any
-
Updated launch files for robosense
-
Updated robosense
-
Fix/add missing install (#1977)
-
Added launch install to lidar_kf_contour_track
-
Added install to op_global_planner
-
Added install to way_planner
-
Added install to op_local_planner
-
Added install to op_simulation_package
-
Added install to op_utilities
-
Added install to sync
-
- Improved installation script for pointgrey packages
-
Fixed nodelet error for gmsl cameras
-
USe install space in catkin as well
-
add install to catkin
-
Fix install directives (#1990)
-
Fixed installation path
-
Fixed params installation path
-
Fixed cfg installation path
- Delete cache on colcon_release
-
- Fix license notice in corresponding package.xml
- Adaptation of Object Filter with new perception workflow
- Initial release of object filter
- Contributors: Abraham Monrroy, Abraham Monrroy Cano, amc-nu
1.10.0 (2019-01-17)
- Fixes for catkin_make
- Switch to Apache 2 license (develop branch)
(#1741)
- Switch to Apache 2
* Replace BSD-3 license header with Apache 2 and reassign copyright to the Autoware Foundation.
- Update license on Python files
- Update copyright years
- Add #ifndef/define _POINTS_IMAGE_H_
- Updated license comment
- Use colcon as the build tool
(#1704)
- Switch to colcon as the build tool instead of catkin
- Added cmake-target
- Added note about the second colcon call
- Added warning about catkin* scripts being deprecated
- Fix COLCON_OPTS
- Added install targets
- Update Docker image tags
- Message packages fixes
- Fix missing dependency
- Feature/perception visualization cleanup
(#1648)
-
- Initial commit for visualization package
-
File truncated at 100 lines see the full file
Package Dependencies
Deps | Name |
---|---|
autoware_build_flags | |
catkin | |
autoware_msgs | |
cv_bridge | |
eigen_conversions | |
image_geometry | |
image_transport | |
jsk_recognition_utils | |
jsk_topic_tools | |
roscpp | |
sensor_msgs | |
tf | |
tf_conversions |
System Dependencies
Name |
---|
yaml-cpp |
Dependant Packages
Launch files
- launch/range_vision_fusion.launch
-
- detected_objects_range [default: /detection/lidar_detector/objects]
- detected_objects_vision [default: /detection/image_detector/objects]
- camera_info_src [default: /camera_info]
- min_car_dimensions [default: [3,2,2]]
- min_person_dimensions [default: [1,2,1]]
- min_truck_dimensions [default: [4,2,2]]
- sync_topics [default: false]
- overlap_threshold [default: 0.6]
- use_vector_map [default: false]
- namespace [default: /detection/fusion_tools]
Messages
Services
Plugins
Recent questions tagged range_vision_fusion at Robotics Stack Exchange
Package Summary
Tags | No category tags. |
Version | 1.12.0 |
License | Apache 2 |
Build type | CATKIN |
Use | RECOMMENDED |
Repository Summary
Description | autoware.ai perf |
Checkout URI | https://github.com/is-whale/autoware_learn.git |
VCS Type | git |
VCS Version | 1.14 |
Last Updated | 2025-03-14 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | No category tags. |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- Abraham Monrroy
Authors
Range Vision Fusion
The Range Vision Fusion node will try match the objects detected on a range sensor, with the ones obtained from a vision detector. A match will be considered found if the 3D projection of the object overlaps at least 50% (configurable) over the 2D object detection. The label from the 2D Image detector will be attached to the corresponding 3D Object. All the matched results will be published.
Requirements
Input Topics
- Camera intrinsics (
sensor_msgs/CameraInfo
) - Camera-LiDAR extrinsics (
tf
) - Object Detections results from a Vision Detector (
autoware_msgs/DetectedObjectArray
) - Object Detections results from a Range Detector (
autoware_msgs/DetectedObjectArray
)
Output Topics
- Fused Detected Objects (
autoware_msgs/DetectedObjectArray
) on the/detection/fusion_tools/objects
topic.
Parameters
Launch file available parameters:
Parameter | Type | Description | Default |
---|---|---|---|
detected_objects_range |
String | Name of the DetectedObjectArray topic to subscribe containing the detections on 3D space. |
/detection/lidar_objects |
detected_objects_vision |
String | Name of the DetectedObjectArray topic to subscribe containing the detections on 2D space. |
/detection/vision_objects |
camera_info_src |
String | Name of the CameraInfo topic that contains the intrinsic matrix for the Image. | /camera_info |
sync_topics |
Bool | Sync detection topics. | false |
min_car_dimensions |
Array | Sets the minimum dimensions for a car bounding box(width, height, depth) in meters. | [2,2,4] |
min_person_dimensions |
Array | Sets the minimum dimensions for a person bounding box (width, height, depth) in meters. | [1,2,1] |
min_truck_dimensions |
Array | Sets the minimum dimensions for a truck/bus bounding box (width, height, depth) in meters. | [2,2,4.5] |
overlap_threshold |
float | A number between 0.1 and 1.0 representing the area of overlap between the detections. | 0.5 |
Example of usage
- Launch a ground filter algorithm from the
Points Preprocessor
in the Sensing tab. (adjust the parameters to your vehicle setup). - Launch Calibration Publisher with the intrinsic and extrinsic calibration between the camera and the range sensor.
- Launch a Vision Detector from the Computing tab (this should be publishing by default
/detectoion/vision_objects
). - Launch a Lidar Detector from the Computing tab (this should be publishing by default
/detectoion/lidar_objects
). - Launch this node.
- Launch
rviz
, and add the topics shown above in the Output section.
Notes
- Detection on Image space should be performed on a Rectified Image, otherwise projection will be incorrect.
- The names of the classes are defined as in the COCO dataset.
Changelog for package range_vision_fusion
1.11.0 (2019-03-21)
- [fix] Install commands for all the packages
(#1861)
-
Initial fixes to detection, sensing, semantics and utils
-
fixing wrong filename on install command
-
Fixes to install commands
-
Hokuyo fix name
-
Fix obj db
-
Obj db include fixes
-
End of final cleaning sweep
-
Incorrect command order in runtime manager
-
Param tempfile not required by runtime_manager
-
- Fixes to runtime manager install commands
-
Remove devel directory from catkin, if any
-
Updated launch files for robosense
-
Updated robosense
-
Fix/add missing install (#1977)
-
Added launch install to lidar_kf_contour_track
-
Added install to op_global_planner
-
Added install to way_planner
-
Added install to op_local_planner
-
Added install to op_simulation_package
-
Added install to op_utilities
-
Added install to sync
-
- Improved installation script for pointgrey packages
-
Fixed nodelet error for gmsl cameras
-
USe install space in catkin as well
-
add install to catkin
-
Fix install directives (#1990)
-
Fixed installation path
-
Fixed params installation path
-
Fixed cfg installation path
- Delete cache on colcon_release
-
- Fix license notice in corresponding package.xml
- Adaptation of Object Filter with new perception workflow
- Initial release of object filter
- Contributors: Abraham Monrroy, Abraham Monrroy Cano, amc-nu
1.10.0 (2019-01-17)
- Fixes for catkin_make
- Switch to Apache 2 license (develop branch)
(#1741)
- Switch to Apache 2
* Replace BSD-3 license header with Apache 2 and reassign copyright to the Autoware Foundation.
- Update license on Python files
- Update copyright years
- Add #ifndef/define _POINTS_IMAGE_H_
- Updated license comment
- Use colcon as the build tool
(#1704)
- Switch to colcon as the build tool instead of catkin
- Added cmake-target
- Added note about the second colcon call
- Added warning about catkin* scripts being deprecated
- Fix COLCON_OPTS
- Added install targets
- Update Docker image tags
- Message packages fixes
- Fix missing dependency
- Feature/perception visualization cleanup
(#1648)
-
- Initial commit for visualization package
-
File truncated at 100 lines see the full file
Package Dependencies
Deps | Name |
---|---|
autoware_build_flags | |
catkin | |
autoware_msgs | |
cv_bridge | |
eigen_conversions | |
image_geometry | |
image_transport | |
jsk_recognition_utils | |
jsk_topic_tools | |
roscpp | |
sensor_msgs | |
tf | |
tf_conversions |
System Dependencies
Name |
---|
yaml-cpp |
Dependant Packages
Launch files
- launch/range_vision_fusion.launch
-
- detected_objects_range [default: /detection/lidar_detector/objects]
- detected_objects_vision [default: /detection/image_detector/objects]
- camera_info_src [default: /camera_info]
- min_car_dimensions [default: [3,2,2]]
- min_person_dimensions [default: [1,2,1]]
- min_truck_dimensions [default: [4,2,2]]
- sync_topics [default: false]
- overlap_threshold [default: 0.6]
- use_vector_map [default: false]
- namespace [default: /detection/fusion_tools]
Messages
Services
Plugins
Recent questions tagged range_vision_fusion at Robotics Stack Exchange
Package Summary
Tags | No category tags. |
Version | 1.12.0 |
License | Apache 2 |
Build type | CATKIN |
Use | RECOMMENDED |
Repository Summary
Description | autoware.ai perf |
Checkout URI | https://github.com/is-whale/autoware_learn.git |
VCS Type | git |
VCS Version | 1.14 |
Last Updated | 2025-03-14 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | No category tags. |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- Abraham Monrroy
Authors
Range Vision Fusion
The Range Vision Fusion node will try match the objects detected on a range sensor, with the ones obtained from a vision detector. A match will be considered found if the 3D projection of the object overlaps at least 50% (configurable) over the 2D object detection. The label from the 2D Image detector will be attached to the corresponding 3D Object. All the matched results will be published.
Requirements
Input Topics
- Camera intrinsics (
sensor_msgs/CameraInfo
) - Camera-LiDAR extrinsics (
tf
) - Object Detections results from a Vision Detector (
autoware_msgs/DetectedObjectArray
) - Object Detections results from a Range Detector (
autoware_msgs/DetectedObjectArray
)
Output Topics
- Fused Detected Objects (
autoware_msgs/DetectedObjectArray
) on the/detection/fusion_tools/objects
topic.
Parameters
Launch file available parameters:
Parameter | Type | Description | Default |
---|---|---|---|
detected_objects_range |
String | Name of the DetectedObjectArray topic to subscribe containing the detections on 3D space. |
/detection/lidar_objects |
detected_objects_vision |
String | Name of the DetectedObjectArray topic to subscribe containing the detections on 2D space. |
/detection/vision_objects |
camera_info_src |
String | Name of the CameraInfo topic that contains the intrinsic matrix for the Image. | /camera_info |
sync_topics |
Bool | Sync detection topics. | false |
min_car_dimensions |
Array | Sets the minimum dimensions for a car bounding box(width, height, depth) in meters. | [2,2,4] |
min_person_dimensions |
Array | Sets the minimum dimensions for a person bounding box (width, height, depth) in meters. | [1,2,1] |
min_truck_dimensions |
Array | Sets the minimum dimensions for a truck/bus bounding box (width, height, depth) in meters. | [2,2,4.5] |
overlap_threshold |
float | A number between 0.1 and 1.0 representing the area of overlap between the detections. | 0.5 |
Example of usage
- Launch a ground filter algorithm from the
Points Preprocessor
in the Sensing tab. (adjust the parameters to your vehicle setup). - Launch Calibration Publisher with the intrinsic and extrinsic calibration between the camera and the range sensor.
- Launch a Vision Detector from the Computing tab (this should be publishing by default
/detectoion/vision_objects
). - Launch a Lidar Detector from the Computing tab (this should be publishing by default
/detectoion/lidar_objects
). - Launch this node.
- Launch
rviz
, and add the topics shown above in the Output section.
Notes
- Detection on Image space should be performed on a Rectified Image, otherwise projection will be incorrect.
- The names of the classes are defined as in the COCO dataset.
Changelog for package range_vision_fusion
1.11.0 (2019-03-21)
- [fix] Install commands for all the packages
(#1861)
-
Initial fixes to detection, sensing, semantics and utils
-
fixing wrong filename on install command
-
Fixes to install commands
-
Hokuyo fix name
-
Fix obj db
-
Obj db include fixes
-
End of final cleaning sweep
-
Incorrect command order in runtime manager
-
Param tempfile not required by runtime_manager
-
- Fixes to runtime manager install commands
-
Remove devel directory from catkin, if any
-
Updated launch files for robosense
-
Updated robosense
-
Fix/add missing install (#1977)
-
Added launch install to lidar_kf_contour_track
-
Added install to op_global_planner
-
Added install to way_planner
-
Added install to op_local_planner
-
Added install to op_simulation_package
-
Added install to op_utilities
-
Added install to sync
-
- Improved installation script for pointgrey packages
-
Fixed nodelet error for gmsl cameras
-
USe install space in catkin as well
-
add install to catkin
-
Fix install directives (#1990)
-
Fixed installation path
-
Fixed params installation path
-
Fixed cfg installation path
- Delete cache on colcon_release
-
- Fix license notice in corresponding package.xml
- Adaptation of Object Filter with new perception workflow
- Initial release of object filter
- Contributors: Abraham Monrroy, Abraham Monrroy Cano, amc-nu
1.10.0 (2019-01-17)
- Fixes for catkin_make
- Switch to Apache 2 license (develop branch)
(#1741)
- Switch to Apache 2
* Replace BSD-3 license header with Apache 2 and reassign copyright to the Autoware Foundation.
- Update license on Python files
- Update copyright years
- Add #ifndef/define _POINTS_IMAGE_H_
- Updated license comment
- Use colcon as the build tool
(#1704)
- Switch to colcon as the build tool instead of catkin
- Added cmake-target
- Added note about the second colcon call
- Added warning about catkin* scripts being deprecated
- Fix COLCON_OPTS
- Added install targets
- Update Docker image tags
- Message packages fixes
- Fix missing dependency
- Feature/perception visualization cleanup
(#1648)
-
- Initial commit for visualization package
-
File truncated at 100 lines see the full file
Package Dependencies
Deps | Name |
---|---|
autoware_build_flags | |
catkin | |
autoware_msgs | |
cv_bridge | |
eigen_conversions | |
image_geometry | |
image_transport | |
jsk_recognition_utils | |
jsk_topic_tools | |
roscpp | |
sensor_msgs | |
tf | |
tf_conversions |
System Dependencies
Name |
---|
yaml-cpp |
Dependant Packages
Launch files
- launch/range_vision_fusion.launch
-
- detected_objects_range [default: /detection/lidar_detector/objects]
- detected_objects_vision [default: /detection/image_detector/objects]
- camera_info_src [default: /camera_info]
- min_car_dimensions [default: [3,2,2]]
- min_person_dimensions [default: [1,2,1]]
- min_truck_dimensions [default: [4,2,2]]
- sync_topics [default: false]
- overlap_threshold [default: 0.6]
- use_vector_map [default: false]
- namespace [default: /detection/fusion_tools]
Messages
Services
Plugins
Recent questions tagged range_vision_fusion at Robotics Stack Exchange
Package Summary
Tags | No category tags. |
Version | 1.12.0 |
License | Apache 2 |
Build type | CATKIN |
Use | RECOMMENDED |
Repository Summary
Description | autoware.ai perf |
Checkout URI | https://github.com/is-whale/autoware_learn.git |
VCS Type | git |
VCS Version | 1.14 |
Last Updated | 2025-03-14 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | No category tags. |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- Abraham Monrroy
Authors
Range Vision Fusion
The Range Vision Fusion node will try match the objects detected on a range sensor, with the ones obtained from a vision detector. A match will be considered found if the 3D projection of the object overlaps at least 50% (configurable) over the 2D object detection. The label from the 2D Image detector will be attached to the corresponding 3D Object. All the matched results will be published.
Requirements
Input Topics
- Camera intrinsics (
sensor_msgs/CameraInfo
) - Camera-LiDAR extrinsics (
tf
) - Object Detections results from a Vision Detector (
autoware_msgs/DetectedObjectArray
) - Object Detections results from a Range Detector (
autoware_msgs/DetectedObjectArray
)
Output Topics
- Fused Detected Objects (
autoware_msgs/DetectedObjectArray
) on the/detection/fusion_tools/objects
topic.
Parameters
Launch file available parameters:
Parameter | Type | Description | Default |
---|---|---|---|
detected_objects_range |
String | Name of the DetectedObjectArray topic to subscribe containing the detections on 3D space. |
/detection/lidar_objects |
detected_objects_vision |
String | Name of the DetectedObjectArray topic to subscribe containing the detections on 2D space. |
/detection/vision_objects |
camera_info_src |
String | Name of the CameraInfo topic that contains the intrinsic matrix for the Image. | /camera_info |
sync_topics |
Bool | Sync detection topics. | false |
min_car_dimensions |
Array | Sets the minimum dimensions for a car bounding box(width, height, depth) in meters. | [2,2,4] |
min_person_dimensions |
Array | Sets the minimum dimensions for a person bounding box (width, height, depth) in meters. | [1,2,1] |
min_truck_dimensions |
Array | Sets the minimum dimensions for a truck/bus bounding box (width, height, depth) in meters. | [2,2,4.5] |
overlap_threshold |
float | A number between 0.1 and 1.0 representing the area of overlap between the detections. | 0.5 |
Example of usage
- Launch a ground filter algorithm from the
Points Preprocessor
in the Sensing tab. (adjust the parameters to your vehicle setup). - Launch Calibration Publisher with the intrinsic and extrinsic calibration between the camera and the range sensor.
- Launch a Vision Detector from the Computing tab (this should be publishing by default
/detectoion/vision_objects
). - Launch a Lidar Detector from the Computing tab (this should be publishing by default
/detectoion/lidar_objects
). - Launch this node.
- Launch
rviz
, and add the topics shown above in the Output section.
Notes
- Detection on Image space should be performed on a Rectified Image, otherwise projection will be incorrect.
- The names of the classes are defined as in the COCO dataset.
Changelog for package range_vision_fusion
1.11.0 (2019-03-21)
- [fix] Install commands for all the packages
(#1861)
-
Initial fixes to detection, sensing, semantics and utils
-
fixing wrong filename on install command
-
Fixes to install commands
-
Hokuyo fix name
-
Fix obj db
-
Obj db include fixes
-
End of final cleaning sweep
-
Incorrect command order in runtime manager
-
Param tempfile not required by runtime_manager
-
- Fixes to runtime manager install commands
-
Remove devel directory from catkin, if any
-
Updated launch files for robosense
-
Updated robosense
-
Fix/add missing install (#1977)
-
Added launch install to lidar_kf_contour_track
-
Added install to op_global_planner
-
Added install to way_planner
-
Added install to op_local_planner
-
Added install to op_simulation_package
-
Added install to op_utilities
-
Added install to sync
-
- Improved installation script for pointgrey packages
-
Fixed nodelet error for gmsl cameras
-
USe install space in catkin as well
-
add install to catkin
-
Fix install directives (#1990)
-
Fixed installation path
-
Fixed params installation path
-
Fixed cfg installation path
- Delete cache on colcon_release
-
- Fix license notice in corresponding package.xml
- Adaptation of Object Filter with new perception workflow
- Initial release of object filter
- Contributors: Abraham Monrroy, Abraham Monrroy Cano, amc-nu
1.10.0 (2019-01-17)
- Fixes for catkin_make
- Switch to Apache 2 license (develop branch)
(#1741)
- Switch to Apache 2
* Replace BSD-3 license header with Apache 2 and reassign copyright to the Autoware Foundation.
- Update license on Python files
- Update copyright years
- Add #ifndef/define _POINTS_IMAGE_H_
- Updated license comment
- Use colcon as the build tool
(#1704)
- Switch to colcon as the build tool instead of catkin
- Added cmake-target
- Added note about the second colcon call
- Added warning about catkin* scripts being deprecated
- Fix COLCON_OPTS
- Added install targets
- Update Docker image tags
- Message packages fixes
- Fix missing dependency
- Feature/perception visualization cleanup
(#1648)
-
- Initial commit for visualization package
-
File truncated at 100 lines see the full file
Package Dependencies
Deps | Name |
---|---|
autoware_build_flags | |
catkin | |
autoware_msgs | |
cv_bridge | |
eigen_conversions | |
image_geometry | |
image_transport | |
jsk_recognition_utils | |
jsk_topic_tools | |
roscpp | |
sensor_msgs | |
tf | |
tf_conversions |
System Dependencies
Name |
---|
yaml-cpp |
Dependant Packages
Launch files
- launch/range_vision_fusion.launch
-
- detected_objects_range [default: /detection/lidar_detector/objects]
- detected_objects_vision [default: /detection/image_detector/objects]
- camera_info_src [default: /camera_info]
- min_car_dimensions [default: [3,2,2]]
- min_person_dimensions [default: [1,2,1]]
- min_truck_dimensions [default: [4,2,2]]
- sync_topics [default: false]
- overlap_threshold [default: 0.6]
- use_vector_map [default: false]
- namespace [default: /detection/fusion_tools]
Messages
Services
Plugins
Recent questions tagged range_vision_fusion at Robotics Stack Exchange
Package Summary
Tags | No category tags. |
Version | 1.12.0 |
License | Apache 2 |
Build type | CATKIN |
Use | RECOMMENDED |
Repository Summary
Description | autoware.ai perf |
Checkout URI | https://github.com/is-whale/autoware_learn.git |
VCS Type | git |
VCS Version | 1.14 |
Last Updated | 2025-03-14 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | No category tags. |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- Abraham Monrroy
Authors
Range Vision Fusion
The Range Vision Fusion node will try match the objects detected on a range sensor, with the ones obtained from a vision detector. A match will be considered found if the 3D projection of the object overlaps at least 50% (configurable) over the 2D object detection. The label from the 2D Image detector will be attached to the corresponding 3D Object. All the matched results will be published.
Requirements
Input Topics
- Camera intrinsics (
sensor_msgs/CameraInfo
) - Camera-LiDAR extrinsics (
tf
) - Object Detections results from a Vision Detector (
autoware_msgs/DetectedObjectArray
) - Object Detections results from a Range Detector (
autoware_msgs/DetectedObjectArray
)
Output Topics
- Fused Detected Objects (
autoware_msgs/DetectedObjectArray
) on the/detection/fusion_tools/objects
topic.
Parameters
Launch file available parameters:
Parameter | Type | Description | Default |
---|---|---|---|
detected_objects_range |
String | Name of the DetectedObjectArray topic to subscribe containing the detections on 3D space. |
/detection/lidar_objects |
detected_objects_vision |
String | Name of the DetectedObjectArray topic to subscribe containing the detections on 2D space. |
/detection/vision_objects |
camera_info_src |
String | Name of the CameraInfo topic that contains the intrinsic matrix for the Image. | /camera_info |
sync_topics |
Bool | Sync detection topics. | false |
min_car_dimensions |
Array | Sets the minimum dimensions for a car bounding box(width, height, depth) in meters. | [2,2,4] |
min_person_dimensions |
Array | Sets the minimum dimensions for a person bounding box (width, height, depth) in meters. | [1,2,1] |
min_truck_dimensions |
Array | Sets the minimum dimensions for a truck/bus bounding box (width, height, depth) in meters. | [2,2,4.5] |
overlap_threshold |
float | A number between 0.1 and 1.0 representing the area of overlap between the detections. | 0.5 |
Example of usage
- Launch a ground filter algorithm from the
Points Preprocessor
in the Sensing tab. (adjust the parameters to your vehicle setup). - Launch Calibration Publisher with the intrinsic and extrinsic calibration between the camera and the range sensor.
- Launch a Vision Detector from the Computing tab (this should be publishing by default
/detectoion/vision_objects
). - Launch a Lidar Detector from the Computing tab (this should be publishing by default
/detectoion/lidar_objects
). - Launch this node.
- Launch
rviz
, and add the topics shown above in the Output section.
Notes
- Detection on Image space should be performed on a Rectified Image, otherwise projection will be incorrect.
- The names of the classes are defined as in the COCO dataset.
Changelog for package range_vision_fusion
1.11.0 (2019-03-21)
- [fix] Install commands for all the packages
(#1861)
-
Initial fixes to detection, sensing, semantics and utils
-
fixing wrong filename on install command
-
Fixes to install commands
-
Hokuyo fix name
-
Fix obj db
-
Obj db include fixes
-
End of final cleaning sweep
-
Incorrect command order in runtime manager
-
Param tempfile not required by runtime_manager
-
- Fixes to runtime manager install commands
-
Remove devel directory from catkin, if any
-
Updated launch files for robosense
-
Updated robosense
-
Fix/add missing install (#1977)
-
Added launch install to lidar_kf_contour_track
-
Added install to op_global_planner
-
Added install to way_planner
-
Added install to op_local_planner
-
Added install to op_simulation_package
-
Added install to op_utilities
-
Added install to sync
-
- Improved installation script for pointgrey packages
-
Fixed nodelet error for gmsl cameras
-
USe install space in catkin as well
-
add install to catkin
-
Fix install directives (#1990)
-
Fixed installation path
-
Fixed params installation path
-
Fixed cfg installation path
- Delete cache on colcon_release
-
- Fix license notice in corresponding package.xml
- Adaptation of Object Filter with new perception workflow
- Initial release of object filter
- Contributors: Abraham Monrroy, Abraham Monrroy Cano, amc-nu
1.10.0 (2019-01-17)
- Fixes for catkin_make
- Switch to Apache 2 license (develop branch)
(#1741)
- Switch to Apache 2
* Replace BSD-3 license header with Apache 2 and reassign copyright to the Autoware Foundation.
- Update license on Python files
- Update copyright years
- Add #ifndef/define _POINTS_IMAGE_H_
- Updated license comment
- Use colcon as the build tool
(#1704)
- Switch to colcon as the build tool instead of catkin
- Added cmake-target
- Added note about the second colcon call
- Added warning about catkin* scripts being deprecated
- Fix COLCON_OPTS
- Added install targets
- Update Docker image tags
- Message packages fixes
- Fix missing dependency
- Feature/perception visualization cleanup
(#1648)
-
- Initial commit for visualization package
-
File truncated at 100 lines see the full file
Package Dependencies
Deps | Name |
---|---|
autoware_build_flags | |
catkin | |
autoware_msgs | |
cv_bridge | |
eigen_conversions | |
image_geometry | |
image_transport | |
jsk_recognition_utils | |
jsk_topic_tools | |
roscpp | |
sensor_msgs | |
tf | |
tf_conversions |
System Dependencies
Name |
---|
yaml-cpp |
Dependant Packages
Launch files
- launch/range_vision_fusion.launch
-
- detected_objects_range [default: /detection/lidar_detector/objects]
- detected_objects_vision [default: /detection/image_detector/objects]
- camera_info_src [default: /camera_info]
- min_car_dimensions [default: [3,2,2]]
- min_person_dimensions [default: [1,2,1]]
- min_truck_dimensions [default: [4,2,2]]
- sync_topics [default: false]
- overlap_threshold [default: 0.6]
- use_vector_map [default: false]
- namespace [default: /detection/fusion_tools]