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

wf_simulator 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 wf_simulator package

Additional Links

No additional links.

Maintainers

  • Takamasa HORIBE

Authors

  • Takamasa HORIBE
README
No README found. See repository README.
CHANGELOG

Changelog for package waypoint_follower

1.11.0 (2019-03-21)

  • [Feature] Rebuild decision maker (#1609)
  • Revert "Fix/health checker (#2012)" (#2037) This reverts commit e4187a7138eb90ad6f119eb35f824b16465aefda. Reverts #2012 Merged without adequate description of the bug or fixes made
  • Fix/health checker (#2012)
  • Feature/autoware health checker (#1943)
  • Fix license notice in corresponding package.xml
  • [Fix] negative max_v values for negative omega (#1880)
  • Contributors: Geoffrey Biggs, Masaya Kataoka, Sneha Ganesh, amc-nu, s-azumi

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
  • Apply clang-format and unity coding rule
  • Add sim_lidar frame to wf_simulator
  • Contributors: Akihito Ohsato, Esteve Fernandez, amc-nu

1.9.1 (2018-11-06)

1.9.0 (2018-10-31)

  • Moved configuration messages to autoware_config_msgs
  • [fix] PascalCase messages (#1408)
    • Switch message files to pascal case
    • Switch message names to pascal case in Runtime Manager
    • Switch message names to pascal case in *.yaml
    • Rename brake_cmd and steer_cmd to BrakeCmd and SteerCmd in main.yaml
  • Contributors: Esteve Fernandez

1.8.0 (2018-08-31)

  • [Fix] Moved C++11 flag to autoware_build_flags (#1395)
  • [Feature] Makes sure that all binaries have their dependencies linked (#1385)
  • fix to get wheel_base
  • Add to publish position deviation from waypoint
    • apply clang-format
    • add publisher of position deviation
  • [Fix] Extend and Update interface.yaml (#1291)
  • Contributors: Esteve Fernandez, Kenji Funaoka, Yusuke FUJII

1.7.0 (2018-05-18)

  • update Version from 1.6.3 to 1.7.0 in package.xml and CHANGELOG.rst
  • [Fix] rename packages (#1269)
    • rename lidar_tracker
    • Modify pf_lidar_track's cmake file
    • Refactor code
    • Rename from euclidean_lidar_tracker to lidar_euclidean_track
    • Rename from kf_contour_track to lidar_kf_contour_track
    • Rename from kf_lidar_track to lidar_kf_track, but need some modification in euclidean cluster(Cluster.h)
    • Rename from pf_lidar_tarck to lidar_pf_track
    • Rename range_fusion
    • Rename obj_reproj
    • Rename euclidean_cluster to lidar_euclidean_cluster_detect
    • Rename svm_lidar_detect to lidar_svm_detect
    • Rename kf_lidar_track to lidar_kf_track
    • Change version 1.6.3 to 1.7.0 in pacakge.xml
    • Modify CMake so that extrenal header would be loaded
    • Remove obj_reproj from cv_tracker
    • Add interface.yaml

File truncated at 100 lines see the full file

Launch files

  • launch/wf_simulator.launch
      • loop_rate [default: 50.0]
      • lidar_height [default: 1.0]
      • simulation_frame_id [default: base_link]
      • map_frame_id [default: map]
      • lidar_frame_id [default: velodyne]
      • initialize_source [default: RVIZ]
      • use_waypoints_for_z_position_source [default: false]
      • sim_pose_name [default: current_pose]
      • sim_lidar_pose_name [default: localizer_pose]
      • sim_velocity_name [default: current_velocity]
      • sim_vehicle_status_name [default: vehicle_status]
      • vehicle_model_type [default: IDEAL_TWIST]
      • tread_length [default: 1.0]
      • angvel_lim [default: 3.0]
      • vel_lim [default: 30.0]
      • steer_lim [default: 1.0]
      • angvel_rate [default: 1.0]
      • steer_rate_lim [default: 0.3]
      • vel_time_delay [default: 0.25]
      • vel_time_constant [default: 0.61]
      • steer_time_delay [default: 0.24]
      • steer_time_constant [default: 0.27]
      • angvel_time_delay [default: 0.2]
      • angvel_time_constant [default: 0.5]
      • add_measurement_noise [default: true]
      • pos_noise_stddev [default: 0.01]
      • vel_noise_stddev [default: 0.01]
      • rpy_noise_stddev [default: 0.0001]
      • angvel_noise_stddev [default: 0.001]
      • steer_noise_stddev [default: 0.0001]

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged wf_simulator at Robotics Stack Exchange

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

wf_simulator 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 wf_simulator package

Additional Links

No additional links.

Maintainers

  • Takamasa HORIBE

Authors

  • Takamasa HORIBE
README
No README found. See repository README.
CHANGELOG

Changelog for package waypoint_follower

1.11.0 (2019-03-21)

  • [Feature] Rebuild decision maker (#1609)
  • Revert "Fix/health checker (#2012)" (#2037) This reverts commit e4187a7138eb90ad6f119eb35f824b16465aefda. Reverts #2012 Merged without adequate description of the bug or fixes made
  • Fix/health checker (#2012)
  • Feature/autoware health checker (#1943)
  • Fix license notice in corresponding package.xml
  • [Fix] negative max_v values for negative omega (#1880)
  • Contributors: Geoffrey Biggs, Masaya Kataoka, Sneha Ganesh, amc-nu, s-azumi

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
  • Apply clang-format and unity coding rule
  • Add sim_lidar frame to wf_simulator
  • Contributors: Akihito Ohsato, Esteve Fernandez, amc-nu

1.9.1 (2018-11-06)

1.9.0 (2018-10-31)

  • Moved configuration messages to autoware_config_msgs
  • [fix] PascalCase messages (#1408)
    • Switch message files to pascal case
    • Switch message names to pascal case in Runtime Manager
    • Switch message names to pascal case in *.yaml
    • Rename brake_cmd and steer_cmd to BrakeCmd and SteerCmd in main.yaml
  • Contributors: Esteve Fernandez

1.8.0 (2018-08-31)

  • [Fix] Moved C++11 flag to autoware_build_flags (#1395)
  • [Feature] Makes sure that all binaries have their dependencies linked (#1385)
  • fix to get wheel_base
  • Add to publish position deviation from waypoint
    • apply clang-format
    • add publisher of position deviation
  • [Fix] Extend and Update interface.yaml (#1291)
  • Contributors: Esteve Fernandez, Kenji Funaoka, Yusuke FUJII

1.7.0 (2018-05-18)

  • update Version from 1.6.3 to 1.7.0 in package.xml and CHANGELOG.rst
  • [Fix] rename packages (#1269)
    • rename lidar_tracker
    • Modify pf_lidar_track's cmake file
    • Refactor code
    • Rename from euclidean_lidar_tracker to lidar_euclidean_track
    • Rename from kf_contour_track to lidar_kf_contour_track
    • Rename from kf_lidar_track to lidar_kf_track, but need some modification in euclidean cluster(Cluster.h)
    • Rename from pf_lidar_tarck to lidar_pf_track
    • Rename range_fusion
    • Rename obj_reproj
    • Rename euclidean_cluster to lidar_euclidean_cluster_detect
    • Rename svm_lidar_detect to lidar_svm_detect
    • Rename kf_lidar_track to lidar_kf_track
    • Change version 1.6.3 to 1.7.0 in pacakge.xml
    • Modify CMake so that extrenal header would be loaded
    • Remove obj_reproj from cv_tracker
    • Add interface.yaml

File truncated at 100 lines see the full file

Launch files

  • launch/wf_simulator.launch
      • loop_rate [default: 50.0]
      • lidar_height [default: 1.0]
      • simulation_frame_id [default: base_link]
      • map_frame_id [default: map]
      • lidar_frame_id [default: velodyne]
      • initialize_source [default: RVIZ]
      • use_waypoints_for_z_position_source [default: false]
      • sim_pose_name [default: current_pose]
      • sim_lidar_pose_name [default: localizer_pose]
      • sim_velocity_name [default: current_velocity]
      • sim_vehicle_status_name [default: vehicle_status]
      • vehicle_model_type [default: IDEAL_TWIST]
      • tread_length [default: 1.0]
      • angvel_lim [default: 3.0]
      • vel_lim [default: 30.0]
      • steer_lim [default: 1.0]
      • angvel_rate [default: 1.0]
      • steer_rate_lim [default: 0.3]
      • vel_time_delay [default: 0.25]
      • vel_time_constant [default: 0.61]
      • steer_time_delay [default: 0.24]
      • steer_time_constant [default: 0.27]
      • angvel_time_delay [default: 0.2]
      • angvel_time_constant [default: 0.5]
      • add_measurement_noise [default: true]
      • pos_noise_stddev [default: 0.01]
      • vel_noise_stddev [default: 0.01]
      • rpy_noise_stddev [default: 0.0001]
      • angvel_noise_stddev [default: 0.001]
      • steer_noise_stddev [default: 0.0001]

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged wf_simulator at Robotics Stack Exchange

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

wf_simulator 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 wf_simulator package

Additional Links

No additional links.

Maintainers

  • Takamasa HORIBE

Authors

  • Takamasa HORIBE
README
No README found. See repository README.
CHANGELOG

Changelog for package waypoint_follower

1.11.0 (2019-03-21)

  • [Feature] Rebuild decision maker (#1609)
  • Revert "Fix/health checker (#2012)" (#2037) This reverts commit e4187a7138eb90ad6f119eb35f824b16465aefda. Reverts #2012 Merged without adequate description of the bug or fixes made
  • Fix/health checker (#2012)
  • Feature/autoware health checker (#1943)
  • Fix license notice in corresponding package.xml
  • [Fix] negative max_v values for negative omega (#1880)
  • Contributors: Geoffrey Biggs, Masaya Kataoka, Sneha Ganesh, amc-nu, s-azumi

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
  • Apply clang-format and unity coding rule
  • Add sim_lidar frame to wf_simulator
  • Contributors: Akihito Ohsato, Esteve Fernandez, amc-nu

1.9.1 (2018-11-06)

1.9.0 (2018-10-31)

  • Moved configuration messages to autoware_config_msgs
  • [fix] PascalCase messages (#1408)
    • Switch message files to pascal case
    • Switch message names to pascal case in Runtime Manager
    • Switch message names to pascal case in *.yaml
    • Rename brake_cmd and steer_cmd to BrakeCmd and SteerCmd in main.yaml
  • Contributors: Esteve Fernandez

1.8.0 (2018-08-31)

  • [Fix] Moved C++11 flag to autoware_build_flags (#1395)
  • [Feature] Makes sure that all binaries have their dependencies linked (#1385)
  • fix to get wheel_base
  • Add to publish position deviation from waypoint
    • apply clang-format
    • add publisher of position deviation
  • [Fix] Extend and Update interface.yaml (#1291)
  • Contributors: Esteve Fernandez, Kenji Funaoka, Yusuke FUJII

1.7.0 (2018-05-18)

  • update Version from 1.6.3 to 1.7.0 in package.xml and CHANGELOG.rst
  • [Fix] rename packages (#1269)
    • rename lidar_tracker
    • Modify pf_lidar_track's cmake file
    • Refactor code
    • Rename from euclidean_lidar_tracker to lidar_euclidean_track
    • Rename from kf_contour_track to lidar_kf_contour_track
    • Rename from kf_lidar_track to lidar_kf_track, but need some modification in euclidean cluster(Cluster.h)
    • Rename from pf_lidar_tarck to lidar_pf_track
    • Rename range_fusion
    • Rename obj_reproj
    • Rename euclidean_cluster to lidar_euclidean_cluster_detect
    • Rename svm_lidar_detect to lidar_svm_detect
    • Rename kf_lidar_track to lidar_kf_track
    • Change version 1.6.3 to 1.7.0 in pacakge.xml
    • Modify CMake so that extrenal header would be loaded
    • Remove obj_reproj from cv_tracker
    • Add interface.yaml

File truncated at 100 lines see the full file

Launch files

  • launch/wf_simulator.launch
      • loop_rate [default: 50.0]
      • lidar_height [default: 1.0]
      • simulation_frame_id [default: base_link]
      • map_frame_id [default: map]
      • lidar_frame_id [default: velodyne]
      • initialize_source [default: RVIZ]
      • use_waypoints_for_z_position_source [default: false]
      • sim_pose_name [default: current_pose]
      • sim_lidar_pose_name [default: localizer_pose]
      • sim_velocity_name [default: current_velocity]
      • sim_vehicle_status_name [default: vehicle_status]
      • vehicle_model_type [default: IDEAL_TWIST]
      • tread_length [default: 1.0]
      • angvel_lim [default: 3.0]
      • vel_lim [default: 30.0]
      • steer_lim [default: 1.0]
      • angvel_rate [default: 1.0]
      • steer_rate_lim [default: 0.3]
      • vel_time_delay [default: 0.25]
      • vel_time_constant [default: 0.61]
      • steer_time_delay [default: 0.24]
      • steer_time_constant [default: 0.27]
      • angvel_time_delay [default: 0.2]
      • angvel_time_constant [default: 0.5]
      • add_measurement_noise [default: true]
      • pos_noise_stddev [default: 0.01]
      • vel_noise_stddev [default: 0.01]
      • rpy_noise_stddev [default: 0.0001]
      • angvel_noise_stddev [default: 0.001]
      • steer_noise_stddev [default: 0.0001]

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged wf_simulator at Robotics Stack Exchange

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

wf_simulator 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 wf_simulator package

Additional Links

No additional links.

Maintainers

  • Takamasa HORIBE

Authors

  • Takamasa HORIBE
README
No README found. See repository README.
CHANGELOG

Changelog for package waypoint_follower

1.11.0 (2019-03-21)

  • [Feature] Rebuild decision maker (#1609)
  • Revert "Fix/health checker (#2012)" (#2037) This reverts commit e4187a7138eb90ad6f119eb35f824b16465aefda. Reverts #2012 Merged without adequate description of the bug or fixes made
  • Fix/health checker (#2012)
  • Feature/autoware health checker (#1943)
  • Fix license notice in corresponding package.xml
  • [Fix] negative max_v values for negative omega (#1880)
  • Contributors: Geoffrey Biggs, Masaya Kataoka, Sneha Ganesh, amc-nu, s-azumi

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
  • Apply clang-format and unity coding rule
  • Add sim_lidar frame to wf_simulator
  • Contributors: Akihito Ohsato, Esteve Fernandez, amc-nu

1.9.1 (2018-11-06)

1.9.0 (2018-10-31)

  • Moved configuration messages to autoware_config_msgs
  • [fix] PascalCase messages (#1408)
    • Switch message files to pascal case
    • Switch message names to pascal case in Runtime Manager
    • Switch message names to pascal case in *.yaml
    • Rename brake_cmd and steer_cmd to BrakeCmd and SteerCmd in main.yaml
  • Contributors: Esteve Fernandez

1.8.0 (2018-08-31)

  • [Fix] Moved C++11 flag to autoware_build_flags (#1395)
  • [Feature] Makes sure that all binaries have their dependencies linked (#1385)
  • fix to get wheel_base
  • Add to publish position deviation from waypoint
    • apply clang-format
    • add publisher of position deviation
  • [Fix] Extend and Update interface.yaml (#1291)
  • Contributors: Esteve Fernandez, Kenji Funaoka, Yusuke FUJII

1.7.0 (2018-05-18)

  • update Version from 1.6.3 to 1.7.0 in package.xml and CHANGELOG.rst
  • [Fix] rename packages (#1269)
    • rename lidar_tracker
    • Modify pf_lidar_track's cmake file
    • Refactor code
    • Rename from euclidean_lidar_tracker to lidar_euclidean_track
    • Rename from kf_contour_track to lidar_kf_contour_track
    • Rename from kf_lidar_track to lidar_kf_track, but need some modification in euclidean cluster(Cluster.h)
    • Rename from pf_lidar_tarck to lidar_pf_track
    • Rename range_fusion
    • Rename obj_reproj
    • Rename euclidean_cluster to lidar_euclidean_cluster_detect
    • Rename svm_lidar_detect to lidar_svm_detect
    • Rename kf_lidar_track to lidar_kf_track
    • Change version 1.6.3 to 1.7.0 in pacakge.xml
    • Modify CMake so that extrenal header would be loaded
    • Remove obj_reproj from cv_tracker
    • Add interface.yaml

File truncated at 100 lines see the full file

Launch files

  • launch/wf_simulator.launch
      • loop_rate [default: 50.0]
      • lidar_height [default: 1.0]
      • simulation_frame_id [default: base_link]
      • map_frame_id [default: map]
      • lidar_frame_id [default: velodyne]
      • initialize_source [default: RVIZ]
      • use_waypoints_for_z_position_source [default: false]
      • sim_pose_name [default: current_pose]
      • sim_lidar_pose_name [default: localizer_pose]
      • sim_velocity_name [default: current_velocity]
      • sim_vehicle_status_name [default: vehicle_status]
      • vehicle_model_type [default: IDEAL_TWIST]
      • tread_length [default: 1.0]
      • angvel_lim [default: 3.0]
      • vel_lim [default: 30.0]
      • steer_lim [default: 1.0]
      • angvel_rate [default: 1.0]
      • steer_rate_lim [default: 0.3]
      • vel_time_delay [default: 0.25]
      • vel_time_constant [default: 0.61]
      • steer_time_delay [default: 0.24]
      • steer_time_constant [default: 0.27]
      • angvel_time_delay [default: 0.2]
      • angvel_time_constant [default: 0.5]
      • add_measurement_noise [default: true]
      • pos_noise_stddev [default: 0.01]
      • vel_noise_stddev [default: 0.01]
      • rpy_noise_stddev [default: 0.0001]
      • angvel_noise_stddev [default: 0.001]
      • steer_noise_stddev [default: 0.0001]

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged wf_simulator at Robotics Stack Exchange

Package symbol

wf_simulator 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 wf_simulator package

Additional Links

No additional links.

Maintainers

  • Takamasa HORIBE

Authors

  • Takamasa HORIBE
README
No README found. See repository README.
CHANGELOG

Changelog for package waypoint_follower

1.11.0 (2019-03-21)

  • [Feature] Rebuild decision maker (#1609)
  • Revert "Fix/health checker (#2012)" (#2037) This reverts commit e4187a7138eb90ad6f119eb35f824b16465aefda. Reverts #2012 Merged without adequate description of the bug or fixes made
  • Fix/health checker (#2012)
  • Feature/autoware health checker (#1943)
  • Fix license notice in corresponding package.xml
  • [Fix] negative max_v values for negative omega (#1880)
  • Contributors: Geoffrey Biggs, Masaya Kataoka, Sneha Ganesh, amc-nu, s-azumi

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
  • Apply clang-format and unity coding rule
  • Add sim_lidar frame to wf_simulator
  • Contributors: Akihito Ohsato, Esteve Fernandez, amc-nu

1.9.1 (2018-11-06)

1.9.0 (2018-10-31)

  • Moved configuration messages to autoware_config_msgs
  • [fix] PascalCase messages (#1408)
    • Switch message files to pascal case
    • Switch message names to pascal case in Runtime Manager
    • Switch message names to pascal case in *.yaml
    • Rename brake_cmd and steer_cmd to BrakeCmd and SteerCmd in main.yaml
  • Contributors: Esteve Fernandez

1.8.0 (2018-08-31)

  • [Fix] Moved C++11 flag to autoware_build_flags (#1395)
  • [Feature] Makes sure that all binaries have their dependencies linked (#1385)
  • fix to get wheel_base
  • Add to publish position deviation from waypoint
    • apply clang-format
    • add publisher of position deviation
  • [Fix] Extend and Update interface.yaml (#1291)
  • Contributors: Esteve Fernandez, Kenji Funaoka, Yusuke FUJII

1.7.0 (2018-05-18)

  • update Version from 1.6.3 to 1.7.0 in package.xml and CHANGELOG.rst
  • [Fix] rename packages (#1269)
    • rename lidar_tracker
    • Modify pf_lidar_track's cmake file
    • Refactor code
    • Rename from euclidean_lidar_tracker to lidar_euclidean_track
    • Rename from kf_contour_track to lidar_kf_contour_track
    • Rename from kf_lidar_track to lidar_kf_track, but need some modification in euclidean cluster(Cluster.h)
    • Rename from pf_lidar_tarck to lidar_pf_track
    • Rename range_fusion
    • Rename obj_reproj
    • Rename euclidean_cluster to lidar_euclidean_cluster_detect
    • Rename svm_lidar_detect to lidar_svm_detect
    • Rename kf_lidar_track to lidar_kf_track
    • Change version 1.6.3 to 1.7.0 in pacakge.xml
    • Modify CMake so that extrenal header would be loaded
    • Remove obj_reproj from cv_tracker
    • Add interface.yaml

File truncated at 100 lines see the full file

Launch files

  • launch/wf_simulator.launch
      • loop_rate [default: 50.0]
      • lidar_height [default: 1.0]
      • simulation_frame_id [default: base_link]
      • map_frame_id [default: map]
      • lidar_frame_id [default: velodyne]
      • initialize_source [default: RVIZ]
      • use_waypoints_for_z_position_source [default: false]
      • sim_pose_name [default: current_pose]
      • sim_lidar_pose_name [default: localizer_pose]
      • sim_velocity_name [default: current_velocity]
      • sim_vehicle_status_name [default: vehicle_status]
      • vehicle_model_type [default: IDEAL_TWIST]
      • tread_length [default: 1.0]
      • angvel_lim [default: 3.0]
      • vel_lim [default: 30.0]
      • steer_lim [default: 1.0]
      • angvel_rate [default: 1.0]
      • steer_rate_lim [default: 0.3]
      • vel_time_delay [default: 0.25]
      • vel_time_constant [default: 0.61]
      • steer_time_delay [default: 0.24]
      • steer_time_constant [default: 0.27]
      • angvel_time_delay [default: 0.2]
      • angvel_time_constant [default: 0.5]
      • add_measurement_noise [default: true]
      • pos_noise_stddev [default: 0.01]
      • vel_noise_stddev [default: 0.01]
      • rpy_noise_stddev [default: 0.0001]
      • angvel_noise_stddev [default: 0.001]
      • steer_noise_stddev [default: 0.0001]

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged wf_simulator at Robotics Stack Exchange

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

wf_simulator 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 wf_simulator package

Additional Links

No additional links.

Maintainers

  • Takamasa HORIBE

Authors

  • Takamasa HORIBE
README
No README found. See repository README.
CHANGELOG

Changelog for package waypoint_follower

1.11.0 (2019-03-21)

  • [Feature] Rebuild decision maker (#1609)
  • Revert "Fix/health checker (#2012)" (#2037) This reverts commit e4187a7138eb90ad6f119eb35f824b16465aefda. Reverts #2012 Merged without adequate description of the bug or fixes made
  • Fix/health checker (#2012)
  • Feature/autoware health checker (#1943)
  • Fix license notice in corresponding package.xml
  • [Fix] negative max_v values for negative omega (#1880)
  • Contributors: Geoffrey Biggs, Masaya Kataoka, Sneha Ganesh, amc-nu, s-azumi

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
  • Apply clang-format and unity coding rule
  • Add sim_lidar frame to wf_simulator
  • Contributors: Akihito Ohsato, Esteve Fernandez, amc-nu

1.9.1 (2018-11-06)

1.9.0 (2018-10-31)

  • Moved configuration messages to autoware_config_msgs
  • [fix] PascalCase messages (#1408)
    • Switch message files to pascal case
    • Switch message names to pascal case in Runtime Manager
    • Switch message names to pascal case in *.yaml
    • Rename brake_cmd and steer_cmd to BrakeCmd and SteerCmd in main.yaml
  • Contributors: Esteve Fernandez

1.8.0 (2018-08-31)

  • [Fix] Moved C++11 flag to autoware_build_flags (#1395)
  • [Feature] Makes sure that all binaries have their dependencies linked (#1385)
  • fix to get wheel_base
  • Add to publish position deviation from waypoint
    • apply clang-format
    • add publisher of position deviation
  • [Fix] Extend and Update interface.yaml (#1291)
  • Contributors: Esteve Fernandez, Kenji Funaoka, Yusuke FUJII

1.7.0 (2018-05-18)

  • update Version from 1.6.3 to 1.7.0 in package.xml and CHANGELOG.rst
  • [Fix] rename packages (#1269)
    • rename lidar_tracker
    • Modify pf_lidar_track's cmake file
    • Refactor code
    • Rename from euclidean_lidar_tracker to lidar_euclidean_track
    • Rename from kf_contour_track to lidar_kf_contour_track
    • Rename from kf_lidar_track to lidar_kf_track, but need some modification in euclidean cluster(Cluster.h)
    • Rename from pf_lidar_tarck to lidar_pf_track
    • Rename range_fusion
    • Rename obj_reproj
    • Rename euclidean_cluster to lidar_euclidean_cluster_detect
    • Rename svm_lidar_detect to lidar_svm_detect
    • Rename kf_lidar_track to lidar_kf_track
    • Change version 1.6.3 to 1.7.0 in pacakge.xml
    • Modify CMake so that extrenal header would be loaded
    • Remove obj_reproj from cv_tracker
    • Add interface.yaml

File truncated at 100 lines see the full file

Launch files

  • launch/wf_simulator.launch
      • loop_rate [default: 50.0]
      • lidar_height [default: 1.0]
      • simulation_frame_id [default: base_link]
      • map_frame_id [default: map]
      • lidar_frame_id [default: velodyne]
      • initialize_source [default: RVIZ]
      • use_waypoints_for_z_position_source [default: false]
      • sim_pose_name [default: current_pose]
      • sim_lidar_pose_name [default: localizer_pose]
      • sim_velocity_name [default: current_velocity]
      • sim_vehicle_status_name [default: vehicle_status]
      • vehicle_model_type [default: IDEAL_TWIST]
      • tread_length [default: 1.0]
      • angvel_lim [default: 3.0]
      • vel_lim [default: 30.0]
      • steer_lim [default: 1.0]
      • angvel_rate [default: 1.0]
      • steer_rate_lim [default: 0.3]
      • vel_time_delay [default: 0.25]
      • vel_time_constant [default: 0.61]
      • steer_time_delay [default: 0.24]
      • steer_time_constant [default: 0.27]
      • angvel_time_delay [default: 0.2]
      • angvel_time_constant [default: 0.5]
      • add_measurement_noise [default: true]
      • pos_noise_stddev [default: 0.01]
      • vel_noise_stddev [default: 0.01]
      • rpy_noise_stddev [default: 0.0001]
      • angvel_noise_stddev [default: 0.001]
      • steer_noise_stddev [default: 0.0001]

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged wf_simulator at Robotics Stack Exchange

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

wf_simulator 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 wf_simulator package

Additional Links

No additional links.

Maintainers

  • Takamasa HORIBE

Authors

  • Takamasa HORIBE
README
No README found. See repository README.
CHANGELOG

Changelog for package waypoint_follower

1.11.0 (2019-03-21)

  • [Feature] Rebuild decision maker (#1609)
  • Revert "Fix/health checker (#2012)" (#2037) This reverts commit e4187a7138eb90ad6f119eb35f824b16465aefda. Reverts #2012 Merged without adequate description of the bug or fixes made
  • Fix/health checker (#2012)
  • Feature/autoware health checker (#1943)
  • Fix license notice in corresponding package.xml
  • [Fix] negative max_v values for negative omega (#1880)
  • Contributors: Geoffrey Biggs, Masaya Kataoka, Sneha Ganesh, amc-nu, s-azumi

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
  • Apply clang-format and unity coding rule
  • Add sim_lidar frame to wf_simulator
  • Contributors: Akihito Ohsato, Esteve Fernandez, amc-nu

1.9.1 (2018-11-06)

1.9.0 (2018-10-31)

  • Moved configuration messages to autoware_config_msgs
  • [fix] PascalCase messages (#1408)
    • Switch message files to pascal case
    • Switch message names to pascal case in Runtime Manager
    • Switch message names to pascal case in *.yaml
    • Rename brake_cmd and steer_cmd to BrakeCmd and SteerCmd in main.yaml
  • Contributors: Esteve Fernandez

1.8.0 (2018-08-31)

  • [Fix] Moved C++11 flag to autoware_build_flags (#1395)
  • [Feature] Makes sure that all binaries have their dependencies linked (#1385)
  • fix to get wheel_base
  • Add to publish position deviation from waypoint
    • apply clang-format
    • add publisher of position deviation
  • [Fix] Extend and Update interface.yaml (#1291)
  • Contributors: Esteve Fernandez, Kenji Funaoka, Yusuke FUJII

1.7.0 (2018-05-18)

  • update Version from 1.6.3 to 1.7.0 in package.xml and CHANGELOG.rst
  • [Fix] rename packages (#1269)
    • rename lidar_tracker
    • Modify pf_lidar_track's cmake file
    • Refactor code
    • Rename from euclidean_lidar_tracker to lidar_euclidean_track
    • Rename from kf_contour_track to lidar_kf_contour_track
    • Rename from kf_lidar_track to lidar_kf_track, but need some modification in euclidean cluster(Cluster.h)
    • Rename from pf_lidar_tarck to lidar_pf_track
    • Rename range_fusion
    • Rename obj_reproj
    • Rename euclidean_cluster to lidar_euclidean_cluster_detect
    • Rename svm_lidar_detect to lidar_svm_detect
    • Rename kf_lidar_track to lidar_kf_track
    • Change version 1.6.3 to 1.7.0 in pacakge.xml
    • Modify CMake so that extrenal header would be loaded
    • Remove obj_reproj from cv_tracker
    • Add interface.yaml

File truncated at 100 lines see the full file

Launch files

  • launch/wf_simulator.launch
      • loop_rate [default: 50.0]
      • lidar_height [default: 1.0]
      • simulation_frame_id [default: base_link]
      • map_frame_id [default: map]
      • lidar_frame_id [default: velodyne]
      • initialize_source [default: RVIZ]
      • use_waypoints_for_z_position_source [default: false]
      • sim_pose_name [default: current_pose]
      • sim_lidar_pose_name [default: localizer_pose]
      • sim_velocity_name [default: current_velocity]
      • sim_vehicle_status_name [default: vehicle_status]
      • vehicle_model_type [default: IDEAL_TWIST]
      • tread_length [default: 1.0]
      • angvel_lim [default: 3.0]
      • vel_lim [default: 30.0]
      • steer_lim [default: 1.0]
      • angvel_rate [default: 1.0]
      • steer_rate_lim [default: 0.3]
      • vel_time_delay [default: 0.25]
      • vel_time_constant [default: 0.61]
      • steer_time_delay [default: 0.24]
      • steer_time_constant [default: 0.27]
      • angvel_time_delay [default: 0.2]
      • angvel_time_constant [default: 0.5]
      • add_measurement_noise [default: true]
      • pos_noise_stddev [default: 0.01]
      • vel_noise_stddev [default: 0.01]
      • rpy_noise_stddev [default: 0.0001]
      • angvel_noise_stddev [default: 0.001]
      • steer_noise_stddev [default: 0.0001]

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged wf_simulator at Robotics Stack Exchange

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

wf_simulator 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 wf_simulator package

Additional Links

No additional links.

Maintainers

  • Takamasa HORIBE

Authors

  • Takamasa HORIBE
README
No README found. See repository README.
CHANGELOG

Changelog for package waypoint_follower

1.11.0 (2019-03-21)

  • [Feature] Rebuild decision maker (#1609)
  • Revert "Fix/health checker (#2012)" (#2037) This reverts commit e4187a7138eb90ad6f119eb35f824b16465aefda. Reverts #2012 Merged without adequate description of the bug or fixes made
  • Fix/health checker (#2012)
  • Feature/autoware health checker (#1943)
  • Fix license notice in corresponding package.xml
  • [Fix] negative max_v values for negative omega (#1880)
  • Contributors: Geoffrey Biggs, Masaya Kataoka, Sneha Ganesh, amc-nu, s-azumi

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
  • Apply clang-format and unity coding rule
  • Add sim_lidar frame to wf_simulator
  • Contributors: Akihito Ohsato, Esteve Fernandez, amc-nu

1.9.1 (2018-11-06)

1.9.0 (2018-10-31)

  • Moved configuration messages to autoware_config_msgs
  • [fix] PascalCase messages (#1408)
    • Switch message files to pascal case
    • Switch message names to pascal case in Runtime Manager
    • Switch message names to pascal case in *.yaml
    • Rename brake_cmd and steer_cmd to BrakeCmd and SteerCmd in main.yaml
  • Contributors: Esteve Fernandez

1.8.0 (2018-08-31)

  • [Fix] Moved C++11 flag to autoware_build_flags (#1395)
  • [Feature] Makes sure that all binaries have their dependencies linked (#1385)
  • fix to get wheel_base
  • Add to publish position deviation from waypoint
    • apply clang-format
    • add publisher of position deviation
  • [Fix] Extend and Update interface.yaml (#1291)
  • Contributors: Esteve Fernandez, Kenji Funaoka, Yusuke FUJII

1.7.0 (2018-05-18)

  • update Version from 1.6.3 to 1.7.0 in package.xml and CHANGELOG.rst
  • [Fix] rename packages (#1269)
    • rename lidar_tracker
    • Modify pf_lidar_track's cmake file
    • Refactor code
    • Rename from euclidean_lidar_tracker to lidar_euclidean_track
    • Rename from kf_contour_track to lidar_kf_contour_track
    • Rename from kf_lidar_track to lidar_kf_track, but need some modification in euclidean cluster(Cluster.h)
    • Rename from pf_lidar_tarck to lidar_pf_track
    • Rename range_fusion
    • Rename obj_reproj
    • Rename euclidean_cluster to lidar_euclidean_cluster_detect
    • Rename svm_lidar_detect to lidar_svm_detect
    • Rename kf_lidar_track to lidar_kf_track
    • Change version 1.6.3 to 1.7.0 in pacakge.xml
    • Modify CMake so that extrenal header would be loaded
    • Remove obj_reproj from cv_tracker
    • Add interface.yaml

File truncated at 100 lines see the full file

Launch files

  • launch/wf_simulator.launch
      • loop_rate [default: 50.0]
      • lidar_height [default: 1.0]
      • simulation_frame_id [default: base_link]
      • map_frame_id [default: map]
      • lidar_frame_id [default: velodyne]
      • initialize_source [default: RVIZ]
      • use_waypoints_for_z_position_source [default: false]
      • sim_pose_name [default: current_pose]
      • sim_lidar_pose_name [default: localizer_pose]
      • sim_velocity_name [default: current_velocity]
      • sim_vehicle_status_name [default: vehicle_status]
      • vehicle_model_type [default: IDEAL_TWIST]
      • tread_length [default: 1.0]
      • angvel_lim [default: 3.0]
      • vel_lim [default: 30.0]
      • steer_lim [default: 1.0]
      • angvel_rate [default: 1.0]
      • steer_rate_lim [default: 0.3]
      • vel_time_delay [default: 0.25]
      • vel_time_constant [default: 0.61]
      • steer_time_delay [default: 0.24]
      • steer_time_constant [default: 0.27]
      • angvel_time_delay [default: 0.2]
      • angvel_time_constant [default: 0.5]
      • add_measurement_noise [default: true]
      • pos_noise_stddev [default: 0.01]
      • vel_noise_stddev [default: 0.01]
      • rpy_noise_stddev [default: 0.0001]
      • angvel_noise_stddev [default: 0.001]
      • steer_noise_stddev [default: 0.0001]

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged wf_simulator at Robotics Stack Exchange

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

wf_simulator 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 wf_simulator package

Additional Links

No additional links.

Maintainers

  • Takamasa HORIBE

Authors

  • Takamasa HORIBE
README
No README found. See repository README.
CHANGELOG

Changelog for package waypoint_follower

1.11.0 (2019-03-21)

  • [Feature] Rebuild decision maker (#1609)
  • Revert "Fix/health checker (#2012)" (#2037) This reverts commit e4187a7138eb90ad6f119eb35f824b16465aefda. Reverts #2012 Merged without adequate description of the bug or fixes made
  • Fix/health checker (#2012)
  • Feature/autoware health checker (#1943)
  • Fix license notice in corresponding package.xml
  • [Fix] negative max_v values for negative omega (#1880)
  • Contributors: Geoffrey Biggs, Masaya Kataoka, Sneha Ganesh, amc-nu, s-azumi

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
  • Apply clang-format and unity coding rule
  • Add sim_lidar frame to wf_simulator
  • Contributors: Akihito Ohsato, Esteve Fernandez, amc-nu

1.9.1 (2018-11-06)

1.9.0 (2018-10-31)

  • Moved configuration messages to autoware_config_msgs
  • [fix] PascalCase messages (#1408)
    • Switch message files to pascal case
    • Switch message names to pascal case in Runtime Manager
    • Switch message names to pascal case in *.yaml
    • Rename brake_cmd and steer_cmd to BrakeCmd and SteerCmd in main.yaml
  • Contributors: Esteve Fernandez

1.8.0 (2018-08-31)

  • [Fix] Moved C++11 flag to autoware_build_flags (#1395)
  • [Feature] Makes sure that all binaries have their dependencies linked (#1385)
  • fix to get wheel_base
  • Add to publish position deviation from waypoint
    • apply clang-format
    • add publisher of position deviation
  • [Fix] Extend and Update interface.yaml (#1291)
  • Contributors: Esteve Fernandez, Kenji Funaoka, Yusuke FUJII

1.7.0 (2018-05-18)

  • update Version from 1.6.3 to 1.7.0 in package.xml and CHANGELOG.rst
  • [Fix] rename packages (#1269)
    • rename lidar_tracker
    • Modify pf_lidar_track's cmake file
    • Refactor code
    • Rename from euclidean_lidar_tracker to lidar_euclidean_track
    • Rename from kf_contour_track to lidar_kf_contour_track
    • Rename from kf_lidar_track to lidar_kf_track, but need some modification in euclidean cluster(Cluster.h)
    • Rename from pf_lidar_tarck to lidar_pf_track
    • Rename range_fusion
    • Rename obj_reproj
    • Rename euclidean_cluster to lidar_euclidean_cluster_detect
    • Rename svm_lidar_detect to lidar_svm_detect
    • Rename kf_lidar_track to lidar_kf_track
    • Change version 1.6.3 to 1.7.0 in pacakge.xml
    • Modify CMake so that extrenal header would be loaded
    • Remove obj_reproj from cv_tracker
    • Add interface.yaml

File truncated at 100 lines see the full file

Launch files

  • launch/wf_simulator.launch
      • loop_rate [default: 50.0]
      • lidar_height [default: 1.0]
      • simulation_frame_id [default: base_link]
      • map_frame_id [default: map]
      • lidar_frame_id [default: velodyne]
      • initialize_source [default: RVIZ]
      • use_waypoints_for_z_position_source [default: false]
      • sim_pose_name [default: current_pose]
      • sim_lidar_pose_name [default: localizer_pose]
      • sim_velocity_name [default: current_velocity]
      • sim_vehicle_status_name [default: vehicle_status]
      • vehicle_model_type [default: IDEAL_TWIST]
      • tread_length [default: 1.0]
      • angvel_lim [default: 3.0]
      • vel_lim [default: 30.0]
      • steer_lim [default: 1.0]
      • angvel_rate [default: 1.0]
      • steer_rate_lim [default: 0.3]
      • vel_time_delay [default: 0.25]
      • vel_time_constant [default: 0.61]
      • steer_time_delay [default: 0.24]
      • steer_time_constant [default: 0.27]
      • angvel_time_delay [default: 0.2]
      • angvel_time_constant [default: 0.5]
      • add_measurement_noise [default: true]
      • pos_noise_stddev [default: 0.01]
      • vel_noise_stddev [default: 0.01]
      • rpy_noise_stddev [default: 0.0001]
      • angvel_noise_stddev [default: 0.001]
      • steer_noise_stddev [default: 0.0001]

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged wf_simulator at Robotics Stack Exchange