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
- amc
Authors
KF based Object Tracker
kf contour tracker
This nodes contains three options of tracking
- Association only
- Simple KF tracking
- Contour area plust memory tracker (divid the horizon into contours and associate memory for each circle, which represent the maximum life time of each object)
Outputs
This tracker output (pose, heading, velocity) in global coordinates.
Object Filtering
It can filter detected objects by size or/and vector map lanes proximity.
Options
It tracks either OpenPlanner simulted vehicles or live detection cluster from “lidar_euclidean_cluster_detect” It can simulated frame by frame testing with fixed time intervals 0.1 second.
Requirements
- cloud_clusters
- vector map, in case of using vector map object filtering (to disable using vector map set “vector map filter distance” to 0)
- op percepion simulator, in case of simulation, also vector map filtering should be disabled.
How to launch
- From a sourced terminal:
roslaunch lidar_kf_contour_track lidar_kf_contour_track.launch
- From Runtime Manager:
Computing Tab -> Detection -> lidar_tracker -> lidar_kf_contour_tracker
Subscriptions/Publications
Publications:
* /tracked_objects [autoware_msgs::DetectedObjectArray]
* /detected_polygons [visualization_msgs::MarkerArray]
* /op_planner_tracked_boxes [jsk_recognition_msgs::BoundingBoxArray]
Subscriptions:
* /cloud_cluster [autoware_msgs::CloudClusterArray]
* /current_pose [geometry_msgs::PoseStamped]
* /vector_map_info/*
Changelog for package lidar_kf_contour_track
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
- Contributors: 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
- Fix Ros/ROS naming convention
- Contributors: Esteve Fernandez, amc-nu
1.9.1 (2018-11-06)
1.9.0 (2018-10-31)
File truncated at 100 lines see the full file
Package Dependencies
Deps | Name |
---|---|
autoware_build_flags | |
catkin | |
autoware_msgs | |
cv_bridge | |
geometry_msgs | |
jsk_recognition_msgs | |
op_planner | |
op_ros_helpers | |
roscpp | |
tf | |
pcl_conversions |
System Dependencies
Dependant Packages
Launch files
- launch/lidar_kf_contour_track.launch
-
- vehicle_width [default: 1.85]
- vehicle_length [default: 4.2]
- min_object_size [default: 0.1]
- max_object_size [default: 30.0]
- polygon_quarters [default: 16]
- polygon_resolution [default: 0.5]
- tracking_type [default: 0]
- max_association_distance [default: 4.5]
- max_association_size_diff [default: 2.0]
- max_remeber_time [default: 3]
- trust_counter [default: 4]
- enableSimulationMode [default: false]
- enableStepByStepMode [default: false]
- vector_map_filter_distance [default: 2.0]
- enableLogging [default: false]
Messages
Services
Plugins
Recent questions tagged lidar_kf_contour_track 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
- amc
Authors
KF based Object Tracker
kf contour tracker
This nodes contains three options of tracking
- Association only
- Simple KF tracking
- Contour area plust memory tracker (divid the horizon into contours and associate memory for each circle, which represent the maximum life time of each object)
Outputs
This tracker output (pose, heading, velocity) in global coordinates.
Object Filtering
It can filter detected objects by size or/and vector map lanes proximity.
Options
It tracks either OpenPlanner simulted vehicles or live detection cluster from “lidar_euclidean_cluster_detect” It can simulated frame by frame testing with fixed time intervals 0.1 second.
Requirements
- cloud_clusters
- vector map, in case of using vector map object filtering (to disable using vector map set “vector map filter distance” to 0)
- op percepion simulator, in case of simulation, also vector map filtering should be disabled.
How to launch
- From a sourced terminal:
roslaunch lidar_kf_contour_track lidar_kf_contour_track.launch
- From Runtime Manager:
Computing Tab -> Detection -> lidar_tracker -> lidar_kf_contour_tracker
Subscriptions/Publications
Publications:
* /tracked_objects [autoware_msgs::DetectedObjectArray]
* /detected_polygons [visualization_msgs::MarkerArray]
* /op_planner_tracked_boxes [jsk_recognition_msgs::BoundingBoxArray]
Subscriptions:
* /cloud_cluster [autoware_msgs::CloudClusterArray]
* /current_pose [geometry_msgs::PoseStamped]
* /vector_map_info/*
Changelog for package lidar_kf_contour_track
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
- Contributors: 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
- Fix Ros/ROS naming convention
- Contributors: Esteve Fernandez, amc-nu
1.9.1 (2018-11-06)
1.9.0 (2018-10-31)
File truncated at 100 lines see the full file
Package Dependencies
Deps | Name |
---|---|
autoware_build_flags | |
catkin | |
autoware_msgs | |
cv_bridge | |
geometry_msgs | |
jsk_recognition_msgs | |
op_planner | |
op_ros_helpers | |
roscpp | |
tf | |
pcl_conversions |
System Dependencies
Dependant Packages
Launch files
- launch/lidar_kf_contour_track.launch
-
- vehicle_width [default: 1.85]
- vehicle_length [default: 4.2]
- min_object_size [default: 0.1]
- max_object_size [default: 30.0]
- polygon_quarters [default: 16]
- polygon_resolution [default: 0.5]
- tracking_type [default: 0]
- max_association_distance [default: 4.5]
- max_association_size_diff [default: 2.0]
- max_remeber_time [default: 3]
- trust_counter [default: 4]
- enableSimulationMode [default: false]
- enableStepByStepMode [default: false]
- vector_map_filter_distance [default: 2.0]
- enableLogging [default: false]
Messages
Services
Plugins
Recent questions tagged lidar_kf_contour_track 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
- amc
Authors
KF based Object Tracker
kf contour tracker
This nodes contains three options of tracking
- Association only
- Simple KF tracking
- Contour area plust memory tracker (divid the horizon into contours and associate memory for each circle, which represent the maximum life time of each object)
Outputs
This tracker output (pose, heading, velocity) in global coordinates.
Object Filtering
It can filter detected objects by size or/and vector map lanes proximity.
Options
It tracks either OpenPlanner simulted vehicles or live detection cluster from “lidar_euclidean_cluster_detect” It can simulated frame by frame testing with fixed time intervals 0.1 second.
Requirements
- cloud_clusters
- vector map, in case of using vector map object filtering (to disable using vector map set “vector map filter distance” to 0)
- op percepion simulator, in case of simulation, also vector map filtering should be disabled.
How to launch
- From a sourced terminal:
roslaunch lidar_kf_contour_track lidar_kf_contour_track.launch
- From Runtime Manager:
Computing Tab -> Detection -> lidar_tracker -> lidar_kf_contour_tracker
Subscriptions/Publications
Publications:
* /tracked_objects [autoware_msgs::DetectedObjectArray]
* /detected_polygons [visualization_msgs::MarkerArray]
* /op_planner_tracked_boxes [jsk_recognition_msgs::BoundingBoxArray]
Subscriptions:
* /cloud_cluster [autoware_msgs::CloudClusterArray]
* /current_pose [geometry_msgs::PoseStamped]
* /vector_map_info/*
Changelog for package lidar_kf_contour_track
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
- Contributors: 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
- Fix Ros/ROS naming convention
- Contributors: Esteve Fernandez, amc-nu
1.9.1 (2018-11-06)
1.9.0 (2018-10-31)
File truncated at 100 lines see the full file
Package Dependencies
Deps | Name |
---|---|
autoware_build_flags | |
catkin | |
autoware_msgs | |
cv_bridge | |
geometry_msgs | |
jsk_recognition_msgs | |
op_planner | |
op_ros_helpers | |
roscpp | |
tf | |
pcl_conversions |
System Dependencies
Dependant Packages
Launch files
- launch/lidar_kf_contour_track.launch
-
- vehicle_width [default: 1.85]
- vehicle_length [default: 4.2]
- min_object_size [default: 0.1]
- max_object_size [default: 30.0]
- polygon_quarters [default: 16]
- polygon_resolution [default: 0.5]
- tracking_type [default: 0]
- max_association_distance [default: 4.5]
- max_association_size_diff [default: 2.0]
- max_remeber_time [default: 3]
- trust_counter [default: 4]
- enableSimulationMode [default: false]
- enableStepByStepMode [default: false]
- vector_map_filter_distance [default: 2.0]
- enableLogging [default: false]
Messages
Services
Plugins
Recent questions tagged lidar_kf_contour_track 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
- amc
Authors
KF based Object Tracker
kf contour tracker
This nodes contains three options of tracking
- Association only
- Simple KF tracking
- Contour area plust memory tracker (divid the horizon into contours and associate memory for each circle, which represent the maximum life time of each object)
Outputs
This tracker output (pose, heading, velocity) in global coordinates.
Object Filtering
It can filter detected objects by size or/and vector map lanes proximity.
Options
It tracks either OpenPlanner simulted vehicles or live detection cluster from “lidar_euclidean_cluster_detect” It can simulated frame by frame testing with fixed time intervals 0.1 second.
Requirements
- cloud_clusters
- vector map, in case of using vector map object filtering (to disable using vector map set “vector map filter distance” to 0)
- op percepion simulator, in case of simulation, also vector map filtering should be disabled.
How to launch
- From a sourced terminal:
roslaunch lidar_kf_contour_track lidar_kf_contour_track.launch
- From Runtime Manager:
Computing Tab -> Detection -> lidar_tracker -> lidar_kf_contour_tracker
Subscriptions/Publications
Publications:
* /tracked_objects [autoware_msgs::DetectedObjectArray]
* /detected_polygons [visualization_msgs::MarkerArray]
* /op_planner_tracked_boxes [jsk_recognition_msgs::BoundingBoxArray]
Subscriptions:
* /cloud_cluster [autoware_msgs::CloudClusterArray]
* /current_pose [geometry_msgs::PoseStamped]
* /vector_map_info/*
Changelog for package lidar_kf_contour_track
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
- Contributors: 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
- Fix Ros/ROS naming convention
- Contributors: Esteve Fernandez, amc-nu
1.9.1 (2018-11-06)
1.9.0 (2018-10-31)
File truncated at 100 lines see the full file
Package Dependencies
Deps | Name |
---|---|
autoware_build_flags | |
catkin | |
autoware_msgs | |
cv_bridge | |
geometry_msgs | |
jsk_recognition_msgs | |
op_planner | |
op_ros_helpers | |
roscpp | |
tf | |
pcl_conversions |
System Dependencies
Dependant Packages
Launch files
- launch/lidar_kf_contour_track.launch
-
- vehicle_width [default: 1.85]
- vehicle_length [default: 4.2]
- min_object_size [default: 0.1]
- max_object_size [default: 30.0]
- polygon_quarters [default: 16]
- polygon_resolution [default: 0.5]
- tracking_type [default: 0]
- max_association_distance [default: 4.5]
- max_association_size_diff [default: 2.0]
- max_remeber_time [default: 3]
- trust_counter [default: 4]
- enableSimulationMode [default: false]
- enableStepByStepMode [default: false]
- vector_map_filter_distance [default: 2.0]
- enableLogging [default: false]
Messages
Services
Plugins
Recent questions tagged lidar_kf_contour_track 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
- amc
Authors
KF based Object Tracker
kf contour tracker
This nodes contains three options of tracking
- Association only
- Simple KF tracking
- Contour area plust memory tracker (divid the horizon into contours and associate memory for each circle, which represent the maximum life time of each object)
Outputs
This tracker output (pose, heading, velocity) in global coordinates.
Object Filtering
It can filter detected objects by size or/and vector map lanes proximity.
Options
It tracks either OpenPlanner simulted vehicles or live detection cluster from “lidar_euclidean_cluster_detect” It can simulated frame by frame testing with fixed time intervals 0.1 second.
Requirements
- cloud_clusters
- vector map, in case of using vector map object filtering (to disable using vector map set “vector map filter distance” to 0)
- op percepion simulator, in case of simulation, also vector map filtering should be disabled.
How to launch
- From a sourced terminal:
roslaunch lidar_kf_contour_track lidar_kf_contour_track.launch
- From Runtime Manager:
Computing Tab -> Detection -> lidar_tracker -> lidar_kf_contour_tracker
Subscriptions/Publications
Publications:
* /tracked_objects [autoware_msgs::DetectedObjectArray]
* /detected_polygons [visualization_msgs::MarkerArray]
* /op_planner_tracked_boxes [jsk_recognition_msgs::BoundingBoxArray]
Subscriptions:
* /cloud_cluster [autoware_msgs::CloudClusterArray]
* /current_pose [geometry_msgs::PoseStamped]
* /vector_map_info/*
Changelog for package lidar_kf_contour_track
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
- Contributors: 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
- Fix Ros/ROS naming convention
- Contributors: Esteve Fernandez, amc-nu
1.9.1 (2018-11-06)
1.9.0 (2018-10-31)
File truncated at 100 lines see the full file
Package Dependencies
Deps | Name |
---|---|
autoware_build_flags | |
catkin | |
autoware_msgs | |
cv_bridge | |
geometry_msgs | |
jsk_recognition_msgs | |
op_planner | |
op_ros_helpers | |
roscpp | |
tf | |
pcl_conversions |
System Dependencies
Dependant Packages
Launch files
- launch/lidar_kf_contour_track.launch
-
- vehicle_width [default: 1.85]
- vehicle_length [default: 4.2]
- min_object_size [default: 0.1]
- max_object_size [default: 30.0]
- polygon_quarters [default: 16]
- polygon_resolution [default: 0.5]
- tracking_type [default: 0]
- max_association_distance [default: 4.5]
- max_association_size_diff [default: 2.0]
- max_remeber_time [default: 3]
- trust_counter [default: 4]
- enableSimulationMode [default: false]
- enableStepByStepMode [default: false]
- vector_map_filter_distance [default: 2.0]
- enableLogging [default: false]
Messages
Services
Plugins
Recent questions tagged lidar_kf_contour_track 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
- amc
Authors
KF based Object Tracker
kf contour tracker
This nodes contains three options of tracking
- Association only
- Simple KF tracking
- Contour area plust memory tracker (divid the horizon into contours and associate memory for each circle, which represent the maximum life time of each object)
Outputs
This tracker output (pose, heading, velocity) in global coordinates.
Object Filtering
It can filter detected objects by size or/and vector map lanes proximity.
Options
It tracks either OpenPlanner simulted vehicles or live detection cluster from “lidar_euclidean_cluster_detect” It can simulated frame by frame testing with fixed time intervals 0.1 second.
Requirements
- cloud_clusters
- vector map, in case of using vector map object filtering (to disable using vector map set “vector map filter distance” to 0)
- op percepion simulator, in case of simulation, also vector map filtering should be disabled.
How to launch
- From a sourced terminal:
roslaunch lidar_kf_contour_track lidar_kf_contour_track.launch
- From Runtime Manager:
Computing Tab -> Detection -> lidar_tracker -> lidar_kf_contour_tracker
Subscriptions/Publications
Publications:
* /tracked_objects [autoware_msgs::DetectedObjectArray]
* /detected_polygons [visualization_msgs::MarkerArray]
* /op_planner_tracked_boxes [jsk_recognition_msgs::BoundingBoxArray]
Subscriptions:
* /cloud_cluster [autoware_msgs::CloudClusterArray]
* /current_pose [geometry_msgs::PoseStamped]
* /vector_map_info/*
Changelog for package lidar_kf_contour_track
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
- Contributors: 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
- Fix Ros/ROS naming convention
- Contributors: Esteve Fernandez, amc-nu
1.9.1 (2018-11-06)
1.9.0 (2018-10-31)
File truncated at 100 lines see the full file
Package Dependencies
Deps | Name |
---|---|
autoware_build_flags | |
catkin | |
autoware_msgs | |
cv_bridge | |
geometry_msgs | |
jsk_recognition_msgs | |
op_planner | |
op_ros_helpers | |
roscpp | |
tf | |
pcl_conversions |
System Dependencies
Dependant Packages
Launch files
- launch/lidar_kf_contour_track.launch
-
- vehicle_width [default: 1.85]
- vehicle_length [default: 4.2]
- min_object_size [default: 0.1]
- max_object_size [default: 30.0]
- polygon_quarters [default: 16]
- polygon_resolution [default: 0.5]
- tracking_type [default: 0]
- max_association_distance [default: 4.5]
- max_association_size_diff [default: 2.0]
- max_remeber_time [default: 3]
- trust_counter [default: 4]
- enableSimulationMode [default: false]
- enableStepByStepMode [default: false]
- vector_map_filter_distance [default: 2.0]
- enableLogging [default: false]
Messages
Services
Plugins
Recent questions tagged lidar_kf_contour_track 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
- amc
Authors
KF based Object Tracker
kf contour tracker
This nodes contains three options of tracking
- Association only
- Simple KF tracking
- Contour area plust memory tracker (divid the horizon into contours and associate memory for each circle, which represent the maximum life time of each object)
Outputs
This tracker output (pose, heading, velocity) in global coordinates.
Object Filtering
It can filter detected objects by size or/and vector map lanes proximity.
Options
It tracks either OpenPlanner simulted vehicles or live detection cluster from “lidar_euclidean_cluster_detect” It can simulated frame by frame testing with fixed time intervals 0.1 second.
Requirements
- cloud_clusters
- vector map, in case of using vector map object filtering (to disable using vector map set “vector map filter distance” to 0)
- op percepion simulator, in case of simulation, also vector map filtering should be disabled.
How to launch
- From a sourced terminal:
roslaunch lidar_kf_contour_track lidar_kf_contour_track.launch
- From Runtime Manager:
Computing Tab -> Detection -> lidar_tracker -> lidar_kf_contour_tracker
Subscriptions/Publications
Publications:
* /tracked_objects [autoware_msgs::DetectedObjectArray]
* /detected_polygons [visualization_msgs::MarkerArray]
* /op_planner_tracked_boxes [jsk_recognition_msgs::BoundingBoxArray]
Subscriptions:
* /cloud_cluster [autoware_msgs::CloudClusterArray]
* /current_pose [geometry_msgs::PoseStamped]
* /vector_map_info/*
Changelog for package lidar_kf_contour_track
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
- Contributors: 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
- Fix Ros/ROS naming convention
- Contributors: Esteve Fernandez, amc-nu
1.9.1 (2018-11-06)
1.9.0 (2018-10-31)
File truncated at 100 lines see the full file
Package Dependencies
Deps | Name |
---|---|
autoware_build_flags | |
catkin | |
autoware_msgs | |
cv_bridge | |
geometry_msgs | |
jsk_recognition_msgs | |
op_planner | |
op_ros_helpers | |
roscpp | |
tf | |
pcl_conversions |
System Dependencies
Dependant Packages
Launch files
- launch/lidar_kf_contour_track.launch
-
- vehicle_width [default: 1.85]
- vehicle_length [default: 4.2]
- min_object_size [default: 0.1]
- max_object_size [default: 30.0]
- polygon_quarters [default: 16]
- polygon_resolution [default: 0.5]
- tracking_type [default: 0]
- max_association_distance [default: 4.5]
- max_association_size_diff [default: 2.0]
- max_remeber_time [default: 3]
- trust_counter [default: 4]
- enableSimulationMode [default: false]
- enableStepByStepMode [default: false]
- vector_map_filter_distance [default: 2.0]
- enableLogging [default: false]
Messages
Services
Plugins
Recent questions tagged lidar_kf_contour_track 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
- amc
Authors
KF based Object Tracker
kf contour tracker
This nodes contains three options of tracking
- Association only
- Simple KF tracking
- Contour area plust memory tracker (divid the horizon into contours and associate memory for each circle, which represent the maximum life time of each object)
Outputs
This tracker output (pose, heading, velocity) in global coordinates.
Object Filtering
It can filter detected objects by size or/and vector map lanes proximity.
Options
It tracks either OpenPlanner simulted vehicles or live detection cluster from “lidar_euclidean_cluster_detect” It can simulated frame by frame testing with fixed time intervals 0.1 second.
Requirements
- cloud_clusters
- vector map, in case of using vector map object filtering (to disable using vector map set “vector map filter distance” to 0)
- op percepion simulator, in case of simulation, also vector map filtering should be disabled.
How to launch
- From a sourced terminal:
roslaunch lidar_kf_contour_track lidar_kf_contour_track.launch
- From Runtime Manager:
Computing Tab -> Detection -> lidar_tracker -> lidar_kf_contour_tracker
Subscriptions/Publications
Publications:
* /tracked_objects [autoware_msgs::DetectedObjectArray]
* /detected_polygons [visualization_msgs::MarkerArray]
* /op_planner_tracked_boxes [jsk_recognition_msgs::BoundingBoxArray]
Subscriptions:
* /cloud_cluster [autoware_msgs::CloudClusterArray]
* /current_pose [geometry_msgs::PoseStamped]
* /vector_map_info/*
Changelog for package lidar_kf_contour_track
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
- Contributors: 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
- Fix Ros/ROS naming convention
- Contributors: Esteve Fernandez, amc-nu
1.9.1 (2018-11-06)
1.9.0 (2018-10-31)
File truncated at 100 lines see the full file
Package Dependencies
Deps | Name |
---|---|
autoware_build_flags | |
catkin | |
autoware_msgs | |
cv_bridge | |
geometry_msgs | |
jsk_recognition_msgs | |
op_planner | |
op_ros_helpers | |
roscpp | |
tf | |
pcl_conversions |
System Dependencies
Dependant Packages
Launch files
- launch/lidar_kf_contour_track.launch
-
- vehicle_width [default: 1.85]
- vehicle_length [default: 4.2]
- min_object_size [default: 0.1]
- max_object_size [default: 30.0]
- polygon_quarters [default: 16]
- polygon_resolution [default: 0.5]
- tracking_type [default: 0]
- max_association_distance [default: 4.5]
- max_association_size_diff [default: 2.0]
- max_remeber_time [default: 3]
- trust_counter [default: 4]
- enableSimulationMode [default: false]
- enableStepByStepMode [default: false]
- vector_map_filter_distance [default: 2.0]
- enableLogging [default: false]
Messages
Services
Plugins
Recent questions tagged lidar_kf_contour_track 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
- amc
Authors
KF based Object Tracker
kf contour tracker
This nodes contains three options of tracking
- Association only
- Simple KF tracking
- Contour area plust memory tracker (divid the horizon into contours and associate memory for each circle, which represent the maximum life time of each object)
Outputs
This tracker output (pose, heading, velocity) in global coordinates.
Object Filtering
It can filter detected objects by size or/and vector map lanes proximity.
Options
It tracks either OpenPlanner simulted vehicles or live detection cluster from “lidar_euclidean_cluster_detect” It can simulated frame by frame testing with fixed time intervals 0.1 second.
Requirements
- cloud_clusters
- vector map, in case of using vector map object filtering (to disable using vector map set “vector map filter distance” to 0)
- op percepion simulator, in case of simulation, also vector map filtering should be disabled.
How to launch
- From a sourced terminal:
roslaunch lidar_kf_contour_track lidar_kf_contour_track.launch
- From Runtime Manager:
Computing Tab -> Detection -> lidar_tracker -> lidar_kf_contour_tracker
Subscriptions/Publications
Publications:
* /tracked_objects [autoware_msgs::DetectedObjectArray]
* /detected_polygons [visualization_msgs::MarkerArray]
* /op_planner_tracked_boxes [jsk_recognition_msgs::BoundingBoxArray]
Subscriptions:
* /cloud_cluster [autoware_msgs::CloudClusterArray]
* /current_pose [geometry_msgs::PoseStamped]
* /vector_map_info/*
Changelog for package lidar_kf_contour_track
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
- Contributors: 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
- Fix Ros/ROS naming convention
- Contributors: Esteve Fernandez, amc-nu
1.9.1 (2018-11-06)
1.9.0 (2018-10-31)
File truncated at 100 lines see the full file
Package Dependencies
Deps | Name |
---|---|
autoware_build_flags | |
catkin | |
autoware_msgs | |
cv_bridge | |
geometry_msgs | |
jsk_recognition_msgs | |
op_planner | |
op_ros_helpers | |
roscpp | |
tf | |
pcl_conversions |
System Dependencies
Dependant Packages
Launch files
- launch/lidar_kf_contour_track.launch
-
- vehicle_width [default: 1.85]
- vehicle_length [default: 4.2]
- min_object_size [default: 0.1]
- max_object_size [default: 30.0]
- polygon_quarters [default: 16]
- polygon_resolution [default: 0.5]
- tracking_type [default: 0]
- max_association_distance [default: 4.5]
- max_association_size_diff [default: 2.0]
- max_remeber_time [default: 3]
- trust_counter [default: 4]
- enableSimulationMode [default: false]
- enableStepByStepMode [default: false]
- vector_map_filter_distance [default: 2.0]
- enableLogging [default: false]