No version for distro humble showing github. Known supported distros are highlighted in the buttons above.
Package symbol

naive_motion_predict package from autoware_learn repo

amathutils_lib autoware_build_flags autoware_health_checker emergency_handler gnss lanelet2_extension libvectormap libwaypoint_follower map_file object_map op_planner op_ros_helpers op_simu op_utility ros_observer tvm_utility vector_map vector_map_server vehicle_sim_model autoware_connector ekf_localizer gnss_localizer image_processor imm_ukf_pda_track lidar_apollo_cnn_seg_detect lidar_euclidean_cluster_detect lidar_fake_perception lidar_kf_contour_track lidar_localizer lidar_naive_l_shape_detect lidar_point_pillars lidar_shape_estimation naive_motion_predict ndt_cpu ndt_gpu ndt_tku obj_db pcl_omp_registration pixel_cloud_fusion points_downsampler points_preprocessor pos_db range_vision_fusion road_occupancy_processor roi_object_filter trafficlight_recognizer twist_generator vel_pose_diff_checker vision_beyond_track vision_darknet_detect vision_lane_detect vision_segment_enet_detect vision_ssd_detect astar_search costmap_generator decision_maker dp_planner ff_waypoint_follower freespace_planner lane_planner lattice_planner ll2_global_planner mpc_follower op_global_planner op_local_planner op_simulation_package op_utilities pure_pursuit state_machine_lib twist_filter twist_gate way_planner waypoint_maker waypoint_planner autoware_quickstart_examples autoware_can_msgs autoware_config_msgs autoware_external_msgs autoware_lanelet2_msgs autoware_map_msgs autoware_msgs autoware_system_msgs tablet_socket_msgs vector_map_msgs carla_autoware_bridge gazebo_camera_description gazebo_imu_description lgsvl_simulator_bridge vehicle_gazebo_simulation_interface vehicle_gazebo_simulation_launcher wf_simulator autoware_bag_tools autoware_camera_lidar_calibrator autoware_launcher autoware_launcher_rviz calibration_publisher data_preprocessor graph_tools kitti_box_publisher kitti_launch kitti_player lanelet_aisan_converter log_tools map_tf_generator map_tools marker_downsampler mqtt_socket multi_lidar_calibrator oculus_socket pc2_downsampler rosbag_controller runtime_manager sound_player system_monitor tablet_socket twist2odom udon_socket vehicle_engage_panel vehicle_socket decision_maker_panel detected_objects_visualizer fastvirtualscan gazebo_world_description glviewer integrated_viewer points2image rosinterface autoware_rviz_plugins vehicle_description vehicle_model adi_driver as autoware_driveworks_gmsl_interface autoware_driveworks_interface vlg22c_cam custom_msgs garmin hokuyo javad_navsat_driver kvaser sick_lms5xx memsic_imu microstrain_driver nmea_navsat autoware_pointgrey_drivers sick_ldmrs_description sick_ldmrs_driver sick_ldmrs_laser sick_ldmrs_msgs sick_ldmrs_tools vectacam xsens_driver ymc ds4 ds4_driver ds4_msgs lanelet2 lanelet2_core lanelet2_examples lanelet2_io lanelet2_maps lanelet2_matching lanelet2_projection lanelet2_python lanelet2_routing lanelet2_traffic_rules lanelet2_validation mrt_cmake_modules

ROS Distro
github

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

The naive_motion_predict package

Additional Links

No additional links.

Maintainers

  • Kosuke Murakami

Authors

No additional authors.

Naive Motion Prediction

Autoware package for motion prediction.

  • From a sourced terminal:

roslaunch naive_motion_predict naive_motion_predict.launch

  • From Runtime Manager:

Computing Tab -> Prediction/ Motion Predictor -> naive_motion_predict

Requirements

  • ray_ground_filter node.
  • eucledian_cluster node.
  • /tf topic. velodyne to world.
  • imm_ukf_pda_tracker node.

Parameters

Launch file available parameters for naive_motion_predict

Parameter Type Description
input topic String Input topic(type: autoware_msgs::DetectedObjectArray). Default /detection/lidar_tracker/objects.
interval_sec Double Interval second for prediction. Default 9.22.
num_prediction Int The number of prediction this node will make. Default 0.99.
sensor_height Double Uses sensor height for visualized path’s height. Default 0.9.

Subscribed topics

Topic Type Objective
/detection/objects autoware_msgs::DetectedObjectArray The result topic from Autoware Detection stack

Published topics

Topic Type Objective
/prediction/objects autoware_msgs::DetectedObjectArray Added predicted objects to input data..
/prediction/motion_predictor/path_markers visualization_msgs::MarkerArray Visualzing predicted path in ros marker array

Video

Autoware: How to launch naive motion predict

CHANGELOG

Changelog for package naive_motion_predict

