Package symbol

autoware_lint_common package from autoware_cmake repo

autoware_cmake autoware_lint_common

ROS Distro
humble

Package Summary

Tags No category tags.
Version 1.0.2
License Apache License 2.0
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Description CMake packages for working with Autoware
Checkout URI https://github.com/autowarefoundation/autoware_cmake.git
VCS Type git
VCS Version main
Last Updated 2025-07-05
Dev Status DEVELOPED
Released RELEASED
Tags No category tags.
Contributing Help Wanted (-)
Good First Issues (-)
Pull Requests to Review (-)

Package Description

The list of commonly used linters in Autoware

Additional Links

No additional links.

Maintainers

  • Ryohsuke Mitsudome
  • Esteve Fernandez

Authors

No additional authors.

autoware_lint_common

A custom version of ament_lint_common for Autoware.

Usage

Add dependencies of ament_lint_auto and autoware_lint_common to your package as below.

package.xml:

<test_depend>ament_lint_auto</test_depend>
<test_depend>autoware_lint_common</test_depend>

CMakeLists.txt:

if(BUILD_TESTING)
  find_package(ament_lint_auto REQUIRED)
  ament_lint_auto_find_test_dependencies()
endif()

For ROS 2 messages and services, you need to remove the ADD_LINTER_TESTS argument in the rosidl_generate_interfaces() function in the CMakelists.txt file.

Then, the following linters will run during colcon test.

Design

The original ament_lint_common contains other formatters/linters like ament_cmake_uncrustify, ament_cmake_cpplint and ament_cmake_flake8. However, we don’t include them because it’s more useful to run them with pre-commit as MoveIt does.

For example, the benefits are:

  • We can use any version of tools independent of ament’s version.
  • We can easily integrate into IDE.
  • We can easily check all the files in the repository without writing test_depend in each package.
  • We can run formatters/linters without building, which makes error detection faster.

Ideally, we think other linters should be moved to pre-commit as well, so we’ll try to support them in the future.

CHANGELOG

Changelog for package autoware_lint_common

1.0.2 (2025-04-08)