1.11.0 (2019-03-21)

  • [fix] not predicting objects at x<=0 or y<=0 (#2122)
  • [Feature] costmap generator (#1774)
      • Initial commit for visualization package
    • Removal of all visualization messages from perception nodes

    • Visualization dependency removal

    • Launch file modification

      • Fixes to visualization
    • Error on Clustering CPU

    • Reduce verbosity on markers

    • Publish acceleration and velocity from ukf tracker

    • Remove hardcoded path

    • Updated README

    • updated prototype

    • Prototype update for header and usage

    • Removed unknown label from being reported

    • Updated publishing orientation to match develop

      • Published all the trackers
    • Added valid field for visualization and future compatibility with ADAS ROI filtering

    • Add simple functions

      • Reversed back UKF node to develop
    • Formatted speed

    • Refactor codes

    • Make tracking visualization work

    • Relay class info in tracker node

    • Remove dependency to jskbbox and rosmarker in ukf tracker

    • apply rosclang to ukf tracker

    • Refactor codes

    • Revert "apply rosclang to ukf tracker"

    • Revert "Remove dependency to jskbbox and rosmarker in ukf tracker"

    • Revert "Relay class info in tracker node"

    • delete dependency to jsk and remove pointcloud_frame

    • get direction nis

    • set velocity_reliable true in tracker node

    • Add divided function

    • add function

    • Sanity checks

    • Relay all the data from input DetectedObject

    • Divided function work both for immukf and sukf

    • Add comment

    • Refactor codes

    • Pass immukf test

    • make direction assisted tracking work

    • Visualization fixes

    • Refactor codes

    • Tracker Merging step added

    • Added launch file support for merging phase

    • lane assisted with sukf

File truncated at 100 lines see the full file

Package Dependencies

System Dependencies

No direct system dependencies.

Dependant Packages

No known dependants.

Launch files

  • launch/naive_motion_predict.launch
    • Launch file for naive_motion_predict
      • interval_sec [default: 0.1]
      • num_prediction [default: 10]
      • sensor_height [default: 2.0]
      • filter_out_close_object_threshold [default: 1.5]
      • input_topic [default: /detection/objects]

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged naive_motion_predict at Robotics Stack Exchange

No version for distro jazzy showing github. Known supported distros are highlighted in the buttons above.
Package symbol

naive_motion_predict package from autoware_learn repo

amathutils_lib autoware_build_flags autoware_health_checker emergency_handler gnss lanelet2_extension libvectormap libwaypoint_follower map_file object_map op_planner op_ros_helpers op_simu op_utility ros_observer tvm_utility vector_map vector_map_server vehicle_sim_model autoware_connector ekf_localizer gnss_localizer image_processor imm_ukf_pda_track lidar_apollo_cnn_seg_detect lidar_euclidean_cluster_detect lidar_fake_perception lidar_kf_contour_track lidar_localizer lidar_naive_l_shape_detect lidar_point_pillars lidar_shape_estimation naive_motion_predict ndt_cpu ndt_gpu ndt_tku obj_db pcl_omp_registration pixel_cloud_fusion points_downsampler points_preprocessor pos_db range_vision_fusion road_occupancy_processor roi_object_filter trafficlight_recognizer twist_generator vel_pose_diff_checker vision_beyond_track vision_darknet_detect vision_lane_detect vision_segment_enet_detect vision_ssd_detect astar_search costmap_generator decision_maker dp_planner ff_waypoint_follower freespace_planner lane_planner lattice_planner ll2_global_planner mpc_follower op_global_planner op_local_planner op_simulation_package op_utilities pure_pursuit state_machine_lib twist_filter twist_gate way_planner waypoint_maker waypoint_planner autoware_quickstart_examples autoware_can_msgs autoware_config_msgs autoware_external_msgs autoware_lanelet2_msgs autoware_map_msgs autoware_msgs autoware_system_msgs tablet_socket_msgs vector_map_msgs carla_autoware_bridge gazebo_camera_description gazebo_imu_description lgsvl_simulator_bridge vehicle_gazebo_simulation_interface vehicle_gazebo_simulation_launcher wf_simulator autoware_bag_tools autoware_camera_lidar_calibrator autoware_launcher autoware_launcher_rviz calibration_publisher data_preprocessor graph_tools kitti_box_publisher kitti_launch kitti_player lanelet_aisan_converter log_tools map_tf_generator map_tools marker_downsampler mqtt_socket multi_lidar_calibrator oculus_socket pc2_downsampler rosbag_controller runtime_manager sound_player system_monitor tablet_socket twist2odom udon_socket vehicle_engage_panel vehicle_socket decision_maker_panel detected_objects_visualizer fastvirtualscan gazebo_world_description glviewer integrated_viewer points2image rosinterface autoware_rviz_plugins vehicle_description vehicle_model adi_driver as autoware_driveworks_gmsl_interface autoware_driveworks_interface vlg22c_cam custom_msgs garmin hokuyo javad_navsat_driver kvaser sick_lms5xx memsic_imu microstrain_driver nmea_navsat autoware_pointgrey_drivers sick_ldmrs_description sick_ldmrs_driver sick_ldmrs_laser sick_ldmrs_msgs sick_ldmrs_tools vectacam xsens_driver ymc ds4 ds4_driver ds4_msgs lanelet2 lanelet2_core lanelet2_examples lanelet2_io lanelet2_maps lanelet2_matching lanelet2_projection lanelet2_python lanelet2_routing lanelet2_traffic_rules lanelet2_validation mrt_cmake_modules

ROS Distro
github

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

The naive_motion_predict package

Additional Links

No additional links.

Maintainers

  • Kosuke Murakami

Authors

No additional authors.

Naive Motion Prediction

Autoware package for motion prediction.

  • From a sourced terminal:

roslaunch naive_motion_predict naive_motion_predict.launch

  • From Runtime Manager:

Computing Tab -> Prediction/ Motion Predictor -> naive_motion_predict

Requirements

  • ray_ground_filter node.
  • eucledian_cluster node.
  • /tf topic. velodyne to world.
  • imm_ukf_pda_tracker node.

Parameters

Launch file available parameters for naive_motion_predict

Parameter Type Description
input topic String Input topic(type: autoware_msgs::DetectedObjectArray). Default /detection/lidar_tracker/objects.
interval_sec Double Interval second for prediction. Default 9.22.
num_prediction Int The number of prediction this node will make. Default 0.99.
sensor_height Double Uses sensor height for visualized path’s height. Default 0.9.

Subscribed topics

Topic Type Objective
/detection/objects autoware_msgs::DetectedObjectArray The result topic from Autoware Detection stack

Published topics

Topic Type Objective
/prediction/objects autoware_msgs::DetectedObjectArray Added predicted objects to input data..
/prediction/motion_predictor/path_markers visualization_msgs::MarkerArray Visualzing predicted path in ros marker array

Video

Autoware: How to launch naive motion predict

CHANGELOG

Changelog for package naive_motion_predict

1.11.0 (2019-03-21)

  • [fix] not predicting objects at x<=0 or y<=0 (#2122)
  • [Feature] costmap generator (#1774)
      • Initial commit for visualization package
    • Removal of all visualization messages from perception nodes

    • Visualization dependency removal

    • Launch file modification

      • Fixes to visualization
    • Error on Clustering CPU

    • Reduce verbosity on markers

    • Publish acceleration and velocity from ukf tracker

    • Remove hardcoded path

    • Updated README

    • updated prototype

    • Prototype update for header and usage

    • Removed unknown label from being reported

    • Updated publishing orientation to match develop

      • Published all the trackers
    • Added valid field for visualization and future compatibility with ADAS ROI filtering

    • Add simple functions

      • Reversed back UKF node to develop
    • Formatted speed

    • Refactor codes

    • Make tracking visualization work

    • Relay class info in tracker node

    • Remove dependency to jskbbox and rosmarker in ukf tracker

    • apply rosclang to ukf tracker

    • Refactor codes

    • Revert "apply rosclang to ukf tracker"

    • Revert "Remove dependency to jskbbox and rosmarker in ukf tracker"

    • Revert "Relay class info in tracker node"

    • delete dependency to jsk and remove pointcloud_frame

    • get direction nis

    • set velocity_reliable true in tracker node

    • Add divided function

    • add function

    • Sanity checks

    • Relay all the data from input DetectedObject

    • Divided function work both for immukf and sukf

    • Add comment

    • Refactor codes

    • Pass immukf test

    • make direction assisted tracking work

    • Visualization fixes

    • Refactor codes

    • Tracker Merging step added

    • Added launch file support for merging phase

    • lane assisted with sukf

File truncated at 100 lines see the full file

Package Dependencies

System Dependencies

No direct system dependencies.

Dependant Packages

No known dependants.

Launch files

  • launch/naive_motion_predict.launch
    • Launch file for naive_motion_predict
      • interval_sec [default: 0.1]
      • num_prediction [default: 10]
      • sensor_height [default: 2.0]
      • filter_out_close_object_threshold [default: 1.5]
      • input_topic [default: /detection/objects]

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged naive_motion_predict at Robotics Stack Exchange

No version for distro kilted showing github. Known supported distros are highlighted in the buttons above.
Package symbol

naive_motion_predict package from autoware_learn repo

amathutils_lib autoware_build_flags autoware_health_checker emergency_handler gnss lanelet2_extension libvectormap libwaypoint_follower map_file object_map op_planner op_ros_helpers op_simu op_utility ros_observer tvm_utility vector_map vector_map_server vehicle_sim_model autoware_connector ekf_localizer gnss_localizer image_processor imm_ukf_pda_track lidar_apollo_cnn_seg_detect lidar_euclidean_cluster_detect lidar_fake_perception lidar_kf_contour_track lidar_localizer lidar_naive_l_shape_detect lidar_point_pillars lidar_shape_estimation naive_motion_predict ndt_cpu ndt_gpu ndt_tku obj_db pcl_omp_registration pixel_cloud_fusion points_downsampler points_preprocessor pos_db range_vision_fusion road_occupancy_processor roi_object_filter trafficlight_recognizer twist_generator vel_pose_diff_checker vision_beyond_track vision_darknet_detect vision_lane_detect vision_segment_enet_detect vision_ssd_detect astar_search costmap_generator decision_maker dp_planner ff_waypoint_follower freespace_planner lane_planner lattice_planner ll2_global_planner mpc_follower op_global_planner op_local_planner op_simulation_package op_utilities pure_pursuit state_machine_lib twist_filter twist_gate way_planner waypoint_maker waypoint_planner autoware_quickstart_examples autoware_can_msgs autoware_config_msgs autoware_external_msgs autoware_lanelet2_msgs autoware_map_msgs autoware_msgs autoware_system_msgs tablet_socket_msgs vector_map_msgs carla_autoware_bridge gazebo_camera_description gazebo_imu_description lgsvl_simulator_bridge vehicle_gazebo_simulation_interface vehicle_gazebo_simulation_launcher wf_simulator autoware_bag_tools autoware_camera_lidar_calibrator autoware_launcher autoware_launcher_rviz calibration_publisher data_preprocessor graph_tools kitti_box_publisher kitti_launch kitti_player lanelet_aisan_converter log_tools map_tf_generator map_tools marker_downsampler mqtt_socket multi_lidar_calibrator oculus_socket pc2_downsampler rosbag_controller runtime_manager sound_player system_monitor tablet_socket twist2odom udon_socket vehicle_engage_panel vehicle_socket decision_maker_panel detected_objects_visualizer fastvirtualscan gazebo_world_description glviewer integrated_viewer points2image rosinterface autoware_rviz_plugins vehicle_description vehicle_model adi_driver as autoware_driveworks_gmsl_interface autoware_driveworks_interface vlg22c_cam custom_msgs garmin hokuyo javad_navsat_driver kvaser sick_lms5xx memsic_imu microstrain_driver nmea_navsat autoware_pointgrey_drivers sick_ldmrs_description sick_ldmrs_driver sick_ldmrs_laser sick_ldmrs_msgs sick_ldmrs_tools vectacam xsens_driver ymc ds4 ds4_driver ds4_msgs lanelet2 lanelet2_core lanelet2_examples lanelet2_io lanelet2_maps lanelet2_matching lanelet2_projection lanelet2_python lanelet2_routing lanelet2_traffic_rules lanelet2_validation mrt_cmake_modules

ROS Distro
github

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

The naive_motion_predict package

Additional Links

No additional links.

Maintainers

  • Kosuke Murakami

Authors

No additional authors.

Naive Motion Prediction

Autoware package for motion prediction.

  • From a sourced terminal:

roslaunch naive_motion_predict naive_motion_predict.launch

  • From Runtime Manager:

Computing Tab -> Prediction/ Motion Predictor -> naive_motion_predict

Requirements

  • ray_ground_filter node.
  • eucledian_cluster node.
  • /tf topic. velodyne to world.
  • imm_ukf_pda_tracker node.

Parameters

Launch file available parameters for naive_motion_predict

Parameter Type Description
input topic String Input topic(type: autoware_msgs::DetectedObjectArray). Default /detection/lidar_tracker/objects.
interval_sec Double Interval second for prediction. Default 9.22.
num_prediction Int The number of prediction this node will make. Default 0.99.
sensor_height Double Uses sensor height for visualized path’s height. Default 0.9.

Subscribed topics

Topic Type Objective
/detection/objects autoware_msgs::DetectedObjectArray The result topic from Autoware Detection stack

Published topics

Topic Type Objective
/prediction/objects autoware_msgs::DetectedObjectArray Added predicted objects to input data..
/prediction/motion_predictor/path_markers visualization_msgs::MarkerArray Visualzing predicted path in ros marker array

Video

Autoware: How to launch naive motion predict

CHANGELOG

Changelog for package naive_motion_predict

1.11.0 (2019-03-21)

  • [fix] not predicting objects at x<=0 or y<=0 (#2122)
  • [Feature] costmap generator (#1774)
      • Initial commit for visualization package
    • Removal of all visualization messages from perception nodes

    • Visualization dependency removal

    • Launch file modification

      • Fixes to visualization
    • Error on Clustering CPU

    • Reduce verbosity on markers

    • Publish acceleration and velocity from ukf tracker

    • Remove hardcoded path

    • Updated README

    • updated prototype

    • Prototype update for header and usage

    • Removed unknown label from being reported

    • Updated publishing orientation to match develop

      • Published all the trackers
    • Added valid field for visualization and future compatibility with ADAS ROI filtering

    • Add simple functions

      • Reversed back UKF node to develop
    • Formatted speed

    • Refactor codes

    • Make tracking visualization work

    • Relay class info in tracker node

    • Remove dependency to jskbbox and rosmarker in ukf tracker

    • apply rosclang to ukf tracker

    • Refactor codes

    • Revert "apply rosclang to ukf tracker"

    • Revert "Remove dependency to jskbbox and rosmarker in ukf tracker"

    • Revert "Relay class info in tracker node"

    • delete dependency to jsk and remove pointcloud_frame

    • get direction nis

    • set velocity_reliable true in tracker node

    • Add divided function

    • add function

    • Sanity checks

    • Relay all the data from input DetectedObject

    • Divided function work both for immukf and sukf

    • Add comment

    • Refactor codes

    • Pass immukf test

    • make direction assisted tracking work

    • Visualization fixes

    • Refactor codes

    • Tracker Merging step added

    • Added launch file support for merging phase

    • lane assisted with sukf

File truncated at 100 lines see the full file

Package Dependencies

System Dependencies

No direct system dependencies.

Dependant Packages

No known dependants.

Launch files

  • launch/naive_motion_predict.launch
    • Launch file for naive_motion_predict
      • interval_sec [default: 0.1]
      • num_prediction [default: 10]
      • sensor_height [default: 2.0]
      • filter_out_close_object_threshold [default: 1.5]
      • input_topic [default: /detection/objects]

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged naive_motion_predict at Robotics Stack Exchange

No version for distro rolling showing github. Known supported distros are highlighted in the buttons above.
Package symbol

naive_motion_predict package from autoware_learn repo

amathutils_lib autoware_build_flags autoware_health_checker emergency_handler gnss lanelet2_extension libvectormap libwaypoint_follower map_file object_map op_planner op_ros_helpers op_simu op_utility ros_observer tvm_utility vector_map vector_map_server vehicle_sim_model autoware_connector ekf_localizer gnss_localizer image_processor imm_ukf_pda_track lidar_apollo_cnn_seg_detect lidar_euclidean_cluster_detect lidar_fake_perception lidar_kf_contour_track lidar_localizer lidar_naive_l_shape_detect lidar_point_pillars lidar_shape_estimation naive_motion_predict ndt_cpu ndt_gpu ndt_tku obj_db pcl_omp_registration pixel_cloud_fusion points_downsampler points_preprocessor pos_db range_vision_fusion road_occupancy_processor roi_object_filter trafficlight_recognizer twist_generator vel_pose_diff_checker vision_beyond_track vision_darknet_detect vision_lane_detect vision_segment_enet_detect vision_ssd_detect astar_search costmap_generator decision_maker dp_planner ff_waypoint_follower freespace_planner lane_planner lattice_planner ll2_global_planner mpc_follower op_global_planner op_local_planner op_simulation_package op_utilities pure_pursuit state_machine_lib twist_filter twist_gate way_planner waypoint_maker waypoint_planner autoware_quickstart_examples autoware_can_msgs autoware_config_msgs autoware_external_msgs autoware_lanelet2_msgs autoware_map_msgs autoware_msgs autoware_system_msgs tablet_socket_msgs vector_map_msgs carla_autoware_bridge gazebo_camera_description gazebo_imu_description lgsvl_simulator_bridge vehicle_gazebo_simulation_interface vehicle_gazebo_simulation_launcher wf_simulator autoware_bag_tools autoware_camera_lidar_calibrator autoware_launcher autoware_launcher_rviz calibration_publisher data_preprocessor graph_tools kitti_box_publisher kitti_launch kitti_player lanelet_aisan_converter log_tools map_tf_generator map_tools marker_downsampler mqtt_socket multi_lidar_calibrator oculus_socket pc2_downsampler rosbag_controller runtime_manager sound_player system_monitor tablet_socket twist2odom udon_socket vehicle_engage_panel vehicle_socket decision_maker_panel detected_objects_visualizer fastvirtualscan gazebo_world_description glviewer integrated_viewer points2image rosinterface autoware_rviz_plugins vehicle_description vehicle_model adi_driver as autoware_driveworks_gmsl_interface autoware_driveworks_interface vlg22c_cam custom_msgs garmin hokuyo javad_navsat_driver kvaser sick_lms5xx memsic_imu microstrain_driver nmea_navsat autoware_pointgrey_drivers sick_ldmrs_description sick_ldmrs_driver sick_ldmrs_laser sick_ldmrs_msgs sick_ldmrs_tools vectacam xsens_driver ymc ds4 ds4_driver ds4_msgs lanelet2 lanelet2_core lanelet2_examples lanelet2_io lanelet2_maps lanelet2_matching lanelet2_projection lanelet2_python lanelet2_routing lanelet2_traffic_rules lanelet2_validation mrt_cmake_modules

ROS Distro
github

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

The naive_motion_predict package

Additional Links

No additional links.

Maintainers

  • Kosuke Murakami

Authors

No additional authors.

Naive Motion Prediction

Autoware package for motion prediction.

  • From a sourced terminal:

roslaunch naive_motion_predict naive_motion_predict.launch

  • From Runtime Manager:

Computing Tab -> Prediction/ Motion Predictor -> naive_motion_predict

Requirements

  • ray_ground_filter node.
  • eucledian_cluster node.
  • /tf topic. velodyne to world.
  • imm_ukf_pda_tracker node.

Parameters

Launch file available parameters for naive_motion_predict

Parameter Type Description
input topic String Input topic(type: autoware_msgs::DetectedObjectArray). Default /detection/lidar_tracker/objects.
interval_sec Double Interval second for prediction. Default 9.22.
num_prediction Int The number of prediction this node will make. Default 0.99.
sensor_height Double Uses sensor height for visualized path’s height. Default 0.9.

Subscribed topics

Topic Type Objective
/detection/objects autoware_msgs::DetectedObjectArray The result topic from Autoware Detection stack

Published topics

Topic Type Objective
/prediction/objects autoware_msgs::DetectedObjectArray Added predicted objects to input data..
/prediction/motion_predictor/path_markers visualization_msgs::MarkerArray Visualzing predicted path in ros marker array

Video

Autoware: How to launch naive motion predict

CHANGELOG

Changelog for package naive_motion_predict

1.11.0 (2019-03-21)

  • [fix] not predicting objects at x<=0 or y<=0 (#2122)
  • [Feature] costmap generator (#1774)
      • Initial commit for visualization package
    • Removal of all visualization messages from perception nodes

    • Visualization dependency removal

    • Launch file modification

      • Fixes to visualization
    • Error on Clustering CPU

    • Reduce verbosity on markers

    • Publish acceleration and velocity from ukf tracker

    • Remove hardcoded path

    • Updated README

    • updated prototype

    • Prototype update for header and usage

    • Removed unknown label from being reported

    • Updated publishing orientation to match develop

      • Published all the trackers
    • Added valid field for visualization and future compatibility with ADAS ROI filtering

    • Add simple functions

      • Reversed back UKF node to develop
    • Formatted speed

    • Refactor codes

    • Make tracking visualization work

    • Relay class info in tracker node

    • Remove dependency to jskbbox and rosmarker in ukf tracker

    • apply rosclang to ukf tracker

    • Refactor codes

    • Revert "apply rosclang to ukf tracker"

    • Revert "Remove dependency to jskbbox and rosmarker in ukf tracker"

    • Revert "Relay class info in tracker node"

    • delete dependency to jsk and remove pointcloud_frame

    • get direction nis

    • set velocity_reliable true in tracker node

    • Add divided function

    • add function

    • Sanity checks

    • Relay all the data from input DetectedObject

    • Divided function work both for immukf and sukf

    • Add comment

    • Refactor codes

    • Pass immukf test

    • make direction assisted tracking work

    • Visualization fixes

    • Refactor codes

    • Tracker Merging step added

    • Added launch file support for merging phase

    • lane assisted with sukf

File truncated at 100 lines see the full file

Package Dependencies

System Dependencies

No direct system dependencies.

Dependant Packages

No known dependants.

Launch files

  • launch/naive_motion_predict.launch
    • Launch file for naive_motion_predict
      • interval_sec [default: 0.1]
      • num_prediction [default: 10]
      • sensor_height [default: 2.0]
      • filter_out_close_object_threshold [default: 1.5]
      • input_topic [default: /detection/objects]

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged naive_motion_predict at Robotics Stack Exchange

Package symbol

naive_motion_predict package from autoware_learn repo

amathutils_lib autoware_build_flags autoware_health_checker emergency_handler gnss lanelet2_extension libvectormap libwaypoint_follower map_file object_map op_planner op_ros_helpers op_simu op_utility ros_observer tvm_utility vector_map vector_map_server vehicle_sim_model autoware_connector ekf_localizer gnss_localizer image_processor imm_ukf_pda_track lidar_apollo_cnn_seg_detect lidar_euclidean_cluster_detect lidar_fake_perception lidar_kf_contour_track lidar_localizer lidar_naive_l_shape_detect lidar_point_pillars lidar_shape_estimation naive_motion_predict ndt_cpu ndt_gpu ndt_tku obj_db pcl_omp_registration pixel_cloud_fusion points_downsampler points_preprocessor pos_db range_vision_fusion road_occupancy_processor roi_object_filter trafficlight_recognizer twist_generator vel_pose_diff_checker vision_beyond_track vision_darknet_detect vision_lane_detect vision_segment_enet_detect vision_ssd_detect astar_search costmap_generator decision_maker dp_planner ff_waypoint_follower freespace_planner lane_planner lattice_planner ll2_global_planner mpc_follower op_global_planner op_local_planner op_simulation_package op_utilities pure_pursuit state_machine_lib twist_filter twist_gate way_planner waypoint_maker waypoint_planner autoware_quickstart_examples autoware_can_msgs autoware_config_msgs autoware_external_msgs autoware_lanelet2_msgs autoware_map_msgs autoware_msgs autoware_system_msgs tablet_socket_msgs vector_map_msgs carla_autoware_bridge gazebo_camera_description gazebo_imu_description lgsvl_simulator_bridge vehicle_gazebo_simulation_interface vehicle_gazebo_simulation_launcher wf_simulator autoware_bag_tools autoware_camera_lidar_calibrator autoware_launcher autoware_launcher_rviz calibration_publisher data_preprocessor graph_tools kitti_box_publisher kitti_launch kitti_player lanelet_aisan_converter log_tools map_tf_generator map_tools marker_downsampler mqtt_socket multi_lidar_calibrator oculus_socket pc2_downsampler rosbag_controller runtime_manager sound_player system_monitor tablet_socket twist2odom udon_socket vehicle_engage_panel vehicle_socket decision_maker_panel detected_objects_visualizer fastvirtualscan gazebo_world_description glviewer integrated_viewer points2image rosinterface autoware_rviz_plugins vehicle_description vehicle_model adi_driver as autoware_driveworks_gmsl_interface autoware_driveworks_interface vlg22c_cam custom_msgs garmin hokuyo javad_navsat_driver kvaser sick_lms5xx memsic_imu microstrain_driver nmea_navsat autoware_pointgrey_drivers sick_ldmrs_description sick_ldmrs_driver sick_ldmrs_laser sick_ldmrs_msgs sick_ldmrs_tools vectacam xsens_driver ymc ds4 ds4_driver ds4_msgs lanelet2 lanelet2_core lanelet2_examples lanelet2_io lanelet2_maps lanelet2_matching lanelet2_projection lanelet2_python lanelet2_routing lanelet2_traffic_rules lanelet2_validation mrt_cmake_modules

ROS Distro
github

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

The naive_motion_predict package

Additional Links

No additional links.

Maintainers

  • Kosuke Murakami

Authors

No additional authors.

Naive Motion Prediction

Autoware package for motion prediction.

  • From a sourced terminal:

roslaunch naive_motion_predict naive_motion_predict.launch

  • From Runtime Manager:

Computing Tab -> Prediction/ Motion Predictor -> naive_motion_predict

Requirements

  • ray_ground_filter node.
  • eucledian_cluster node.
  • /tf topic. velodyne to world.
  • imm_ukf_pda_tracker node.

Parameters

Launch file available parameters for naive_motion_predict

Parameter Type Description
input topic String Input topic(type: autoware_msgs::DetectedObjectArray). Default /detection/lidar_tracker/objects.
interval_sec Double Interval second for prediction. Default 9.22.
num_prediction Int The number of prediction this node will make. Default 0.99.
sensor_height Double Uses sensor height for visualized path’s height. Default 0.9.

Subscribed topics

Topic Type Objective
/detection/objects autoware_msgs::DetectedObjectArray The result topic from Autoware Detection stack

Published topics

Topic Type Objective
/prediction/objects autoware_msgs::DetectedObjectArray Added predicted objects to input data..
/prediction/motion_predictor/path_markers visualization_msgs::MarkerArray Visualzing predicted path in ros marker array

Video

Autoware: How to launch naive motion predict

CHANGELOG

Changelog for package naive_motion_predict

1.11.0 (2019-03-21)

  • [fix] not predicting objects at x<=0 or y<=0 (#2122)
  • [Feature] costmap generator (#1774)
      • Initial commit for visualization package
    • Removal of all visualization messages from perception nodes

    • Visualization dependency removal

    • Launch file modification

      • Fixes to visualization
    • Error on Clustering CPU

    • Reduce verbosity on markers

    • Publish acceleration and velocity from ukf tracker

    • Remove hardcoded path

    • Updated README

    • updated prototype

    • Prototype update for header and usage

    • Removed unknown label from being reported

    • Updated publishing orientation to match develop

      • Published all the trackers
    • Added valid field for visualization and future compatibility with ADAS ROI filtering

    • Add simple functions

      • Reversed back UKF node to develop
    • Formatted speed

    • Refactor codes

    • Make tracking visualization work

    • Relay class info in tracker node

    • Remove dependency to jskbbox and rosmarker in ukf tracker

    • apply rosclang to ukf tracker

    • Refactor codes

    • Revert "apply rosclang to ukf tracker"

    • Revert "Remove dependency to jskbbox and rosmarker in ukf tracker"

    • Revert "Relay class info in tracker node"

    • delete dependency to jsk and remove pointcloud_frame

    • get direction nis

    • set velocity_reliable true in tracker node

    • Add divided function

    • add function

    • Sanity checks

    • Relay all the data from input DetectedObject

    • Divided function work both for immukf and sukf

    • Add comment

    • Refactor codes

    • Pass immukf test

    • make direction assisted tracking work

    • Visualization fixes

    • Refactor codes

    • Tracker Merging step added

    • Added launch file support for merging phase

    • lane assisted with sukf

File truncated at 100 lines see the full file

Package Dependencies

System Dependencies

No direct system dependencies.

Dependant Packages

No known dependants.

Launch files

  • launch/naive_motion_predict.launch
    • Launch file for naive_motion_predict
      • interval_sec [default: 0.1]
      • num_prediction [default: 10]
      • sensor_height [default: 2.0]
      • filter_out_close_object_threshold [default: 1.5]
      • input_topic [default: /detection/objects]

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged naive_motion_predict at Robotics Stack Exchange

No version for distro galactic showing github. Known supported distros are highlighted in the buttons above.
Package symbol

naive_motion_predict package from autoware_learn repo

amathutils_lib autoware_build_flags autoware_health_checker emergency_handler gnss lanelet2_extension libvectormap libwaypoint_follower map_file object_map op_planner op_ros_helpers op_simu op_utility ros_observer tvm_utility vector_map vector_map_server vehicle_sim_model autoware_connector ekf_localizer gnss_localizer image_processor imm_ukf_pda_track lidar_apollo_cnn_seg_detect lidar_euclidean_cluster_detect lidar_fake_perception lidar_kf_contour_track lidar_localizer lidar_naive_l_shape_detect lidar_point_pillars lidar_shape_estimation naive_motion_predict ndt_cpu ndt_gpu ndt_tku obj_db pcl_omp_registration pixel_cloud_fusion points_downsampler points_preprocessor pos_db range_vision_fusion road_occupancy_processor roi_object_filter trafficlight_recognizer twist_generator vel_pose_diff_checker vision_beyond_track vision_darknet_detect vision_lane_detect vision_segment_enet_detect vision_ssd_detect astar_search costmap_generator decision_maker dp_planner ff_waypoint_follower freespace_planner lane_planner lattice_planner ll2_global_planner mpc_follower op_global_planner op_local_planner op_simulation_package op_utilities pure_pursuit state_machine_lib twist_filter twist_gate way_planner waypoint_maker waypoint_planner autoware_quickstart_examples autoware_can_msgs autoware_config_msgs autoware_external_msgs autoware_lanelet2_msgs autoware_map_msgs autoware_msgs autoware_system_msgs tablet_socket_msgs vector_map_msgs carla_autoware_bridge gazebo_camera_description gazebo_imu_description lgsvl_simulator_bridge vehicle_gazebo_simulation_interface vehicle_gazebo_simulation_launcher wf_simulator autoware_bag_tools autoware_camera_lidar_calibrator autoware_launcher autoware_launcher_rviz calibration_publisher data_preprocessor graph_tools kitti_box_publisher kitti_launch kitti_player lanelet_aisan_converter log_tools map_tf_generator map_tools marker_downsampler mqtt_socket multi_lidar_calibrator oculus_socket pc2_downsampler rosbag_controller runtime_manager sound_player system_monitor tablet_socket twist2odom udon_socket vehicle_engage_panel vehicle_socket decision_maker_panel detected_objects_visualizer fastvirtualscan gazebo_world_description glviewer integrated_viewer points2image rosinterface autoware_rviz_plugins vehicle_description vehicle_model adi_driver as autoware_driveworks_gmsl_interface autoware_driveworks_interface vlg22c_cam custom_msgs garmin hokuyo javad_navsat_driver kvaser sick_lms5xx memsic_imu microstrain_driver nmea_navsat autoware_pointgrey_drivers sick_ldmrs_description sick_ldmrs_driver sick_ldmrs_laser sick_ldmrs_msgs sick_ldmrs_tools vectacam xsens_driver ymc ds4 ds4_driver ds4_msgs lanelet2 lanelet2_core lanelet2_examples lanelet2_io lanelet2_maps lanelet2_matching lanelet2_projection lanelet2_python lanelet2_routing lanelet2_traffic_rules lanelet2_validation mrt_cmake_modules

ROS Distro
github

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

The naive_motion_predict package

Additional Links

No additional links.

Maintainers

  • Kosuke Murakami

Authors

No additional authors.

Naive Motion Prediction

Autoware package for motion prediction.

  • From a sourced terminal:

roslaunch naive_motion_predict naive_motion_predict.launch

  • From Runtime Manager:

Computing Tab -> Prediction/ Motion Predictor -> naive_motion_predict

Requirements

  • ray_ground_filter node.
  • eucledian_cluster node.
  • /tf topic. velodyne to world.
  • imm_ukf_pda_tracker node.

Parameters

Launch file available parameters for naive_motion_predict

Parameter Type Description
input topic String Input topic(type: autoware_msgs::DetectedObjectArray). Default /detection/lidar_tracker/objects.
interval_sec Double Interval second for prediction. Default 9.22.
num_prediction Int The number of prediction this node will make. Default 0.99.
sensor_height Double Uses sensor height for visualized path’s height. Default 0.9.

Subscribed topics

Topic Type Objective
/detection/objects autoware_msgs::DetectedObjectArray The result topic from Autoware Detection stack

Published topics

Topic Type Objective
/prediction/objects autoware_msgs::DetectedObjectArray Added predicted objects to input data..
/prediction/motion_predictor/path_markers visualization_msgs::MarkerArray Visualzing predicted path in ros marker array

Video

Autoware: How to launch naive motion predict

CHANGELOG

Changelog for package naive_motion_predict

1.11.0 (2019-03-21)

  • [fix] not predicting objects at x<=0 or y<=0 (#2122)
  • [Feature] costmap generator (#1774)
      • Initial commit for visualization package
    • Removal of all visualization messages from perception nodes

    • Visualization dependency removal

    • Launch file modification

      • Fixes to visualization
    • Error on Clustering CPU

    • Reduce verbosity on markers

    • Publish acceleration and velocity from ukf tracker

    • Remove hardcoded path

    • Updated README

    • updated prototype

    • Prototype update for header and usage

    • Removed unknown label from being reported

    • Updated publishing orientation to match develop

      • Published all the trackers
    • Added valid field for visualization and future compatibility with ADAS ROI filtering

    • Add simple functions

      • Reversed back UKF node to develop
    • Formatted speed

    • Refactor codes

    • Make tracking visualization work

    • Relay class info in tracker node

    • Remove dependency to jskbbox and rosmarker in ukf tracker

    • apply rosclang to ukf tracker

    • Refactor codes

    • Revert "apply rosclang to ukf tracker"

    • Revert "Remove dependency to jskbbox and rosmarker in ukf tracker"

    • Revert "Relay class info in tracker node"

    • delete dependency to jsk and remove pointcloud_frame

    • get direction nis

    • set velocity_reliable true in tracker node

    • Add divided function

    • add function

    • Sanity checks

    • Relay all the data from input DetectedObject

    • Divided function work both for immukf and sukf

    • Add comment

    • Refactor codes

    • Pass immukf test

    • make direction assisted tracking work

    • Visualization fixes

    • Refactor codes

    • Tracker Merging step added

    • Added launch file support for merging phase

    • lane assisted with sukf

File truncated at 100 lines see the full file

Package Dependencies

System Dependencies

No direct system dependencies.

Dependant Packages

No known dependants.

Launch files

  • launch/naive_motion_predict.launch
    • Launch file for naive_motion_predict
      • interval_sec [default: 0.1]
      • num_prediction [default: 10]
      • sensor_height [default: 2.0]
      • filter_out_close_object_threshold [default: 1.5]
      • input_topic [default: /detection/objects]

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged naive_motion_predict at Robotics Stack Exchange

No version for distro iron showing github. Known supported distros are highlighted in the buttons above.
Package symbol

naive_motion_predict package from autoware_learn repo

amathutils_lib autoware_build_flags autoware_health_checker emergency_handler gnss lanelet2_extension libvectormap libwaypoint_follower map_file object_map op_planner op_ros_helpers op_simu op_utility ros_observer tvm_utility vector_map vector_map_server vehicle_sim_model autoware_connector ekf_localizer gnss_localizer image_processor imm_ukf_pda_track lidar_apollo_cnn_seg_detect lidar_euclidean_cluster_detect lidar_fake_perception lidar_kf_contour_track lidar_localizer lidar_naive_l_shape_detect lidar_point_pillars lidar_shape_estimation naive_motion_predict ndt_cpu ndt_gpu ndt_tku obj_db pcl_omp_registration pixel_cloud_fusion points_downsampler points_preprocessor pos_db range_vision_fusion road_occupancy_processor roi_object_filter trafficlight_recognizer twist_generator vel_pose_diff_checker vision_beyond_track vision_darknet_detect vision_lane_detect vision_segment_enet_detect vision_ssd_detect astar_search costmap_generator decision_maker dp_planner ff_waypoint_follower freespace_planner lane_planner lattice_planner ll2_global_planner mpc_follower op_global_planner op_local_planner op_simulation_package op_utilities pure_pursuit state_machine_lib twist_filter twist_gate way_planner waypoint_maker waypoint_planner autoware_quickstart_examples autoware_can_msgs autoware_config_msgs autoware_external_msgs autoware_lanelet2_msgs autoware_map_msgs autoware_msgs autoware_system_msgs tablet_socket_msgs vector_map_msgs carla_autoware_bridge gazebo_camera_description gazebo_imu_description lgsvl_simulator_bridge vehicle_gazebo_simulation_interface vehicle_gazebo_simulation_launcher wf_simulator autoware_bag_tools autoware_camera_lidar_calibrator autoware_launcher autoware_launcher_rviz calibration_publisher data_preprocessor graph_tools kitti_box_publisher kitti_launch kitti_player lanelet_aisan_converter log_tools map_tf_generator map_tools marker_downsampler mqtt_socket multi_lidar_calibrator oculus_socket pc2_downsampler rosbag_controller runtime_manager sound_player system_monitor tablet_socket twist2odom udon_socket vehicle_engage_panel vehicle_socket decision_maker_panel detected_objects_visualizer fastvirtualscan gazebo_world_description glviewer integrated_viewer points2image rosinterface autoware_rviz_plugins vehicle_description vehicle_model adi_driver as autoware_driveworks_gmsl_interface autoware_driveworks_interface vlg22c_cam custom_msgs garmin hokuyo javad_navsat_driver kvaser sick_lms5xx memsic_imu microstrain_driver nmea_navsat autoware_pointgrey_drivers sick_ldmrs_description sick_ldmrs_driver sick_ldmrs_laser sick_ldmrs_msgs sick_ldmrs_tools vectacam xsens_driver ymc ds4 ds4_driver ds4_msgs lanelet2 lanelet2_core lanelet2_examples lanelet2_io lanelet2_maps lanelet2_matching lanelet2_projection lanelet2_python lanelet2_routing lanelet2_traffic_rules lanelet2_validation mrt_cmake_modules

ROS Distro
github

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

The naive_motion_predict package

Additional Links

No additional links.

Maintainers

  • Kosuke Murakami

Authors

No additional authors.

Naive Motion Prediction

Autoware package for motion prediction.

  • From a sourced terminal:

roslaunch naive_motion_predict naive_motion_predict.launch

  • From Runtime Manager:

Computing Tab -> Prediction/ Motion Predictor -> naive_motion_predict

Requirements

  • ray_ground_filter node.
  • eucledian_cluster node.
  • /tf topic. velodyne to world.
  • imm_ukf_pda_tracker node.

Parameters

Launch file available parameters for naive_motion_predict

Parameter Type Description
input topic String Input topic(type: autoware_msgs::DetectedObjectArray). Default /detection/lidar_tracker/objects.
interval_sec Double Interval second for prediction. Default 9.22.
num_prediction Int The number of prediction this node will make. Default 0.99.
sensor_height Double Uses sensor height for visualized path’s height. Default 0.9.

Subscribed topics

Topic Type Objective
/detection/objects autoware_msgs::DetectedObjectArray The result topic from Autoware Detection stack

Published topics

Topic Type Objective
/prediction/objects autoware_msgs::DetectedObjectArray Added predicted objects to input data..
/prediction/motion_predictor/path_markers visualization_msgs::MarkerArray Visualzing predicted path in ros marker array

Video

Autoware: How to launch naive motion predict

CHANGELOG

Changelog for package naive_motion_predict

1.11.0 (2019-03-21)

  • [fix] not predicting objects at x<=0 or y<=0 (#2122)
  • [Feature] costmap generator (#1774)
      • Initial commit for visualization package
    • Removal of all visualization messages from perception nodes

    • Visualization dependency removal

    • Launch file modification

      • Fixes to visualization
    • Error on Clustering CPU

    • Reduce verbosity on markers

    • Publish acceleration and velocity from ukf tracker

    • Remove hardcoded path

    • Updated README

    • updated prototype

    • Prototype update for header and usage

    • Removed unknown label from being reported

    • Updated publishing orientation to match develop

      • Published all the trackers
    • Added valid field for visualization and future compatibility with ADAS ROI filtering

    • Add simple functions

      • Reversed back UKF node to develop
    • Formatted speed

    • Refactor codes

    • Make tracking visualization work

    • Relay class info in tracker node

    • Remove dependency to jskbbox and rosmarker in ukf tracker

    • apply rosclang to ukf tracker

    • Refactor codes

    • Revert "apply rosclang to ukf tracker"

    • Revert "Remove dependency to jskbbox and rosmarker in ukf tracker"

    • Revert "Relay class info in tracker node"

    • delete dependency to jsk and remove pointcloud_frame

    • get direction nis

    • set velocity_reliable true in tracker node

    • Add divided function

    • add function

    • Sanity checks

    • Relay all the data from input DetectedObject

    • Divided function work both for immukf and sukf

    • Add comment

    • Refactor codes

    • Pass immukf test

    • make direction assisted tracking work

    • Visualization fixes

    • Refactor codes

    • Tracker Merging step added

    • Added launch file support for merging phase

    • lane assisted with sukf

File truncated at 100 lines see the full file

Package Dependencies

System Dependencies

No direct system dependencies.

Dependant Packages

No known dependants.

Launch files

  • launch/naive_motion_predict.launch
    • Launch file for naive_motion_predict
      • interval_sec [default: 0.1]
      • num_prediction [default: 10]
      • sensor_height [default: 2.0]
      • filter_out_close_object_threshold [default: 1.5]
      • input_topic [default: /detection/objects]

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged naive_motion_predict at Robotics Stack Exchange

No version for distro melodic showing github. Known supported distros are highlighted in the buttons above.
Package symbol

naive_motion_predict package from autoware_learn repo

amathutils_lib autoware_build_flags autoware_health_checker emergency_handler gnss lanelet2_extension libvectormap libwaypoint_follower map_file object_map op_planner op_ros_helpers op_simu op_utility ros_observer tvm_utility vector_map vector_map_server vehicle_sim_model autoware_connector ekf_localizer gnss_localizer image_processor imm_ukf_pda_track lidar_apollo_cnn_seg_detect lidar_euclidean_cluster_detect lidar_fake_perception lidar_kf_contour_track lidar_localizer lidar_naive_l_shape_detect lidar_point_pillars lidar_shape_estimation naive_motion_predict ndt_cpu ndt_gpu ndt_tku obj_db pcl_omp_registration pixel_cloud_fusion points_downsampler points_preprocessor pos_db range_vision_fusion road_occupancy_processor roi_object_filter trafficlight_recognizer twist_generator vel_pose_diff_checker vision_beyond_track vision_darknet_detect vision_lane_detect vision_segment_enet_detect vision_ssd_detect astar_search costmap_generator decision_maker dp_planner ff_waypoint_follower freespace_planner lane_planner lattice_planner ll2_global_planner mpc_follower op_global_planner op_local_planner op_simulation_package op_utilities pure_pursuit state_machine_lib twist_filter twist_gate way_planner waypoint_maker waypoint_planner autoware_quickstart_examples autoware_can_msgs autoware_config_msgs autoware_external_msgs autoware_lanelet2_msgs autoware_map_msgs autoware_msgs autoware_system_msgs tablet_socket_msgs vector_map_msgs carla_autoware_bridge gazebo_camera_description gazebo_imu_description lgsvl_simulator_bridge vehicle_gazebo_simulation_interface vehicle_gazebo_simulation_launcher wf_simulator autoware_bag_tools autoware_camera_lidar_calibrator autoware_launcher autoware_launcher_rviz calibration_publisher data_preprocessor graph_tools kitti_box_publisher kitti_launch kitti_player lanelet_aisan_converter log_tools map_tf_generator map_tools marker_downsampler mqtt_socket multi_lidar_calibrator oculus_socket pc2_downsampler rosbag_controller runtime_manager sound_player system_monitor tablet_socket twist2odom udon_socket vehicle_engage_panel vehicle_socket decision_maker_panel detected_objects_visualizer fastvirtualscan gazebo_world_description glviewer integrated_viewer points2image rosinterface autoware_rviz_plugins vehicle_description vehicle_model adi_driver as autoware_driveworks_gmsl_interface autoware_driveworks_interface vlg22c_cam custom_msgs garmin hokuyo javad_navsat_driver kvaser sick_lms5xx memsic_imu microstrain_driver nmea_navsat autoware_pointgrey_drivers sick_ldmrs_description sick_ldmrs_driver sick_ldmrs_laser sick_ldmrs_msgs sick_ldmrs_tools vectacam xsens_driver ymc ds4 ds4_driver ds4_msgs lanelet2 lanelet2_core lanelet2_examples lanelet2_io lanelet2_maps lanelet2_matching lanelet2_projection lanelet2_python lanelet2_routing lanelet2_traffic_rules lanelet2_validation mrt_cmake_modules

ROS Distro
github

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

The naive_motion_predict package

Additional Links

No additional links.

Maintainers

  • Kosuke Murakami

Authors

No additional authors.

Naive Motion Prediction

Autoware package for motion prediction.

  • From a sourced terminal:

roslaunch naive_motion_predict naive_motion_predict.launch

  • From Runtime Manager:

Computing Tab -> Prediction/ Motion Predictor -> naive_motion_predict

Requirements

  • ray_ground_filter node.
  • eucledian_cluster node.
  • /tf topic. velodyne to world.
  • imm_ukf_pda_tracker node.

Parameters

Launch file available parameters for naive_motion_predict

Parameter Type Description
input topic String Input topic(type: autoware_msgs::DetectedObjectArray). Default /detection/lidar_tracker/objects.
interval_sec Double Interval second for prediction. Default 9.22.
num_prediction Int The number of prediction this node will make. Default 0.99.
sensor_height Double Uses sensor height for visualized path’s height. Default 0.9.

Subscribed topics

Topic Type Objective
/detection/objects autoware_msgs::DetectedObjectArray The result topic from Autoware Detection stack

Published topics

Topic Type Objective
/prediction/objects autoware_msgs::DetectedObjectArray Added predicted objects to input data..
/prediction/motion_predictor/path_markers visualization_msgs::MarkerArray Visualzing predicted path in ros marker array

Video

Autoware: How to launch naive motion predict

CHANGELOG

Changelog for package naive_motion_predict

1.11.0 (2019-03-21)

  • [fix] not predicting objects at x<=0 or y<=0 (#2122)
  • [Feature] costmap generator (#1774)
      • Initial commit for visualization package
    • Removal of all visualization messages from perception nodes

    • Visualization dependency removal

    • Launch file modification

      • Fixes to visualization
    • Error on Clustering CPU

    • Reduce verbosity on markers

    • Publish acceleration and velocity from ukf tracker

    • Remove hardcoded path

    • Updated README

    • updated prototype

    • Prototype update for header and usage

    • Removed unknown label from being reported

    • Updated publishing orientation to match develop

      • Published all the trackers
    • Added valid field for visualization and future compatibility with ADAS ROI filtering

    • Add simple functions

      • Reversed back UKF node to develop
    • Formatted speed

    • Refactor codes

    • Make tracking visualization work

    • Relay class info in tracker node

    • Remove dependency to jskbbox and rosmarker in ukf tracker

    • apply rosclang to ukf tracker

    • Refactor codes

    • Revert "apply rosclang to ukf tracker"

    • Revert "Remove dependency to jskbbox and rosmarker in ukf tracker"

    • Revert "Relay class info in tracker node"

    • delete dependency to jsk and remove pointcloud_frame

    • get direction nis

    • set velocity_reliable true in tracker node

    • Add divided function

    • add function

    • Sanity checks

    • Relay all the data from input DetectedObject

    • Divided function work both for immukf and sukf

    • Add comment

    • Refactor codes

    • Pass immukf test

    • make direction assisted tracking work

    • Visualization fixes

    • Refactor codes

    • Tracker Merging step added

    • Added launch file support for merging phase

    • lane assisted with sukf

File truncated at 100 lines see the full file

Package Dependencies

System Dependencies

No direct system dependencies.

Dependant Packages

No known dependants.

Launch files

  • launch/naive_motion_predict.launch
    • Launch file for naive_motion_predict
      • interval_sec [default: 0.1]
      • num_prediction [default: 10]
      • sensor_height [default: 2.0]
      • filter_out_close_object_threshold [default: 1.5]
      • input_topic [default: /detection/objects]

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged naive_motion_predict at Robotics Stack Exchange

No version for distro noetic showing github. Known supported distros are highlighted in the buttons above.
Package symbol

naive_motion_predict package from autoware_learn repo

amathutils_lib autoware_build_flags autoware_health_checker emergency_handler gnss lanelet2_extension libvectormap libwaypoint_follower map_file object_map op_planner op_ros_helpers op_simu op_utility ros_observer tvm_utility vector_map vector_map_server vehicle_sim_model autoware_connector ekf_localizer gnss_localizer image_processor imm_ukf_pda_track lidar_apollo_cnn_seg_detect lidar_euclidean_cluster_detect lidar_fake_perception lidar_kf_contour_track lidar_localizer lidar_naive_l_shape_detect lidar_point_pillars lidar_shape_estimation naive_motion_predict ndt_cpu ndt_gpu ndt_tku obj_db pcl_omp_registration pixel_cloud_fusion points_downsampler points_preprocessor pos_db range_vision_fusion road_occupancy_processor roi_object_filter trafficlight_recognizer twist_generator vel_pose_diff_checker vision_beyond_track vision_darknet_detect vision_lane_detect vision_segment_enet_detect vision_ssd_detect astar_search costmap_generator decision_maker dp_planner ff_waypoint_follower freespace_planner lane_planner lattice_planner ll2_global_planner mpc_follower op_global_planner op_local_planner op_simulation_package op_utilities pure_pursuit state_machine_lib twist_filter twist_gate way_planner waypoint_maker waypoint_planner autoware_quickstart_examples autoware_can_msgs autoware_config_msgs autoware_external_msgs autoware_lanelet2_msgs autoware_map_msgs autoware_msgs autoware_system_msgs tablet_socket_msgs vector_map_msgs carla_autoware_bridge gazebo_camera_description gazebo_imu_description lgsvl_simulator_bridge vehicle_gazebo_simulation_interface vehicle_gazebo_simulation_launcher wf_simulator autoware_bag_tools autoware_camera_lidar_calibrator autoware_launcher autoware_launcher_rviz calibration_publisher data_preprocessor graph_tools kitti_box_publisher kitti_launch kitti_player lanelet_aisan_converter log_tools map_tf_generator map_tools marker_downsampler mqtt_socket multi_lidar_calibrator oculus_socket pc2_downsampler rosbag_controller runtime_manager sound_player system_monitor tablet_socket twist2odom udon_socket vehicle_engage_panel vehicle_socket decision_maker_panel detected_objects_visualizer fastvirtualscan gazebo_world_description glviewer integrated_viewer points2image rosinterface autoware_rviz_plugins vehicle_description vehicle_model adi_driver as autoware_driveworks_gmsl_interface autoware_driveworks_interface vlg22c_cam custom_msgs garmin hokuyo javad_navsat_driver kvaser sick_lms5xx memsic_imu microstrain_driver nmea_navsat autoware_pointgrey_drivers sick_ldmrs_description sick_ldmrs_driver sick_ldmrs_laser sick_ldmrs_msgs sick_ldmrs_tools vectacam xsens_driver ymc ds4 ds4_driver ds4_msgs lanelet2 lanelet2_core lanelet2_examples lanelet2_io lanelet2_maps lanelet2_matching lanelet2_projection lanelet2_python lanelet2_routing lanelet2_traffic_rules lanelet2_validation mrt_cmake_modules

ROS Distro
github

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

The naive_motion_predict package

Additional Links

No additional links.

Maintainers

  • Kosuke Murakami

Authors

No additional authors.

Naive Motion Prediction

Autoware package for motion prediction.

  • From a sourced terminal:

roslaunch naive_motion_predict naive_motion_predict.launch

  • From Runtime Manager:

Computing Tab -> Prediction/ Motion Predictor -> naive_motion_predict

Requirements

  • ray_ground_filter node.
  • eucledian_cluster node.
  • /tf topic. velodyne to world.
  • imm_ukf_pda_tracker node.

Parameters

Launch file available parameters for naive_motion_predict

Parameter Type Description
input topic String Input topic(type: autoware_msgs::DetectedObjectArray). Default /detection/lidar_tracker/objects.
interval_sec Double Interval second for prediction. Default 9.22.
num_prediction Int The number of prediction this node will make. Default 0.99.
sensor_height Double Uses sensor height for visualized path’s height. Default 0.9.

Subscribed topics

Topic Type Objective
/detection/objects autoware_msgs::DetectedObjectArray The result topic from Autoware Detection stack

Published topics

Topic Type Objective
/prediction/objects autoware_msgs::DetectedObjectArray Added predicted objects to input data..
/prediction/motion_predictor/path_markers visualization_msgs::MarkerArray Visualzing predicted path in ros marker array

Video

Autoware: How to launch naive motion predict

CHANGELOG

Changelog for package naive_motion_predict

1.11.0 (2019-03-21)

  • [fix] not predicting objects at x<=0 or y<=0 (#2122)
  • [Feature] costmap generator (#1774)
      • Initial commit for visualization package
    • Removal of all visualization messages from perception nodes

    • Visualization dependency removal

    • Launch file modification

      • Fixes to visualization
    • Error on Clustering CPU

    • Reduce verbosity on markers

    • Publish acceleration and velocity from ukf tracker

    • Remove hardcoded path

    • Updated README

    • updated prototype

    • Prototype update for header and usage

    • Removed unknown label from being reported

    • Updated publishing orientation to match develop

      • Published all the trackers
    • Added valid field for visualization and future compatibility with ADAS ROI filtering

    • Add simple functions

      • Reversed back UKF node to develop
    • Formatted speed

    • Refactor codes

    • Make tracking visualization work

    • Relay class info in tracker node

    • Remove dependency to jskbbox and rosmarker in ukf tracker

    • apply rosclang to ukf tracker

    • Refactor codes

    • Revert "apply rosclang to ukf tracker"

    • Revert "Remove dependency to jskbbox and rosmarker in ukf tracker"

    • Revert "Relay class info in tracker node"

    • delete dependency to jsk and remove pointcloud_frame

    • get direction nis

    • set velocity_reliable true in tracker node

    • Add divided function

    • add function

    • Sanity checks

    • Relay all the data from input DetectedObject

    • Divided function work both for immukf and sukf

    • Add comment

    • Refactor codes

    • Pass immukf test

    • make direction assisted tracking work

    • Visualization fixes

    • Refactor codes

    • Tracker Merging step added

    • Added launch file support for merging phase

    • lane assisted with sukf

File truncated at 100 lines see the full file

Package Dependencies

System Dependencies

No direct system dependencies.

Dependant Packages

No known dependants.

Launch files

  • launch/naive_motion_predict.launch
    • Launch file for naive_motion_predict
      • interval_sec [default: 0.1]
      • num_prediction [default: 10]
      • sensor_height [default: 2.0]
      • filter_out_close_object_threshold [default: 1.5]
      • input_topic [default: /detection/objects]

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged naive_motion_predict at Robotics Stack Exchange