1.0.1 (2025-03-17)

  • fix(autoware_cmake): fix links to issues in CHANGELOG.rst files (#13)
  • Contributors: Esteve Fernandez

1.0.0 (2024-05-02)

  • Merge pull request #1 from youtalk/import-from-autoware-common feat: import from autoware_common
  • Merge branch 'autoware-lint-common' into import-from-autoware-common
  • move to autoware_lint_common
  • Contributors: Yutaka Kondo

Dependant Packages

Name Deps
autoware_adapi_adaptors
autoware_adapi_specs
autoware_core_api
autoware_default_adapi
autoware_core
autoware_component_interface_specs
autoware_geography_utils
autoware_global_parameter_loader
autoware_interpolation
autoware_kalman_filter
autoware_motion_utils
autoware_node
autoware_object_recognition_utils
autoware_osqp_interface
autoware_point_types
autoware_qp_interface
autoware_signal_processing
autoware_trajectory
autoware_vehicle_info_utils
autoware_core_control
autoware_simple_pure_pursuit
autoware_core_localization
autoware_ekf_localizer
autoware_gyro_odometer
autoware_pose_initializer
autoware_stop_filter
autoware_twist2accel
autoware_core_map
autoware_lanelet2_map_visualizer
autoware_map_height_fitter
autoware_map_loader
autoware_map_projection_loader
autoware_core_perception
autoware_euclidean_cluster_object_detector
autoware_ground_filter
autoware_perception_objects_converter
autoware_core_planning
autoware_mission_planner
autoware_objects_of_interest_marker_interface
autoware_path_generator
autoware_planning_factor_interface
autoware_planning_topic_converter
autoware_route_handler
autoware_velocity_smoother
autoware_behavior_velocity_planner
autoware_behavior_velocity_planner_common
autoware_behavior_velocity_stop_line_module
autoware_motion_velocity_obstacle_stop_module
autoware_motion_velocity_planner
autoware_motion_velocity_planner_common
autoware_core_sensing
autoware_crop_box_filter
autoware_downsample_filters
autoware_gnss_poser
autoware_vehicle_velocity_converter
autoware_planning_test_manager
autoware_pyplot
autoware_test_utils
autoware_core_vehicle
autoware_cmake
autoware_utils
autoware_utils_debug
autoware_utils_diagnostics
autoware_utils_geometry
autoware_utils_logging
autoware_utils_math
autoware_utils_pcl
autoware_utils_rclcpp
autoware_utils_system
autoware_utils_tf
autoware_utils_uuid
autoware_utils_visualization

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged autoware_lint_common at Robotics Stack Exchange

Package symbol

autoware_lint_common package from autoware_cmake repo

autoware_cmake autoware_lint_common

ROS Distro
jazzy

Package Summary

Tags No category tags.
Version 1.0.2
License Apache License 2.0
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Description CMake packages for working with Autoware
Checkout URI https://github.com/autowarefoundation/autoware_cmake.git
VCS Type git
VCS Version main
Last Updated 2025-07-05
Dev Status DEVELOPED
Released RELEASED
Tags No category tags.
Contributing Help Wanted (-)
Good First Issues (-)
Pull Requests to Review (-)

Package Description

The list of commonly used linters in Autoware

Additional Links

No additional links.

Maintainers

  • Ryohsuke Mitsudome
  • Esteve Fernandez

Authors

No additional authors.

autoware_lint_common

A custom version of ament_lint_common for Autoware.

Usage

Add dependencies of ament_lint_auto and autoware_lint_common to your package as below.

package.xml:

<test_depend>ament_lint_auto</test_depend>
<test_depend>autoware_lint_common</test_depend>

CMakeLists.txt:

if(BUILD_TESTING)
  find_package(ament_lint_auto REQUIRED)
  ament_lint_auto_find_test_dependencies()
endif()

For ROS 2 messages and services, you need to remove the ADD_LINTER_TESTS argument in the rosidl_generate_interfaces() function in the CMakelists.txt file.

Then, the following linters will run during colcon test.

Design

The original ament_lint_common contains other formatters/linters like ament_cmake_uncrustify, ament_cmake_cpplint and ament_cmake_flake8. However, we don’t include them because it’s more useful to run them with pre-commit as MoveIt does.

For example, the benefits are:

  • We can use any version of tools independent of ament’s version.
  • We can easily integrate into IDE.
  • We can easily check all the files in the repository without writing test_depend in each package.
  • We can run formatters/linters without building, which makes error detection faster.

Ideally, we think other linters should be moved to pre-commit as well, so we’ll try to support them in the future.

CHANGELOG

Changelog for package autoware_lint_common

1.0.2 (2025-04-08)

1.0.1 (2025-03-17)

  • fix(autoware_cmake): fix links to issues in CHANGELOG.rst files (#13)
  • Contributors: Esteve Fernandez

1.0.0 (2024-05-02)

  • Merge pull request #1 from youtalk/import-from-autoware-common feat: import from autoware_common
  • Merge branch 'autoware-lint-common' into import-from-autoware-common
  • move to autoware_lint_common
  • Contributors: Yutaka Kondo

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged autoware_lint_common at Robotics Stack Exchange

Package symbol

autoware_lint_common package from autoware_cmake repo

autoware_cmake autoware_lint_common

ROS Distro
kilted

Package Summary

Tags No category tags.
Version 1.0.2
License Apache License 2.0
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Description CMake packages for working with Autoware
Checkout URI https://github.com/autowarefoundation/autoware_cmake.git
VCS Type git
VCS Version main
Last Updated 2025-07-05
Dev Status DEVELOPED
Released RELEASED
Tags No category tags.
Contributing Help Wanted (-)
Good First Issues (-)
Pull Requests to Review (-)

Package Description

The list of commonly used linters in Autoware

Additional Links

No additional links.

Maintainers

  • Ryohsuke Mitsudome
  • Esteve Fernandez

Authors

No additional authors.

autoware_lint_common

A custom version of ament_lint_common for Autoware.

Usage

Add dependencies of ament_lint_auto and autoware_lint_common to your package as below.

package.xml:

<test_depend>ament_lint_auto</test_depend>
<test_depend>autoware_lint_common</test_depend>

CMakeLists.txt:

if(BUILD_TESTING)
  find_package(ament_lint_auto REQUIRED)
  ament_lint_auto_find_test_dependencies()
endif()

For ROS 2 messages and services, you need to remove the ADD_LINTER_TESTS argument in the rosidl_generate_interfaces() function in the CMakelists.txt file.

Then, the following linters will run during colcon test.

Design

The original ament_lint_common contains other formatters/linters like ament_cmake_uncrustify, ament_cmake_cpplint and ament_cmake_flake8. However, we don’t include them because it’s more useful to run them with pre-commit as MoveIt does.

For example, the benefits are:

  • We can use any version of tools independent of ament’s version.
  • We can easily integrate into IDE.
  • We can easily check all the files in the repository without writing test_depend in each package.
  • We can run formatters/linters without building, which makes error detection faster.

Ideally, we think other linters should be moved to pre-commit as well, so we’ll try to support them in the future.

CHANGELOG

Changelog for package autoware_lint_common

1.0.2 (2025-04-08)

1.0.1 (2025-03-17)

  • fix(autoware_cmake): fix links to issues in CHANGELOG.rst files (#13)
  • Contributors: Esteve Fernandez

1.0.0 (2024-05-02)

  • Merge pull request #1 from youtalk/import-from-autoware-common feat: import from autoware_common
  • Merge branch 'autoware-lint-common' into import-from-autoware-common
  • move to autoware_lint_common
  • Contributors: Yutaka Kondo

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged autoware_lint_common at Robotics Stack Exchange

Package symbol

autoware_lint_common package from autoware_cmake repo

autoware_cmake autoware_lint_common

ROS Distro
rolling

Package Summary

Tags No category tags.
Version 1.0.2
License Apache License 2.0
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Description CMake packages for working with Autoware
Checkout URI https://github.com/autowarefoundation/autoware_cmake.git
VCS Type git
VCS Version main
Last Updated 2025-07-05
Dev Status DEVELOPED
Released RELEASED
Tags No category tags.
Contributing Help Wanted (-)
Good First Issues (-)
Pull Requests to Review (-)

Package Description

The list of commonly used linters in Autoware

Additional Links

No additional links.

Maintainers

  • Ryohsuke Mitsudome
  • Esteve Fernandez

Authors

No additional authors.

autoware_lint_common

A custom version of ament_lint_common for Autoware.

Usage

Add dependencies of ament_lint_auto and autoware_lint_common to your package as below.

package.xml:

<test_depend>ament_lint_auto</test_depend>
<test_depend>autoware_lint_common</test_depend>

CMakeLists.txt:

if(BUILD_TESTING)
  find_package(ament_lint_auto REQUIRED)
  ament_lint_auto_find_test_dependencies()
endif()

For ROS 2 messages and services, you need to remove the ADD_LINTER_TESTS argument in the rosidl_generate_interfaces() function in the CMakelists.txt file.

Then, the following linters will run during colcon test.

Design

The original ament_lint_common contains other formatters/linters like ament_cmake_uncrustify, ament_cmake_cpplint and ament_cmake_flake8. However, we don’t include them because it’s more useful to run them with pre-commit as MoveIt does.

For example, the benefits are:

  • We can use any version of tools independent of ament’s version.
  • We can easily integrate into IDE.
  • We can easily check all the files in the repository without writing test_depend in each package.
  • We can run formatters/linters without building, which makes error detection faster.

Ideally, we think other linters should be moved to pre-commit as well, so we’ll try to support them in the future.

CHANGELOG

Changelog for package autoware_lint_common

1.0.2 (2025-04-08)

1.0.1 (2025-03-17)

  • fix(autoware_cmake): fix links to issues in CHANGELOG.rst files (#13)
  • Contributors: Esteve Fernandez

1.0.0 (2024-05-02)

  • Merge pull request #1 from youtalk/import-from-autoware-common feat: import from autoware_common
  • Merge branch 'autoware-lint-common' into import-from-autoware-common
  • move to autoware_lint_common
  • Contributors: Yutaka Kondo

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged autoware_lint_common at Robotics Stack Exchange

Package symbol

autoware_lint_common package from autoware_car repo

autoware_auto_control_msgs autoware_auto_geometry_msgs autoware_auto_mapping_msgs autoware_auto_perception_msgs autoware_auto_planning_msgs autoware_auto_vehicle_msgs autoware_launch ekf_localizer gyro_odometer initial_pose_button_panel localization_error_monitor ndt_scan_matcher pose2twist pose_initializer stop_filter twist2accel autoware_adapi_v1_msgs autoware_cmake autoware_utils lanelet2_extension autoware_common_msgs autoware_planning_msgs autoware_ad_api_specs autoware_point_types interpolation kalman_filter motion_utils signal_processing tier4_autoware_utils component_interface_specs component_interface_utils ndt_omp tier4_control_msgs tier4_debug_msgs tier4_localization_msgs tier4_system_msgs tier4_localization_launch tier4_map_launch tier4_simulator_launch tier4_system_launch tier4_vehicle_launch pointcloud_preprocessor tier4_pcl_extensions vehicle_velocity_converter automatic_pose_initializer map_height_fitter map_loader map_tf_generator autoware_lint_common autoware_map_msgs tier4_external_api_msgs lanelet2_map_preprocessor autoware_slam autoware_gazebo autoware_gazebo_individual_params autoware_gazebo_launch autoware_gazebo_utils autoware_webots autoware_webots_individual_params autoware_webots_launch autoware_webots_utils robot webots_ros2_driver webots_ros2_msgs cartographer cartographer_ros cartographer_ros_msgs cartographer_rviz dolly dolly_follow dolly_gazebo dolly_ignition ndt_omp_ros2 graph_based_slam lidarslam lidarslam_msgs scanmatcher lio_sam pcl_localization_ros2 velodyne_description velodyne_gazebo_plugins velodyne_simulator

ROS Distro
github

Package Summary

Tags No category tags.
Version 0.1.0
License Apache License 2.0
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Description
Checkout URI https://github.com/qin-yuan/autoware_car.git
VCS Type git
VCS Version master
Last Updated 2024-12-19
Dev Status UNKNOWN
Released UNRELEASED
Tags No category tags.
Contributing Help Wanted (-)
Good First Issues (-)
Pull Requests to Review (-)

Package Description

The list of commonly used linters in Autoware

Additional Links

No additional links.

Maintainers

  • Kenji Miyake
  • Esteve Fernandez

Authors

No additional authors.

autoware_lint_common

A custom version of ament_lint_common for Autoware.

Usage

Add dependencies of ament_lint_auto and autoware_lint_common to your package as below.

package.xml:

<test_depend>ament_lint_auto</test_depend>
<test_depend>autoware_lint_common</test_depend>

CMakeLists.txt:

if(BUILD_TESTING)
  find_package(ament_lint_auto REQUIRED)
  ament_lint_auto_find_test_dependencies()
endif()

For ROS 2 messages and services, you need to remove the ADD_LINTER_TESTS argument in the rosidl_generate_interfaces() function in the CMakelists.txt file.

Then, the following linters will run during colcon test.

Design

The original ament_lint_common contains other formatters/linters like ament_cmake_uncrustify, ament_cmake_cpplint and ament_cmake_flake8. However, we don’t include them because it’s more useful to run them with pre-commit as MoveIt does.

For example, the benefits are:

  • We can use any version of tools independent of ament’s version.
  • We can easily integrate into IDE.
  • We can easily check all the files in the repository without writing test_depend in each package.
  • We can run formatters/linters without building, which makes error detection faster.

Ideally, we think other linters should be moved to pre-commit as well, so we’ll try to support them in the future.

CHANGELOG
No CHANGELOG found.

Dependant Packages

Name Deps
aichallenge_launch
aichallenge_launch
aichallenge_launch
obstacle_stop_planner_custom
tier4_autoware_api_launch
tier4_autoware_api_launch
tier4_autoware_api_launch
tier4_autoware_api_launch
tier4_autoware_api_launch
tier4_control_launch
tier4_control_launch
tier4_control_launch
tier4_control_launch
tier4_control_launch
tier4_localization_launch
tier4_localization_launch
tier4_localization_launch
tier4_localization_launch
tier4_localization_launch
tier4_localization_launch
tier4_map_launch
tier4_map_launch
tier4_map_launch
tier4_map_launch
tier4_map_launch
tier4_map_launch
tier4_perception_launch
tier4_perception_launch
tier4_perception_launch
tier4_perception_launch
tier4_perception_launch
tier4_planning_launch
tier4_planning_launch
tier4_planning_launch
tier4_planning_launch
tier4_planning_launch
tier4_sensing_launch
tier4_sensing_launch
tier4_sensing_launch
tier4_sensing_launch
tier4_sensing_launch
tier4_simulator_launch
tier4_simulator_launch
tier4_simulator_launch
tier4_simulator_launch
tier4_simulator_launch
tier4_simulator_launch
tier4_system_launch
tier4_system_launch
tier4_system_launch
tier4_system_launch
tier4_system_launch
tier4_system_launch
tier4_vehicle_launch
tier4_vehicle_launch
tier4_vehicle_launch
tier4_vehicle_launch
tier4_vehicle_launch
tier4_vehicle_launch
aichallenge_scoring
autoware_launch
autoware_launch
autoware_launch
autoware_launch
initialpose_publisher
initialpose_publisher
pose_initializer_custom
pose_initializer_custom
autonomous_emergency_braking
control_performance_analysis
control_validator
external_cmd_selector
joy_controller
lane_departure_checker
mpc_lateral_controller
obstacle_collision_checker
operation_mode_transition_manager
pid_longitudinal_controller
predicted_path_checker
pure_pursuit
trajectory_follower_base
trajectory_follower_node
vehicle_cmd_gate
diagnostic_converter
kinematic_evaluator
localization_evaluator
planning_evaluator
ekf_localizer
ekf_localizer
geo_pose_projector
gyro_odometer
gyro_odometer
localization_error_monitor
localization_error_monitor
pose2twist
pose2twist
pose_initializer
pose_initializer
stop_filter
stop_filter
twist2accel
twist2accel
yabloc_common
yabloc_common
yabloc_image_processing
yabloc_image_processing
yabloc_monitor
yabloc_monitor
yabloc_particle_filter
yabloc_particle_filter
yabloc_pose_initializer
yabloc_pose_initializer
map_height_fitter
map_height_fitter
map_loader
map_loader
map_projection_loader
map_tf_generator
map_tf_generator
lanelet2_map_preprocessor
lanelet2_map_preprocessor
bytetrack
cluster_merger
compare_map_segmentation
crosswalk_traffic_light_estimator
detected_object_feature_remover
detected_object_validation
detection_by_tracker
elevation_map_loader
euclidean_cluster
front_vehicle_velocity_estimator
ground_segmentation
heatmap_visualizer
image_projection_based_fusion
lidar_apollo_segmentation_tvm
lidar_apollo_segmentation_tvm_nodes
lidar_centerpoint
lidar_centerpoint_tvm
map_based_prediction
multi_object_tracker
object_merger
object_range_splitter
object_velocity_splitter
occupancy_grid_map_outlier_filter
probabilistic_occupancy_grid_map
radar_crossing_objects_noise_filter
radar_fusion_to_detected_object
radar_object_clustering
radar_object_tracker
radar_tracks_msgs_converter
shape_estimation
simple_object_merger
tensorrt_classifier
tensorrt_yolo
tensorrt_yolox
tracking_object_merger
traffic_light_arbiter
traffic_light_fine_detector
traffic_light_map_based_detector
traffic_light_multi_camera_fusion
traffic_light_occlusion_predictor
traffic_light_ssd_fine_detector
traffic_light_visualization
behavior_path_avoidance_by_lane_change_module
behavior_path_avoidance_module
behavior_path_external_request_lane_change_module
behavior_path_goal_planner_module
behavior_path_lane_change_module
behavior_path_planner
behavior_path_planner_common
behavior_path_side_shift_module
behavior_path_start_planner_module
behavior_velocity_blind_spot_module
behavior_velocity_crosswalk_module
behavior_velocity_detection_area_module
behavior_velocity_intersection_module
behavior_velocity_no_drivable_lane_module
behavior_velocity_no_stopping_area_module
behavior_velocity_occlusion_spot_module
behavior_velocity_out_of_lane_module
behavior_velocity_planner
behavior_velocity_planner_common
behavior_velocity_run_out_module
behavior_velocity_speed_bump_module
behavior_velocity_stop_line_module
behavior_velocity_template_module
behavior_velocity_traffic_light_module
behavior_velocity_virtual_traffic_light_module
behavior_velocity_walkway_module
costmap_generator
external_velocity_limit_selector
freespace_planner
freespace_planning_algorithms
mission_planner
motion_velocity_smoother
objects_of_interest_marker_interface
obstacle_avoidance_planner
obstacle_cruise_planner
obstacle_stop_planner
obstacle_velocity_limiter
path_smoother
planning_debug_tools
planning_debug_tools
planning_test_utils
planning_topic_converter
planning_validator
route_handler
rtc_interface
rtc_replayer
bezier_sampler
frenet_planner
path_sampler
sampler_common
scenario_selector
static_centerline_optimizer
surround_obstacle_checker
gnss_poser
image_diagnostics
image_transport_decompressor
imu_corrector
livox_tag_filter
pointcloud_preprocessor
pointcloud_preprocessor
radar_tracks_noise_filter
tier4_pcl_extensions
tier4_pcl_extensions
vehicle_velocity_converter
vehicle_velocity_converter
autoware_auto_msgs_adapter
bluetooth_monitor
component_state_monitor
default_ad_api
ad_api_adaptors
automatic_pose_initializer
automatic_pose_initializer
diagnostic_graph_aggregator
dummy_diag_publisher
dummy_infrastructure
emergency_handler
mrm_comfortable_stop_operator
mrm_emergency_stop_operator
system_error_monitor
system_monitor
topic_state_monitor
velodyne_monitor
accel_brake_map_calibrator
external_cmd_converter
raw_vehicle_cmd_converter
steer_offset_estimator
vehicle_info_util
autoware_ad_api_specs
autoware_ad_api_specs
autoware_auto_common
autoware_auto_common
autoware_auto_geometry
autoware_auto_perception_rviz_plugin
autoware_auto_tf2
autoware_cmake
autoware_cmake
autoware_point_types
autoware_point_types
autoware_point_types
bag_time_manager_rviz_plugin
component_interface_specs
component_interface_specs
component_interface_tools
component_interface_utils
component_interface_utils
cuda_utils
fake_test_node
geography_utils
global_parameter_loader
goal_distance_calculator
grid_map_utils
interpolation
interpolation
kalman_filter
motion_utils
motion_utils
object_recognition_utils
osqp_interface
path_distance_calculator
polar_grid
qp_interface
rtc_manager_rviz_plugin
rtc_manager_rviz_plugin
signal_processing
signal_processing
tier4_adapi_rviz_plugin
tier4_adapi_rviz_plugin
tier4_api_utils
tier4_api_utils
tier4_automatic_goal_rviz_plugin
tier4_automatic_goal_rviz_plugin
tier4_autoware_utils
tier4_autoware_utils
tier4_calibration_rviz_plugin
tier4_calibration_rviz_plugin
tier4_camera_view_rviz_plugin
tier4_camera_view_rviz_plugin
tier4_control_rviz_plugin
tier4_control_rviz_plugin
tier4_datetime_rviz_plugin
tier4_datetime_rviz_plugin
tier4_debug_rviz_plugin
tier4_debug_rviz_plugin
tier4_debug_tools
tier4_debug_tools
tier4_localization_rviz_plugin
tier4_perception_rviz_plugin
tier4_perception_rviz_plugin
tier4_planning_rviz_plugin
tier4_screen_capture_rviz_plugin
tier4_screen_capture_rviz_plugin
tier4_simulated_clock_rviz_plugin
tier4_simulated_clock_rviz_plugin
tier4_state_rviz_plugin
tier4_state_rviz_plugin
tier4_system_rviz_plugin
tier4_system_rviz_plugin
tier4_target_object_type_rviz_plugin
tier4_target_object_type_rviz_plugin
tier4_traffic_light_rviz_plugin
tier4_traffic_light_rviz_plugin
tier4_vehicle_rviz_plugin
tier4_vehicle_rviz_plugin
time_utils
traffic_light_recognition_marker_publisher
traffic_light_utils
tvm_utility
dma_transfer
autoware_external_api_msgs
autoware_iv_external_api_adaptor
autoware_iv_internal_api_adaptor
awapi_awiv_adapter
dummy_perception_publisher
fault_injection
simple_planning_simulator
common_sensor_launch
common_sensor_launch
kunyi_sensor_kit_launch
node_v2x
data_preprocess_launch
lidar_centerpoint_collect
initial_pose_button_panel
autoware_gazebo_individual_params
autoware_gazebo_launch
autoware_webots_individual_params
autoware_webots_launch
carla_sensor_kit_launch
autoware_adapi_adaptors
autoware_adapi_specs
autoware_core_api
autoware_default_adapi
autoware_core
autoware_component_interface_specs
autoware_geography_utils
autoware_global_parameter_loader
autoware_interpolation
autoware_kalman_filter
autoware_motion_utils
autoware_node
autoware_object_recognition_utils
autoware_osqp_interface
autoware_qp_interface
autoware_signal_processing
autoware_trajectory
autoware_vehicle_info_utils
autoware_core_control
autoware_simple_pure_pursuit
autoware_core_localization
autoware_ekf_localizer
autoware_gyro_odometer
autoware_pose_initializer
autoware_stop_filter
autoware_twist2accel
autoware_core_map
autoware_lanelet2_map_visualizer
autoware_map_height_fitter
autoware_map_loader
autoware_map_projection_loader
autoware_core_perception
autoware_euclidean_cluster_object_detector
autoware_ground_filter
autoware_perception_objects_converter
autoware_core_planning
autoware_mission_planner
autoware_objects_of_interest_marker_interface
autoware_path_generator
autoware_planning_factor_interface
autoware_planning_topic_converter
autoware_route_handler
autoware_velocity_smoother
autoware_behavior_velocity_planner
autoware_behavior_velocity_planner_common
autoware_behavior_velocity_stop_line_module
autoware_motion_velocity_obstacle_stop_module
autoware_motion_velocity_planner
autoware_motion_velocity_planner_common
autoware_core_sensing
autoware_crop_box_filter
autoware_downsample_filters
autoware_gnss_poser
autoware_vehicle_velocity_converter
autoware_planning_test_manager
autoware_pyplot
autoware_test_utils
autoware_core_vehicle
awsim_labs_sensor_kit_launch
common_awsim_labs_sensor_launch
awsim_sensor_kit_launch
sample_sensor_kit_launch
single_lidar_common_launch
single_lidar_sensor_kit_launch
autoware_nova_carter_interface
mission_planner_rviz_plugin
tier4_calibration_msgs
tier4_logging_level_configure_rviz_plugin
tier4_string_viewer_rviz_plugin
control_debug_tools
vehicle_cmd_analyzer
control_data_collecting_tool
tier4_metrics_rviz_plugin
deviation_estimator
deviation_evaluator
autoware_lanelet2_map_utils
autoware_planning_data_analyzer
autoware_route_client
autoware_rtc_replayer
autoware_static_centerline_generator
rqt_diagnostic_graph_monitor
calibration_adapter
estimator_utils
parameter_estimator
pitch_checker
time_delay_estimator
autoware_boundary_departure_checker
autoware_component_interface_specs_universe
autoware_component_interface_tools
autoware_component_interface_utils
autoware_fake_test_node
autoware_goal_distance_calculator
autoware_grid_map_utils
autoware_path_distance_calculator
autoware_polar_grid
autoware_time_utils
autoware_traffic_light_recognition_marker_publisher
autoware_traffic_light_utils
autoware_universe_utils
autoware_autonomous_emergency_braking
autoware_collision_detector
autoware_control_command_gate
autoware_control_performance_analysis
autoware_control_validator
autoware_external_cmd_selector
autoware_joy_controller
autoware_lane_departure_checker
autoware_mpc_lateral_controller
autoware_obstacle_collision_checker
autoware_operation_mode_transition_manager
autoware_pid_longitudinal_controller
autoware_predicted_path_checker
autoware_pure_pursuit
autoware_smart_mpc_trajectory_follower
autoware_stop_mode_operator
autoware_trajectory_follower_base
autoware_trajectory_follower_node
autoware_vehicle_cmd_gate
autoware_control_evaluator
autoware_kinematic_evaluator
autoware_localization_evaluator
autoware_perception_online_evaluator
autoware_planning_evaluator
autoware_scenario_simulator_v2_adapter
autoware_diagnostic_graph_test_examples
autoware_geo_pose_projector
autoware_lidar_marker_localizer
autoware_localization_error_monitor
autoware_pose2twist
autoware_pose_estimator_arbiter
autoware_map_tf_generator
autoware_bevfusion
autoware_bytetrack
autoware_cluster_merger
autoware_compare_map_segmentation
autoware_crosswalk_traffic_light_estimator
autoware_detected_object_feature_remover
autoware_detected_object_validation
autoware_detection_by_tracker
autoware_elevation_map_loader
autoware_euclidean_cluster
autoware_ground_segmentation
autoware_image_projection_based_fusion
autoware_lidar_centerpoint
autoware_lidar_transfusion
autoware_map_based_prediction
autoware_multi_object_tracker
autoware_object_merger
autoware_object_range_splitter
autoware_object_sorter
autoware_object_velocity_splitter
autoware_occupancy_grid_map_outlier_filter
autoware_probabilistic_occupancy_grid_map
autoware_radar_fusion_to_detected_object
autoware_radar_object_tracker
autoware_radar_tracks_msgs_converter
autoware_shape_estimation
autoware_simpl_prediction
autoware_simple_object_merger
autoware_tensorrt_bevdet
autoware_tensorrt_classifier
autoware_tensorrt_plugins
autoware_tensorrt_yolox
autoware_tracking_object_merger
autoware_traffic_light_arbiter
autoware_traffic_light_fine_detector
autoware_traffic_light_map_based_detector
autoware_traffic_light_multi_camera_fusion
autoware_traffic_light_occlusion_predictor
autoware_traffic_light_selector
autoware_traffic_light_visualization
autoware_costmap_generator
autoware_diffusion_planner
autoware_external_velocity_limit_selector
autoware_freespace_planner
autoware_freespace_planning_algorithms
autoware_hazard_lights_selector
autoware_mission_planner_universe
autoware_path_optimizer
autoware_path_smoother
autoware_remaining_distance_time_calculator
autoware_rtc_interface
autoware_scenario_selector
autoware_surround_obstacle_checker
autoware_behavior_path_avoidance_by_lane_change_module
autoware_behavior_path_bidirectional_traffic_module
autoware_behavior_path_dynamic_obstacle_avoidance_module
autoware_behavior_path_external_request_lane_change_module
autoware_behavior_path_goal_planner_module
autoware_behavior_path_lane_change_module
autoware_behavior_path_planner
autoware_behavior_path_planner_common
autoware_behavior_path_sampling_planner_module
autoware_behavior_path_side_shift_module
autoware_behavior_path_start_planner_module
autoware_behavior_path_static_obstacle_avoidance_module
autoware_behavior_velocity_blind_spot_module
autoware_behavior_velocity_crosswalk_module
autoware_behavior_velocity_detection_area_module
autoware_behavior_velocity_intersection_module
autoware_behavior_velocity_no_drivable_lane_module
autoware_behavior_velocity_no_stopping_area_module
autoware_behavior_velocity_occlusion_spot_module
autoware_behavior_velocity_rtc_interface
autoware_behavior_velocity_run_out_module
autoware_behavior_velocity_speed_bump_module
autoware_behavior_velocity_template_module
autoware_behavior_velocity_traffic_light_module
autoware_behavior_velocity_virtual_traffic_light_module
autoware_behavior_velocity_walkway_module
autoware_motion_velocity_boundary_departure_prevention_module
autoware_motion_velocity_dynamic_obstacle_stop_module
autoware_motion_velocity_obstacle_cruise_module
autoware_motion_velocity_obstacle_slow_down_module
autoware_motion_velocity_obstacle_velocity_limiter_module
autoware_motion_velocity_out_of_lane_module
autoware_motion_velocity_road_user_stop_module
autoware_motion_velocity_run_out_module
autoware_planning_validator
autoware_planning_validator_intersection_collision_checker
autoware_planning_validator_latency_checker
autoware_planning_validator_rear_collision_checker
autoware_planning_validator_trajectory_checker
autoware_bezier_sampler
autoware_frenet_planner
autoware_path_sampler
autoware_sampler_common
autoware_cuda_utils
autoware_image_diagnostics
autoware_image_transport_decompressor
autoware_imu_corrector
autoware_pcl_extensions
autoware_pointcloud_preprocessor
autoware_radar_objects_adapter
autoware_radar_tracks_noise_filter
autoware_livox_tag_filter
autoware_dummy_perception_publisher
autoware_fault_injection
autoware_learning_based_vehicle_model
autoware_simple_planning_simulator
autoware_vehicle_door_simulator
tier4_dummy_object_rviz_plugin
autoware_bluetooth_monitor
autoware_command_mode_decider
autoware_command_mode_decider_plugins
autoware_command_mode_switcher
autoware_command_mode_switcher_plugins
autoware_command_mode_types
autoware_component_monitor
autoware_component_state_monitor
autoware_automatic_pose_initializer
autoware_default_adapi_universe
autoware_diagnostic_graph_aggregator
autoware_diagnostic_graph_utils
autoware_dummy_diag_publisher
autoware_dummy_infrastructure
autoware_hazard_status_converter
autoware_mrm_comfortable_stop_operator
autoware_mrm_emergency_stop_operator
autoware_mrm_handler
autoware_pipeline_latency_monitor
autoware_processing_time_checker
autoware_system_monitor
autoware_topic_relay_controller
autoware_topic_state_monitor
autoware_velodyne_monitor
reaction_analyzer
autoware_accel_brake_map_calibrator
autoware_external_cmd_converter
autoware_raw_vehicle_cmd_converter
autoware_steer_offset_estimator
autoware_bag_time_manager_rviz_plugin
tier4_planning_factor_rviz_plugin
point_cloud_accumulator
tier4_calibration_pcl_extensions
tier4_sensor_calibration_msgs
tunable_static_tf_broadcaster
driving_log_replayer
driving_log_replayer_analyzer
dynamic_object_removal
lightnet_trt
autoware_hmi
autoware_local_map_provider
autoware_local_mission_planner
autoware_local_mission_planner_common
autoware_mission_lane_converter
multi_lidar_calibration
open_planner
real_time_factor_control_rviz_plugin

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged autoware_lint_common at Robotics Stack Exchange

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

autoware_lint_common package from autoware_cmake repo

autoware_cmake autoware_lint_common

ROS Distro
humble

Package Summary

Tags No category tags.
Version 1.0.2
License Apache License 2.0
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Description CMake packages for working with Autoware
Checkout URI https://github.com/autowarefoundation/autoware_cmake.git
VCS Type git
VCS Version main
Last Updated 2025-07-05
Dev Status DEVELOPED
Released RELEASED
Tags No category tags.
Contributing Help Wanted (-)
Good First Issues (-)
Pull Requests to Review (-)

Package Description

The list of commonly used linters in Autoware

Additional Links

No additional links.

Maintainers

  • Ryohsuke Mitsudome
  • Esteve Fernandez

Authors

No additional authors.

autoware_lint_common

A custom version of ament_lint_common for Autoware.

Usage

Add dependencies of ament_lint_auto and autoware_lint_common to your package as below.

package.xml:

<test_depend>ament_lint_auto</test_depend>
<test_depend>autoware_lint_common</test_depend>

CMakeLists.txt:

if(BUILD_TESTING)
  find_package(ament_lint_auto REQUIRED)
  ament_lint_auto_find_test_dependencies()
endif()

For ROS 2 messages and services, you need to remove the ADD_LINTER_TESTS argument in the rosidl_generate_interfaces() function in the CMakelists.txt file.

Then, the following linters will run during colcon test.

Design

The original ament_lint_common contains other formatters/linters like ament_cmake_uncrustify, ament_cmake_cpplint and ament_cmake_flake8. However, we don’t include them because it’s more useful to run them with pre-commit as MoveIt does.

For example, the benefits are:

  • We can use any version of tools independent of ament’s version.
  • We can easily integrate into IDE.
  • We can easily check all the files in the repository without writing test_depend in each package.
  • We can run formatters/linters without building, which makes error detection faster.

Ideally, we think other linters should be moved to pre-commit as well, so we’ll try to support them in the future.

CHANGELOG

Changelog for package autoware_lint_common

1.0.2 (2025-04-08)

1.0.1 (2025-03-17)

  • fix(autoware_cmake): fix links to issues in CHANGELOG.rst files (#13)
  • Contributors: Esteve Fernandez

1.0.0 (2024-05-02)

  • Merge pull request #1 from youtalk/import-from-autoware-common feat: import from autoware_common
  • Merge branch 'autoware-lint-common' into import-from-autoware-common
  • move to autoware_lint_common
  • Contributors: Yutaka Kondo

Dependant Packages

Name Deps
autoware_adapi_adaptors
autoware_adapi_specs
autoware_core_api
autoware_default_adapi
autoware_core
autoware_component_interface_specs
autoware_geography_utils
autoware_global_parameter_loader
autoware_interpolation
autoware_kalman_filter
autoware_motion_utils
autoware_node
autoware_object_recognition_utils
autoware_osqp_interface
autoware_point_types
autoware_qp_interface
autoware_signal_processing
autoware_trajectory
autoware_vehicle_info_utils
autoware_core_control
autoware_simple_pure_pursuit
autoware_core_localization
autoware_ekf_localizer
autoware_gyro_odometer
autoware_pose_initializer
autoware_stop_filter
autoware_twist2accel
autoware_core_map
autoware_lanelet2_map_visualizer
autoware_map_height_fitter
autoware_map_loader
autoware_map_projection_loader
autoware_core_perception
autoware_euclidean_cluster_object_detector
autoware_ground_filter
autoware_perception_objects_converter
autoware_core_planning
autoware_mission_planner
autoware_objects_of_interest_marker_interface
autoware_path_generator
autoware_planning_factor_interface
autoware_planning_topic_converter
autoware_route_handler
autoware_velocity_smoother
autoware_behavior_velocity_planner
autoware_behavior_velocity_planner_common
autoware_behavior_velocity_stop_line_module
autoware_motion_velocity_obstacle_stop_module
autoware_motion_velocity_planner
autoware_motion_velocity_planner_common
autoware_core_sensing
autoware_crop_box_filter
autoware_downsample_filters
autoware_gnss_poser
autoware_vehicle_velocity_converter
autoware_planning_test_manager
autoware_pyplot
autoware_test_utils
autoware_core_vehicle
autoware_cmake
autoware_utils
autoware_utils_debug
autoware_utils_diagnostics
autoware_utils_geometry
autoware_utils_logging
autoware_utils_math
autoware_utils_pcl
autoware_utils_rclcpp
autoware_utils_system
autoware_utils_tf
autoware_utils_uuid
autoware_utils_visualization

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged autoware_lint_common at Robotics Stack Exchange

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

autoware_lint_common package from autoware_cmake repo

autoware_cmake autoware_lint_common

ROS Distro
humble

Package Summary

Tags No category tags.
Version 1.0.2
License Apache License 2.0
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Description CMake packages for working with Autoware
Checkout URI https://github.com/autowarefoundation/autoware_cmake.git
VCS Type git
VCS Version main
Last Updated 2025-07-05
Dev Status DEVELOPED
Released RELEASED
Tags No category tags.
Contributing Help Wanted (-)
Good First Issues (-)
Pull Requests to Review (-)

Package Description

The list of commonly used linters in Autoware

Additional Links

No additional links.

Maintainers

  • Ryohsuke Mitsudome
  • Esteve Fernandez

Authors

No additional authors.

autoware_lint_common

A custom version of ament_lint_common for Autoware.

Usage

Add dependencies of ament_lint_auto and autoware_lint_common to your package as below.

package.xml:

<test_depend>ament_lint_auto</test_depend>
<test_depend>autoware_lint_common</test_depend>

CMakeLists.txt:

if(BUILD_TESTING)
  find_package(ament_lint_auto REQUIRED)
  ament_lint_auto_find_test_dependencies()
endif()

For ROS 2 messages and services, you need to remove the ADD_LINTER_TESTS argument in the rosidl_generate_interfaces() function in the CMakelists.txt file.

Then, the following linters will run during colcon test.

Design

The original ament_lint_common contains other formatters/linters like ament_cmake_uncrustify, ament_cmake_cpplint and ament_cmake_flake8. However, we don’t include them because it’s more useful to run them with pre-commit as MoveIt does.

For example, the benefits are:

  • We can use any version of tools independent of ament’s version.
  • We can easily integrate into IDE.
  • We can easily check all the files in the repository without writing test_depend in each package.
  • We can run formatters/linters without building, which makes error detection faster.

Ideally, we think other linters should be moved to pre-commit as well, so we’ll try to support them in the future.

CHANGELOG

Changelog for package autoware_lint_common

1.0.2 (2025-04-08)

1.0.1 (2025-03-17)

  • fix(autoware_cmake): fix links to issues in CHANGELOG.rst files (#13)
  • Contributors: Esteve Fernandez

1.0.0 (2024-05-02)

  • Merge pull request #1 from youtalk/import-from-autoware-common feat: import from autoware_common
  • Merge branch 'autoware-lint-common' into import-from-autoware-common
  • move to autoware_lint_common
  • Contributors: Yutaka Kondo

Dependant Packages

Name Deps
autoware_adapi_adaptors
autoware_adapi_specs
autoware_core_api
autoware_default_adapi
autoware_core
autoware_component_interface_specs
autoware_geography_utils
autoware_global_parameter_loader
autoware_interpolation
autoware_kalman_filter
autoware_motion_utils
autoware_node
autoware_object_recognition_utils
autoware_osqp_interface
autoware_point_types
autoware_qp_interface
autoware_signal_processing
autoware_trajectory
autoware_vehicle_info_utils
autoware_core_control
autoware_simple_pure_pursuit
autoware_core_localization
autoware_ekf_localizer
autoware_gyro_odometer
autoware_pose_initializer
autoware_stop_filter
autoware_twist2accel
autoware_core_map
autoware_lanelet2_map_visualizer
autoware_map_height_fitter
autoware_map_loader
autoware_map_projection_loader
autoware_core_perception
autoware_euclidean_cluster_object_detector
autoware_ground_filter
autoware_perception_objects_converter
autoware_core_planning
autoware_mission_planner
autoware_objects_of_interest_marker_interface
autoware_path_generator
autoware_planning_factor_interface
autoware_planning_topic_converter
autoware_route_handler
autoware_velocity_smoother
autoware_behavior_velocity_planner
autoware_behavior_velocity_planner_common
autoware_behavior_velocity_stop_line_module
autoware_motion_velocity_obstacle_stop_module
autoware_motion_velocity_planner
autoware_motion_velocity_planner_common
autoware_core_sensing
autoware_crop_box_filter
autoware_downsample_filters
autoware_gnss_poser
autoware_vehicle_velocity_converter
autoware_planning_test_manager
autoware_pyplot
autoware_test_utils
autoware_core_vehicle
autoware_cmake
autoware_utils
autoware_utils_debug
autoware_utils_diagnostics
autoware_utils_geometry
autoware_utils_logging
autoware_utils_math
autoware_utils_pcl
autoware_utils_rclcpp
autoware_utils_system
autoware_utils_tf
autoware_utils_uuid
autoware_utils_visualization

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged autoware_lint_common at Robotics Stack Exchange

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

autoware_lint_common package from autoware_cmake repo

autoware_cmake autoware_lint_common

ROS Distro
humble

Package Summary

Tags No category tags.
Version 1.0.2
License Apache License 2.0
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Description CMake packages for working with Autoware
Checkout URI https://github.com/autowarefoundation/autoware_cmake.git
VCS Type git
VCS Version main
Last Updated 2025-07-05
Dev Status DEVELOPED
Released RELEASED
Tags No category tags.
Contributing Help Wanted (-)
Good First Issues (-)
Pull Requests to Review (-)

Package Description

The list of commonly used linters in Autoware

Additional Links

No additional links.

Maintainers

  • Ryohsuke Mitsudome
  • Esteve Fernandez

Authors

No additional authors.

autoware_lint_common

A custom version of ament_lint_common for Autoware.

Usage

Add dependencies of ament_lint_auto and autoware_lint_common to your package as below.

package.xml:

<test_depend>ament_lint_auto</test_depend>
<test_depend>autoware_lint_common</test_depend>

CMakeLists.txt:

if(BUILD_TESTING)
  find_package(ament_lint_auto REQUIRED)
  ament_lint_auto_find_test_dependencies()
endif()

For ROS 2 messages and services, you need to remove the ADD_LINTER_TESTS argument in the rosidl_generate_interfaces() function in the CMakelists.txt file.

Then, the following linters will run during colcon test.

Design

The original ament_lint_common contains other formatters/linters like ament_cmake_uncrustify, ament_cmake_cpplint and ament_cmake_flake8. However, we don’t include them because it’s more useful to run them with pre-commit as MoveIt does.

For example, the benefits are:

  • We can use any version of tools independent of ament’s version.
  • We can easily integrate into IDE.
  • We can easily check all the files in the repository without writing test_depend in each package.
  • We can run formatters/linters without building, which makes error detection faster.

Ideally, we think other linters should be moved to pre-commit as well, so we’ll try to support them in the future.

CHANGELOG

Changelog for package autoware_lint_common

1.0.2 (2025-04-08)

1.0.1 (2025-03-17)

  • fix(autoware_cmake): fix links to issues in CHANGELOG.rst files (#13)
  • Contributors: Esteve Fernandez

1.0.0 (2024-05-02)

  • Merge pull request #1 from youtalk/import-from-autoware-common feat: import from autoware_common
  • Merge branch 'autoware-lint-common' into import-from-autoware-common
  • move to autoware_lint_common
  • Contributors: Yutaka Kondo

Dependant Packages

Name Deps
autoware_adapi_adaptors
autoware_adapi_specs
autoware_core_api
autoware_default_adapi
autoware_core
autoware_component_interface_specs
autoware_geography_utils
autoware_global_parameter_loader
autoware_interpolation
autoware_kalman_filter
autoware_motion_utils
autoware_node
autoware_object_recognition_utils
autoware_osqp_interface
autoware_point_types
autoware_qp_interface
autoware_signal_processing
autoware_trajectory
autoware_vehicle_info_utils
autoware_core_control
autoware_simple_pure_pursuit
autoware_core_localization
autoware_ekf_localizer
autoware_gyro_odometer
autoware_pose_initializer
autoware_stop_filter
autoware_twist2accel
autoware_core_map
autoware_lanelet2_map_visualizer
autoware_map_height_fitter
autoware_map_loader
autoware_map_projection_loader
autoware_core_perception
autoware_euclidean_cluster_object_detector
autoware_ground_filter
autoware_perception_objects_converter
autoware_core_planning
autoware_mission_planner
autoware_objects_of_interest_marker_interface
autoware_path_generator
autoware_planning_factor_interface
autoware_planning_topic_converter
autoware_route_handler
autoware_velocity_smoother
autoware_behavior_velocity_planner
autoware_behavior_velocity_planner_common
autoware_behavior_velocity_stop_line_module
autoware_motion_velocity_obstacle_stop_module
autoware_motion_velocity_planner
autoware_motion_velocity_planner_common
autoware_core_sensing
autoware_crop_box_filter
autoware_downsample_filters
autoware_gnss_poser
autoware_vehicle_velocity_converter
autoware_planning_test_manager
autoware_pyplot
autoware_test_utils
autoware_core_vehicle
autoware_cmake
autoware_utils
autoware_utils_debug
autoware_utils_diagnostics
autoware_utils_geometry
autoware_utils_logging
autoware_utils_math
autoware_utils_pcl
autoware_utils_rclcpp
autoware_utils_system
autoware_utils_tf
autoware_utils_uuid
autoware_utils_visualization

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged autoware_lint_common at Robotics Stack Exchange

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

autoware_lint_common package from autoware_cmake repo

autoware_cmake autoware_lint_common

ROS Distro
humble

Package Summary

Tags No category tags.
Version 1.0.2
License Apache License 2.0
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Description CMake packages for working with Autoware
Checkout URI https://github.com/autowarefoundation/autoware_cmake.git
VCS Type git
VCS Version main
Last Updated 2025-07-05
Dev Status DEVELOPED
Released RELEASED
Tags No category tags.
Contributing Help Wanted (-)
Good First Issues (-)
Pull Requests to Review (-)

Package Description

The list of commonly used linters in Autoware

Additional Links

No additional links.

Maintainers

  • Ryohsuke Mitsudome
  • Esteve Fernandez

Authors

No additional authors.

autoware_lint_common

A custom version of ament_lint_common for Autoware.

Usage

Add dependencies of ament_lint_auto and autoware_lint_common to your package as below.

package.xml:

<test_depend>ament_lint_auto</test_depend>
<test_depend>autoware_lint_common</test_depend>

CMakeLists.txt:

if(BUILD_TESTING)
  find_package(ament_lint_auto REQUIRED)
  ament_lint_auto_find_test_dependencies()
endif()

For ROS 2 messages and services, you need to remove the ADD_LINTER_TESTS argument in the rosidl_generate_interfaces() function in the CMakelists.txt file.

Then, the following linters will run during colcon test.

Design

The original ament_lint_common contains other formatters/linters like ament_cmake_uncrustify, ament_cmake_cpplint and ament_cmake_flake8. However, we don’t include them because it’s more useful to run them with pre-commit as MoveIt does.

For example, the benefits are:

  • We can use any version of tools independent of ament’s version.
  • We can easily integrate into IDE.
  • We can easily check all the files in the repository without writing test_depend in each package.
  • We can run formatters/linters without building, which makes error detection faster.

Ideally, we think other linters should be moved to pre-commit as well, so we’ll try to support them in the future.

CHANGELOG

Changelog for package autoware_lint_common

1.0.2 (2025-04-08)

1.0.1 (2025-03-17)

  • fix(autoware_cmake): fix links to issues in CHANGELOG.rst files (#13)
  • Contributors: Esteve Fernandez

1.0.0 (2024-05-02)

  • Merge pull request #1 from youtalk/import-from-autoware-common feat: import from autoware_common
  • Merge branch 'autoware-lint-common' into import-from-autoware-common
  • move to autoware_lint_common
  • Contributors: Yutaka Kondo

Dependant Packages

Name Deps
autoware_adapi_adaptors
autoware_adapi_specs
autoware_core_api
autoware_default_adapi
autoware_core
autoware_component_interface_specs
autoware_geography_utils
autoware_global_parameter_loader
autoware_interpolation
autoware_kalman_filter
autoware_motion_utils
autoware_node
autoware_object_recognition_utils
autoware_osqp_interface
autoware_point_types
autoware_qp_interface
autoware_signal_processing
autoware_trajectory
autoware_vehicle_info_utils
autoware_core_control
autoware_simple_pure_pursuit
autoware_core_localization
autoware_ekf_localizer
autoware_gyro_odometer
autoware_pose_initializer
autoware_stop_filter
autoware_twist2accel
autoware_core_map
autoware_lanelet2_map_visualizer
autoware_map_height_fitter
autoware_map_loader
autoware_map_projection_loader
autoware_core_perception
autoware_euclidean_cluster_object_detector
autoware_ground_filter
autoware_perception_objects_converter
autoware_core_planning
autoware_mission_planner
autoware_objects_of_interest_marker_interface
autoware_path_generator
autoware_planning_factor_interface
autoware_planning_topic_converter
autoware_route_handler
autoware_velocity_smoother
autoware_behavior_velocity_planner
autoware_behavior_velocity_planner_common
autoware_behavior_velocity_stop_line_module
autoware_motion_velocity_obstacle_stop_module
autoware_motion_velocity_planner
autoware_motion_velocity_planner_common
autoware_core_sensing
autoware_crop_box_filter
autoware_downsample_filters
autoware_gnss_poser
autoware_vehicle_velocity_converter
autoware_planning_test_manager
autoware_pyplot
autoware_test_utils
autoware_core_vehicle
autoware_cmake
autoware_utils
autoware_utils_debug
autoware_utils_diagnostics
autoware_utils_geometry
autoware_utils_logging
autoware_utils_math
autoware_utils_pcl
autoware_utils_rclcpp
autoware_utils_system
autoware_utils_tf
autoware_utils_uuid
autoware_utils_visualization

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged autoware_lint_common at Robotics Stack Exchange