Package Summary
Tags | No category tags. |
Version | 0.47.0 |
License | Apache License 2.0 |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Description | |
Checkout URI | https://github.com/autowarefoundation/autoware_universe.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2025-08-16 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | planner ros calibration self-driving-car autonomous-driving autonomous-vehicles ros2 3d-map autoware |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- Kosuke Takeuchi
- Takamasa Horibe
- Takayuki Murooka
Authors
costmap_generator
costmap_generator_node
This node reads PointCloud
and/or DynamicObjectArray
and creates an OccupancyGrid
and GridMap
. VectorMap(Lanelet2)
is optional.
Input topics
Name | Type | Description |
---|---|---|
~input/objects |
autoware_perception_msgs::PredictedObjects | predicted objects, for obstacles areas |
~input/points_no_ground |
sensor_msgs::PointCloud2 | ground-removed points, for obstacle areas which can’t be detected as objects |
~input/vector_map |
autoware_map_msgs::msg::LaneletMapBin | vector map, for drivable areas |
~input/scenario |
tier4_planning_msgs::Scenario | scenarios to be activated, for node activation |
Output topics
Name | Type | Description |
---|---|---|
~output/grid_map |
grid_map_msgs::GridMap | costmap as GridMap, values are from 0.0 to 1.0 |
~output/occupancy_grid |
nav_msgs::OccupancyGrid | costmap as OccupancyGrid, values are from 0 to 100 |
Output TFs
None
How to launch
-
Execute the command
source install/setup.bash
to setup the environment -
Run
ros2 launch costmap_generator costmap_generator.launch.xml
to launch the node
Parameters
Name | Type | Description |
---|---|---|
update_rate |
double | timer’s update rate |
activate_by_scenario |
bool | if true, activate by scenario = parking. Otherwise, activate if vehicle is inside parking lot. |
use_objects |
bool | whether using ~input/objects or not |
use_points |
bool | whether using ~input/points_no_ground or not |
use_wayarea |
bool | whether using wayarea from ~input/vector_map or not |
use_parkinglot |
bool | whether using parkinglot from ~input/vector_map or not |
costmap_frame |
string | created costmap’s coordinate |
vehicle_frame |
string | vehicle’s coordinate |
map_frame |
string | map’s coordinate |
grid_min_value |
double | minimum cost for gridmap |
grid_max_value |
double | maximum cost for gridmap |
grid_resolution |
double | resolution for gridmap |
grid_length_x |
int | size of gridmap for x direction |
grid_length_y |
int | size of gridmap for y direction |
grid_position_x |
int | offset from coordinate in x direction |
grid_position_y |
int | offset from coordinate in y direction |
maximum_lidar_height_thres |
double | maximum height threshold for pointcloud data (relative to the vehicle_frame) |
minimum_lidar_height_thres |
double | minimum height threshold for pointcloud data (relative to the vehicle_frame) |
expand_rectangle_size |
double | expand object’s rectangle with this value |
size_of_expansion_kernel |
int | kernel size for blurring effect on object’s costmap |
Flowchart
@startuml
title onTimer
start
if (scenario is active?) then (yes)
else (no)
stop
endif
:get current pose;
:set the center of costmap to current pose;
if (use wayarea or use parkinglot?) then (yes)
:generate map primitives costmap;
endif
if (use objects?) then (yes)
:generate objects costmap;
endif
if (use points?) then (yes)
:generate points costmap;
endif
:combine costmap;
:publish costmap;
stop
@enduml
Changelog for package autoware_costmap_generator
0.47.0 (2025-08-11)
0.46.0 (2025-06-20)
0.45.0 (2025-05-22)
0.44.2 (2025-06-10)
0.44.1 (2025-05-01)
0.44.0 (2025-04-18)
0.43.0 (2025-03-21)
- Merge remote-tracking branch 'origin/main' into chore/bump-version-0.43
- chore: rename from [autoware.universe]{.title-ref} to [autoware_universe]{.title-ref} (#10306)
- Contributors: Hayato Mizushima, Yutaka Kondo
0.42.0 (2025-03-03)
- Merge remote-tracking branch 'origin/main' into tmp/bot/bump_version_base
- feat(autoware_utils): replace autoware_universe_utils with autoware_utils (#10191)
- feat!: replace scenario msg from tier4_planning_msgs to autoware_internal_planning_msgs (#10180)
- Contributors: Fumiya Watanabe, Ryohsuke Mitsudome, 心刚
0.41.2 (2025-02-19)
- chore: bump version to 0.41.1 (#10088)
- Contributors: Ryohsuke Mitsudome
0.41.1 (2025-02-10)
0.41.0 (2025-01-29)
- Merge remote-tracking branch 'origin/main' into tmp/bot/bump_version_base
- feat(autoware_costmap_generator): tier4_debug_msgs changed to autoware_internal-debug_msgs in autoware_costmap_generator (#9901) feat: tier4_debug_msgs changed to autoware_internal-debug_msgs in files planning/autoware_costmap_generator
- fix(autoware_costmap_generator): fix bugprone-branch-clone (#9669) fix: bugprone-error
- chore(autoware_costmap_generator): suppress Could not find a connection between 'map' and 'base_link' (#9655)
- Contributors: Fumiya Watanabe, Vishal Chauhan, Yukinari Hisaki, kobayu858
0.40.0 (2024-12-12)
-
Merge branch 'main' into release-0.40.0
-
Revert "chore(package.xml): bump version to 0.39.0 (#9587)" This reverts commit c9f0f2688c57b0f657f5c1f28f036a970682e7f5.
-
fix: fix ticket links in CHANGELOG.rst (#9588)
-
chore(package.xml): bump version to 0.39.0 (#9587)
- chore(package.xml): bump version to 0.39.0
- fix: fix ticket links in CHANGELOG.rst
* fix: remove unnecessary diff ---------Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
-
fix: fix ticket links in CHANGELOG.rst (#9588)
-
feat(costmap_generator, scenario_selector): improve freespace planning stability (#9579)
- discretize updating grid center position by size of grid resolution
- modify logic for switching to lane driving in scenario selector
* fix spelling ---------
-
fix(cpplint): include what you use - planning (#9570)
-
refactor: correct spelling (#9528)
File truncated at 100 lines see the full file
Package Dependencies
System Dependencies
Name |
---|
libpcl-all-dev |
Dependant Packages
Name | Deps |
---|---|
tier4_planning_launch |
Launch files
- launch/costmap_generator.launch.xml
-
- input_objects [default: ~/input/objects]
- input_points_no_ground [default: ~/input/points_no_ground]
- input_lanelet_map [default: ~/input/vector_map]
- input_scenario [default: ~/input/scenario]
- output_grid_map [default: ~/output/grid_map]
- output_occupancy_grid [default: ~/output/occupancy_grid]
- costmap_generator_param_file [default: $(find-pkg-share autoware_costmap_generator)/config/costmap_generator.param.yaml]
Messages
Services
Plugins
Recent questions tagged autoware_costmap_generator at Robotics Stack Exchange
Package Summary
Tags | No category tags. |
Version | 0.47.0 |
License | Apache License 2.0 |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Description | |
Checkout URI | https://github.com/autowarefoundation/autoware_universe.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2025-08-16 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | planner ros calibration self-driving-car autonomous-driving autonomous-vehicles ros2 3d-map autoware |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- Kosuke Takeuchi
- Takamasa Horibe
- Takayuki Murooka
Authors
costmap_generator
costmap_generator_node
This node reads PointCloud
and/or DynamicObjectArray
and creates an OccupancyGrid
and GridMap
. VectorMap(Lanelet2)
is optional.
Input topics
Name | Type | Description |
---|---|---|
~input/objects |
autoware_perception_msgs::PredictedObjects | predicted objects, for obstacles areas |
~input/points_no_ground |
sensor_msgs::PointCloud2 | ground-removed points, for obstacle areas which can’t be detected as objects |
~input/vector_map |
autoware_map_msgs::msg::LaneletMapBin | vector map, for drivable areas |
~input/scenario |
tier4_planning_msgs::Scenario | scenarios to be activated, for node activation |
Output topics
Name | Type | Description |
---|---|---|
~output/grid_map |
grid_map_msgs::GridMap | costmap as GridMap, values are from 0.0 to 1.0 |
~output/occupancy_grid |
nav_msgs::OccupancyGrid | costmap as OccupancyGrid, values are from 0 to 100 |
Output TFs
None
How to launch
-
Execute the command
source install/setup.bash
to setup the environment -
Run
ros2 launch costmap_generator costmap_generator.launch.xml
to launch the node
Parameters
Name | Type | Description |
---|---|---|
update_rate |
double | timer’s update rate |
activate_by_scenario |
bool | if true, activate by scenario = parking. Otherwise, activate if vehicle is inside parking lot. |
use_objects |
bool | whether using ~input/objects or not |
use_points |
bool | whether using ~input/points_no_ground or not |
use_wayarea |
bool | whether using wayarea from ~input/vector_map or not |
use_parkinglot |
bool | whether using parkinglot from ~input/vector_map or not |
costmap_frame |
string | created costmap’s coordinate |
vehicle_frame |
string | vehicle’s coordinate |
map_frame |
string | map’s coordinate |
grid_min_value |
double | minimum cost for gridmap |
grid_max_value |
double | maximum cost for gridmap |
grid_resolution |
double | resolution for gridmap |
grid_length_x |
int | size of gridmap for x direction |
grid_length_y |
int | size of gridmap for y direction |
grid_position_x |
int | offset from coordinate in x direction |
grid_position_y |
int | offset from coordinate in y direction |
maximum_lidar_height_thres |
double | maximum height threshold for pointcloud data (relative to the vehicle_frame) |
minimum_lidar_height_thres |
double | minimum height threshold for pointcloud data (relative to the vehicle_frame) |
expand_rectangle_size |
double | expand object’s rectangle with this value |
size_of_expansion_kernel |
int | kernel size for blurring effect on object’s costmap |
Flowchart
@startuml
title onTimer
start
if (scenario is active?) then (yes)
else (no)
stop
endif
:get current pose;
:set the center of costmap to current pose;
if (use wayarea or use parkinglot?) then (yes)
:generate map primitives costmap;
endif
if (use objects?) then (yes)
:generate objects costmap;
endif
if (use points?) then (yes)
:generate points costmap;
endif
:combine costmap;
:publish costmap;
stop
@enduml
Changelog for package autoware_costmap_generator
0.47.0 (2025-08-11)
0.46.0 (2025-06-20)
0.45.0 (2025-05-22)
0.44.2 (2025-06-10)
0.44.1 (2025-05-01)
0.44.0 (2025-04-18)
0.43.0 (2025-03-21)
- Merge remote-tracking branch 'origin/main' into chore/bump-version-0.43
- chore: rename from [autoware.universe]{.title-ref} to [autoware_universe]{.title-ref} (#10306)
- Contributors: Hayato Mizushima, Yutaka Kondo
0.42.0 (2025-03-03)
- Merge remote-tracking branch 'origin/main' into tmp/bot/bump_version_base
- feat(autoware_utils): replace autoware_universe_utils with autoware_utils (#10191)
- feat!: replace scenario msg from tier4_planning_msgs to autoware_internal_planning_msgs (#10180)
- Contributors: Fumiya Watanabe, Ryohsuke Mitsudome, 心刚
0.41.2 (2025-02-19)
- chore: bump version to 0.41.1 (#10088)
- Contributors: Ryohsuke Mitsudome
0.41.1 (2025-02-10)
0.41.0 (2025-01-29)
- Merge remote-tracking branch 'origin/main' into tmp/bot/bump_version_base
- feat(autoware_costmap_generator): tier4_debug_msgs changed to autoware_internal-debug_msgs in autoware_costmap_generator (#9901) feat: tier4_debug_msgs changed to autoware_internal-debug_msgs in files planning/autoware_costmap_generator
- fix(autoware_costmap_generator): fix bugprone-branch-clone (#9669) fix: bugprone-error
- chore(autoware_costmap_generator): suppress Could not find a connection between 'map' and 'base_link' (#9655)
- Contributors: Fumiya Watanabe, Vishal Chauhan, Yukinari Hisaki, kobayu858
0.40.0 (2024-12-12)
-
Merge branch 'main' into release-0.40.0
-
Revert "chore(package.xml): bump version to 0.39.0 (#9587)" This reverts commit c9f0f2688c57b0f657f5c1f28f036a970682e7f5.
-
fix: fix ticket links in CHANGELOG.rst (#9588)
-
chore(package.xml): bump version to 0.39.0 (#9587)
- chore(package.xml): bump version to 0.39.0
- fix: fix ticket links in CHANGELOG.rst
* fix: remove unnecessary diff ---------Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
-
fix: fix ticket links in CHANGELOG.rst (#9588)
-
feat(costmap_generator, scenario_selector): improve freespace planning stability (#9579)
- discretize updating grid center position by size of grid resolution
- modify logic for switching to lane driving in scenario selector
* fix spelling ---------
-
fix(cpplint): include what you use - planning (#9570)
-
refactor: correct spelling (#9528)
File truncated at 100 lines see the full file
Package Dependencies
System Dependencies
Name |
---|
libpcl-all-dev |
Dependant Packages
Name | Deps |
---|---|
tier4_planning_launch |
Launch files
- launch/costmap_generator.launch.xml
-
- input_objects [default: ~/input/objects]
- input_points_no_ground [default: ~/input/points_no_ground]
- input_lanelet_map [default: ~/input/vector_map]
- input_scenario [default: ~/input/scenario]
- output_grid_map [default: ~/output/grid_map]
- output_occupancy_grid [default: ~/output/occupancy_grid]
- costmap_generator_param_file [default: $(find-pkg-share autoware_costmap_generator)/config/costmap_generator.param.yaml]
Messages
Services
Plugins
Recent questions tagged autoware_costmap_generator at Robotics Stack Exchange
Package Summary
Tags | No category tags. |
Version | 0.47.0 |
License | Apache License 2.0 |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Description | |
Checkout URI | https://github.com/autowarefoundation/autoware_universe.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2025-08-16 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | planner ros calibration self-driving-car autonomous-driving autonomous-vehicles ros2 3d-map autoware |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- Kosuke Takeuchi
- Takamasa Horibe
- Takayuki Murooka
Authors
costmap_generator
costmap_generator_node
This node reads PointCloud
and/or DynamicObjectArray
and creates an OccupancyGrid
and GridMap
. VectorMap(Lanelet2)
is optional.
Input topics
Name | Type | Description |
---|---|---|
~input/objects |
autoware_perception_msgs::PredictedObjects | predicted objects, for obstacles areas |
~input/points_no_ground |
sensor_msgs::PointCloud2 | ground-removed points, for obstacle areas which can’t be detected as objects |
~input/vector_map |
autoware_map_msgs::msg::LaneletMapBin | vector map, for drivable areas |
~input/scenario |
tier4_planning_msgs::Scenario | scenarios to be activated, for node activation |
Output topics
Name | Type | Description |
---|---|---|
~output/grid_map |
grid_map_msgs::GridMap | costmap as GridMap, values are from 0.0 to 1.0 |
~output/occupancy_grid |
nav_msgs::OccupancyGrid | costmap as OccupancyGrid, values are from 0 to 100 |
Output TFs
None
How to launch
-
Execute the command
source install/setup.bash
to setup the environment -
Run
ros2 launch costmap_generator costmap_generator.launch.xml
to launch the node
Parameters
Name | Type | Description |
---|---|---|
update_rate |
double | timer’s update rate |
activate_by_scenario |
bool | if true, activate by scenario = parking. Otherwise, activate if vehicle is inside parking lot. |
use_objects |
bool | whether using ~input/objects or not |
use_points |
bool | whether using ~input/points_no_ground or not |
use_wayarea |
bool | whether using wayarea from ~input/vector_map or not |
use_parkinglot |
bool | whether using parkinglot from ~input/vector_map or not |
costmap_frame |
string | created costmap’s coordinate |
vehicle_frame |
string | vehicle’s coordinate |
map_frame |
string | map’s coordinate |
grid_min_value |
double | minimum cost for gridmap |
grid_max_value |
double | maximum cost for gridmap |
grid_resolution |
double | resolution for gridmap |
grid_length_x |
int | size of gridmap for x direction |
grid_length_y |
int | size of gridmap for y direction |
grid_position_x |
int | offset from coordinate in x direction |
grid_position_y |
int | offset from coordinate in y direction |
maximum_lidar_height_thres |
double | maximum height threshold for pointcloud data (relative to the vehicle_frame) |
minimum_lidar_height_thres |
double | minimum height threshold for pointcloud data (relative to the vehicle_frame) |
expand_rectangle_size |
double | expand object’s rectangle with this value |
size_of_expansion_kernel |
int | kernel size for blurring effect on object’s costmap |
Flowchart
@startuml
title onTimer
start
if (scenario is active?) then (yes)
else (no)
stop
endif
:get current pose;
:set the center of costmap to current pose;
if (use wayarea or use parkinglot?) then (yes)
:generate map primitives costmap;
endif
if (use objects?) then (yes)
:generate objects costmap;
endif
if (use points?) then (yes)
:generate points costmap;
endif
:combine costmap;
:publish costmap;
stop
@enduml
Changelog for package autoware_costmap_generator
0.47.0 (2025-08-11)
0.46.0 (2025-06-20)
0.45.0 (2025-05-22)
0.44.2 (2025-06-10)
0.44.1 (2025-05-01)
0.44.0 (2025-04-18)
0.43.0 (2025-03-21)
- Merge remote-tracking branch 'origin/main' into chore/bump-version-0.43
- chore: rename from [autoware.universe]{.title-ref} to [autoware_universe]{.title-ref} (#10306)
- Contributors: Hayato Mizushima, Yutaka Kondo
0.42.0 (2025-03-03)
- Merge remote-tracking branch 'origin/main' into tmp/bot/bump_version_base
- feat(autoware_utils): replace autoware_universe_utils with autoware_utils (#10191)
- feat!: replace scenario msg from tier4_planning_msgs to autoware_internal_planning_msgs (#10180)
- Contributors: Fumiya Watanabe, Ryohsuke Mitsudome, 心刚
0.41.2 (2025-02-19)
- chore: bump version to 0.41.1 (#10088)
- Contributors: Ryohsuke Mitsudome
0.41.1 (2025-02-10)
0.41.0 (2025-01-29)
- Merge remote-tracking branch 'origin/main' into tmp/bot/bump_version_base
- feat(autoware_costmap_generator): tier4_debug_msgs changed to autoware_internal-debug_msgs in autoware_costmap_generator (#9901) feat: tier4_debug_msgs changed to autoware_internal-debug_msgs in files planning/autoware_costmap_generator
- fix(autoware_costmap_generator): fix bugprone-branch-clone (#9669) fix: bugprone-error
- chore(autoware_costmap_generator): suppress Could not find a connection between 'map' and 'base_link' (#9655)
- Contributors: Fumiya Watanabe, Vishal Chauhan, Yukinari Hisaki, kobayu858
0.40.0 (2024-12-12)
-
Merge branch 'main' into release-0.40.0
-
Revert "chore(package.xml): bump version to 0.39.0 (#9587)" This reverts commit c9f0f2688c57b0f657f5c1f28f036a970682e7f5.
-
fix: fix ticket links in CHANGELOG.rst (#9588)
-
chore(package.xml): bump version to 0.39.0 (#9587)
- chore(package.xml): bump version to 0.39.0
- fix: fix ticket links in CHANGELOG.rst
* fix: remove unnecessary diff ---------Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
-
fix: fix ticket links in CHANGELOG.rst (#9588)
-
feat(costmap_generator, scenario_selector): improve freespace planning stability (#9579)
- discretize updating grid center position by size of grid resolution
- modify logic for switching to lane driving in scenario selector
* fix spelling ---------
-
fix(cpplint): include what you use - planning (#9570)
-
refactor: correct spelling (#9528)
File truncated at 100 lines see the full file
Package Dependencies
System Dependencies
Name |
---|
libpcl-all-dev |
Dependant Packages
Name | Deps |
---|---|
tier4_planning_launch |
Launch files
- launch/costmap_generator.launch.xml
-
- input_objects [default: ~/input/objects]
- input_points_no_ground [default: ~/input/points_no_ground]
- input_lanelet_map [default: ~/input/vector_map]
- input_scenario [default: ~/input/scenario]
- output_grid_map [default: ~/output/grid_map]
- output_occupancy_grid [default: ~/output/occupancy_grid]
- costmap_generator_param_file [default: $(find-pkg-share autoware_costmap_generator)/config/costmap_generator.param.yaml]
Messages
Services
Plugins
Recent questions tagged autoware_costmap_generator at Robotics Stack Exchange
Package Summary
Tags | No category tags. |
Version | 0.47.0 |
License | Apache License 2.0 |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Description | |
Checkout URI | https://github.com/autowarefoundation/autoware_universe.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2025-08-16 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | planner ros calibration self-driving-car autonomous-driving autonomous-vehicles ros2 3d-map autoware |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- Kosuke Takeuchi
- Takamasa Horibe
- Takayuki Murooka
Authors
costmap_generator
costmap_generator_node
This node reads PointCloud
and/or DynamicObjectArray
and creates an OccupancyGrid
and GridMap
. VectorMap(Lanelet2)
is optional.
Input topics
Name | Type | Description |
---|---|---|
~input/objects |
autoware_perception_msgs::PredictedObjects | predicted objects, for obstacles areas |
~input/points_no_ground |
sensor_msgs::PointCloud2 | ground-removed points, for obstacle areas which can’t be detected as objects |
~input/vector_map |
autoware_map_msgs::msg::LaneletMapBin | vector map, for drivable areas |
~input/scenario |
tier4_planning_msgs::Scenario | scenarios to be activated, for node activation |
Output topics
Name | Type | Description |
---|---|---|
~output/grid_map |
grid_map_msgs::GridMap | costmap as GridMap, values are from 0.0 to 1.0 |
~output/occupancy_grid |
nav_msgs::OccupancyGrid | costmap as OccupancyGrid, values are from 0 to 100 |
Output TFs
None
How to launch
-
Execute the command
source install/setup.bash
to setup the environment -
Run
ros2 launch costmap_generator costmap_generator.launch.xml
to launch the node
Parameters
Name | Type | Description |
---|---|---|
update_rate |
double | timer’s update rate |
activate_by_scenario |
bool | if true, activate by scenario = parking. Otherwise, activate if vehicle is inside parking lot. |
use_objects |
bool | whether using ~input/objects or not |
use_points |
bool | whether using ~input/points_no_ground or not |
use_wayarea |
bool | whether using wayarea from ~input/vector_map or not |
use_parkinglot |
bool | whether using parkinglot from ~input/vector_map or not |
costmap_frame |
string | created costmap’s coordinate |
vehicle_frame |
string | vehicle’s coordinate |
map_frame |
string | map’s coordinate |
grid_min_value |
double | minimum cost for gridmap |
grid_max_value |
double | maximum cost for gridmap |
grid_resolution |
double | resolution for gridmap |
grid_length_x |
int | size of gridmap for x direction |
grid_length_y |
int | size of gridmap for y direction |
grid_position_x |
int | offset from coordinate in x direction |
grid_position_y |
int | offset from coordinate in y direction |
maximum_lidar_height_thres |
double | maximum height threshold for pointcloud data (relative to the vehicle_frame) |
minimum_lidar_height_thres |
double | minimum height threshold for pointcloud data (relative to the vehicle_frame) |
expand_rectangle_size |
double | expand object’s rectangle with this value |
size_of_expansion_kernel |
int | kernel size for blurring effect on object’s costmap |
Flowchart
@startuml
title onTimer
start
if (scenario is active?) then (yes)
else (no)
stop
endif
:get current pose;
:set the center of costmap to current pose;
if (use wayarea or use parkinglot?) then (yes)
:generate map primitives costmap;
endif
if (use objects?) then (yes)
:generate objects costmap;
endif
if (use points?) then (yes)
:generate points costmap;
endif
:combine costmap;
:publish costmap;
stop
@enduml
Changelog for package autoware_costmap_generator
0.47.0 (2025-08-11)
0.46.0 (2025-06-20)
0.45.0 (2025-05-22)
0.44.2 (2025-06-10)
0.44.1 (2025-05-01)
0.44.0 (2025-04-18)
0.43.0 (2025-03-21)
- Merge remote-tracking branch 'origin/main' into chore/bump-version-0.43
- chore: rename from [autoware.universe]{.title-ref} to [autoware_universe]{.title-ref} (#10306)
- Contributors: Hayato Mizushima, Yutaka Kondo
0.42.0 (2025-03-03)
- Merge remote-tracking branch 'origin/main' into tmp/bot/bump_version_base
- feat(autoware_utils): replace autoware_universe_utils with autoware_utils (#10191)
- feat!: replace scenario msg from tier4_planning_msgs to autoware_internal_planning_msgs (#10180)
- Contributors: Fumiya Watanabe, Ryohsuke Mitsudome, 心刚
0.41.2 (2025-02-19)
- chore: bump version to 0.41.1 (#10088)
- Contributors: Ryohsuke Mitsudome
0.41.1 (2025-02-10)
0.41.0 (2025-01-29)
- Merge remote-tracking branch 'origin/main' into tmp/bot/bump_version_base
- feat(autoware_costmap_generator): tier4_debug_msgs changed to autoware_internal-debug_msgs in autoware_costmap_generator (#9901) feat: tier4_debug_msgs changed to autoware_internal-debug_msgs in files planning/autoware_costmap_generator
- fix(autoware_costmap_generator): fix bugprone-branch-clone (#9669) fix: bugprone-error
- chore(autoware_costmap_generator): suppress Could not find a connection between 'map' and 'base_link' (#9655)
- Contributors: Fumiya Watanabe, Vishal Chauhan, Yukinari Hisaki, kobayu858
0.40.0 (2024-12-12)
-
Merge branch 'main' into release-0.40.0
-
Revert "chore(package.xml): bump version to 0.39.0 (#9587)" This reverts commit c9f0f2688c57b0f657f5c1f28f036a970682e7f5.
-
fix: fix ticket links in CHANGELOG.rst (#9588)
-
chore(package.xml): bump version to 0.39.0 (#9587)
- chore(package.xml): bump version to 0.39.0
- fix: fix ticket links in CHANGELOG.rst
* fix: remove unnecessary diff ---------Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
-
fix: fix ticket links in CHANGELOG.rst (#9588)
-
feat(costmap_generator, scenario_selector): improve freespace planning stability (#9579)
- discretize updating grid center position by size of grid resolution
- modify logic for switching to lane driving in scenario selector
* fix spelling ---------
-
fix(cpplint): include what you use - planning (#9570)
-
refactor: correct spelling (#9528)
File truncated at 100 lines see the full file
Package Dependencies
System Dependencies
Name |
---|
libpcl-all-dev |
Dependant Packages
Name | Deps |
---|---|
tier4_planning_launch |
Launch files
- launch/costmap_generator.launch.xml
-
- input_objects [default: ~/input/objects]
- input_points_no_ground [default: ~/input/points_no_ground]
- input_lanelet_map [default: ~/input/vector_map]
- input_scenario [default: ~/input/scenario]
- output_grid_map [default: ~/output/grid_map]
- output_occupancy_grid [default: ~/output/occupancy_grid]
- costmap_generator_param_file [default: $(find-pkg-share autoware_costmap_generator)/config/costmap_generator.param.yaml]
Messages
Services
Plugins
Recent questions tagged autoware_costmap_generator at Robotics Stack Exchange
Package Summary
Tags | No category tags. |
Version | 0.47.0 |
License | Apache License 2.0 |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Description | |
Checkout URI | https://github.com/autowarefoundation/autoware_universe.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2025-08-16 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | planner ros calibration self-driving-car autonomous-driving autonomous-vehicles ros2 3d-map autoware |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- Kosuke Takeuchi
- Takamasa Horibe
- Takayuki Murooka
Authors
costmap_generator
costmap_generator_node
This node reads PointCloud
and/or DynamicObjectArray
and creates an OccupancyGrid
and GridMap
. VectorMap(Lanelet2)
is optional.
Input topics
Name | Type | Description |
---|---|---|
~input/objects |
autoware_perception_msgs::PredictedObjects | predicted objects, for obstacles areas |
~input/points_no_ground |
sensor_msgs::PointCloud2 | ground-removed points, for obstacle areas which can’t be detected as objects |
~input/vector_map |
autoware_map_msgs::msg::LaneletMapBin | vector map, for drivable areas |
~input/scenario |
tier4_planning_msgs::Scenario | scenarios to be activated, for node activation |
Output topics
Name | Type | Description |
---|---|---|
~output/grid_map |
grid_map_msgs::GridMap | costmap as GridMap, values are from 0.0 to 1.0 |
~output/occupancy_grid |
nav_msgs::OccupancyGrid | costmap as OccupancyGrid, values are from 0 to 100 |
Output TFs
None
How to launch
-
Execute the command
source install/setup.bash
to setup the environment -
Run
ros2 launch costmap_generator costmap_generator.launch.xml
to launch the node
Parameters
Name | Type | Description |
---|---|---|
update_rate |
double | timer’s update rate |
activate_by_scenario |
bool | if true, activate by scenario = parking. Otherwise, activate if vehicle is inside parking lot. |
use_objects |
bool | whether using ~input/objects or not |
use_points |
bool | whether using ~input/points_no_ground or not |
use_wayarea |
bool | whether using wayarea from ~input/vector_map or not |
use_parkinglot |
bool | whether using parkinglot from ~input/vector_map or not |
costmap_frame |
string | created costmap’s coordinate |
vehicle_frame |
string | vehicle’s coordinate |
map_frame |
string | map’s coordinate |
grid_min_value |
double | minimum cost for gridmap |
grid_max_value |
double | maximum cost for gridmap |
grid_resolution |
double | resolution for gridmap |
grid_length_x |
int | size of gridmap for x direction |
grid_length_y |
int | size of gridmap for y direction |
grid_position_x |
int | offset from coordinate in x direction |
grid_position_y |
int | offset from coordinate in y direction |
maximum_lidar_height_thres |
double | maximum height threshold for pointcloud data (relative to the vehicle_frame) |
minimum_lidar_height_thres |
double | minimum height threshold for pointcloud data (relative to the vehicle_frame) |
expand_rectangle_size |
double | expand object’s rectangle with this value |
size_of_expansion_kernel |
int | kernel size for blurring effect on object’s costmap |
Flowchart
@startuml
title onTimer
start
if (scenario is active?) then (yes)
else (no)
stop
endif
:get current pose;
:set the center of costmap to current pose;
if (use wayarea or use parkinglot?) then (yes)
:generate map primitives costmap;
endif
if (use objects?) then (yes)
:generate objects costmap;
endif
if (use points?) then (yes)
:generate points costmap;
endif
:combine costmap;
:publish costmap;
stop
@enduml
Changelog for package autoware_costmap_generator
0.47.0 (2025-08-11)
0.46.0 (2025-06-20)
0.45.0 (2025-05-22)
0.44.2 (2025-06-10)
0.44.1 (2025-05-01)
0.44.0 (2025-04-18)
0.43.0 (2025-03-21)
- Merge remote-tracking branch 'origin/main' into chore/bump-version-0.43
- chore: rename from [autoware.universe]{.title-ref} to [autoware_universe]{.title-ref} (#10306)
- Contributors: Hayato Mizushima, Yutaka Kondo
0.42.0 (2025-03-03)
- Merge remote-tracking branch 'origin/main' into tmp/bot/bump_version_base
- feat(autoware_utils): replace autoware_universe_utils with autoware_utils (#10191)
- feat!: replace scenario msg from tier4_planning_msgs to autoware_internal_planning_msgs (#10180)
- Contributors: Fumiya Watanabe, Ryohsuke Mitsudome, 心刚
0.41.2 (2025-02-19)
- chore: bump version to 0.41.1 (#10088)
- Contributors: Ryohsuke Mitsudome
0.41.1 (2025-02-10)
0.41.0 (2025-01-29)
- Merge remote-tracking branch 'origin/main' into tmp/bot/bump_version_base
- feat(autoware_costmap_generator): tier4_debug_msgs changed to autoware_internal-debug_msgs in autoware_costmap_generator (#9901) feat: tier4_debug_msgs changed to autoware_internal-debug_msgs in files planning/autoware_costmap_generator
- fix(autoware_costmap_generator): fix bugprone-branch-clone (#9669) fix: bugprone-error
- chore(autoware_costmap_generator): suppress Could not find a connection between 'map' and 'base_link' (#9655)
- Contributors: Fumiya Watanabe, Vishal Chauhan, Yukinari Hisaki, kobayu858
0.40.0 (2024-12-12)
-
Merge branch 'main' into release-0.40.0
-
Revert "chore(package.xml): bump version to 0.39.0 (#9587)" This reverts commit c9f0f2688c57b0f657f5c1f28f036a970682e7f5.
-
fix: fix ticket links in CHANGELOG.rst (#9588)
-
chore(package.xml): bump version to 0.39.0 (#9587)
- chore(package.xml): bump version to 0.39.0
- fix: fix ticket links in CHANGELOG.rst
* fix: remove unnecessary diff ---------Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
-
fix: fix ticket links in CHANGELOG.rst (#9588)
-
feat(costmap_generator, scenario_selector): improve freespace planning stability (#9579)
- discretize updating grid center position by size of grid resolution
- modify logic for switching to lane driving in scenario selector
* fix spelling ---------
-
fix(cpplint): include what you use - planning (#9570)
-
refactor: correct spelling (#9528)
File truncated at 100 lines see the full file
Package Dependencies
System Dependencies
Name |
---|
libpcl-all-dev |
Dependant Packages
Name | Deps |
---|---|
tier4_planning_launch |
Launch files
- launch/costmap_generator.launch.xml
-
- input_objects [default: ~/input/objects]
- input_points_no_ground [default: ~/input/points_no_ground]
- input_lanelet_map [default: ~/input/vector_map]
- input_scenario [default: ~/input/scenario]
- output_grid_map [default: ~/output/grid_map]
- output_occupancy_grid [default: ~/output/occupancy_grid]
- costmap_generator_param_file [default: $(find-pkg-share autoware_costmap_generator)/config/costmap_generator.param.yaml]
Messages
Services
Plugins
Recent questions tagged autoware_costmap_generator at Robotics Stack Exchange
Package Summary
Tags | No category tags. |
Version | 0.47.0 |
License | Apache License 2.0 |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Description | |
Checkout URI | https://github.com/autowarefoundation/autoware_universe.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2025-08-16 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | planner ros calibration self-driving-car autonomous-driving autonomous-vehicles ros2 3d-map autoware |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- Kosuke Takeuchi
- Takamasa Horibe
- Takayuki Murooka
Authors
costmap_generator
costmap_generator_node
This node reads PointCloud
and/or DynamicObjectArray
and creates an OccupancyGrid
and GridMap
. VectorMap(Lanelet2)
is optional.
Input topics
Name | Type | Description |
---|---|---|
~input/objects |
autoware_perception_msgs::PredictedObjects | predicted objects, for obstacles areas |
~input/points_no_ground |
sensor_msgs::PointCloud2 | ground-removed points, for obstacle areas which can’t be detected as objects |
~input/vector_map |
autoware_map_msgs::msg::LaneletMapBin | vector map, for drivable areas |
~input/scenario |
tier4_planning_msgs::Scenario | scenarios to be activated, for node activation |
Output topics
Name | Type | Description |
---|---|---|
~output/grid_map |
grid_map_msgs::GridMap | costmap as GridMap, values are from 0.0 to 1.0 |
~output/occupancy_grid |
nav_msgs::OccupancyGrid | costmap as OccupancyGrid, values are from 0 to 100 |
Output TFs
None
How to launch
-
Execute the command
source install/setup.bash
to setup the environment -
Run
ros2 launch costmap_generator costmap_generator.launch.xml
to launch the node
Parameters
Name | Type | Description |
---|---|---|
update_rate |
double | timer’s update rate |
activate_by_scenario |
bool | if true, activate by scenario = parking. Otherwise, activate if vehicle is inside parking lot. |
use_objects |
bool | whether using ~input/objects or not |
use_points |
bool | whether using ~input/points_no_ground or not |
use_wayarea |
bool | whether using wayarea from ~input/vector_map or not |
use_parkinglot |
bool | whether using parkinglot from ~input/vector_map or not |
costmap_frame |
string | created costmap’s coordinate |
vehicle_frame |
string | vehicle’s coordinate |
map_frame |
string | map’s coordinate |
grid_min_value |
double | minimum cost for gridmap |
grid_max_value |
double | maximum cost for gridmap |
grid_resolution |
double | resolution for gridmap |
grid_length_x |
int | size of gridmap for x direction |
grid_length_y |
int | size of gridmap for y direction |
grid_position_x |
int | offset from coordinate in x direction |
grid_position_y |
int | offset from coordinate in y direction |
maximum_lidar_height_thres |
double | maximum height threshold for pointcloud data (relative to the vehicle_frame) |
minimum_lidar_height_thres |
double | minimum height threshold for pointcloud data (relative to the vehicle_frame) |
expand_rectangle_size |
double | expand object’s rectangle with this value |
size_of_expansion_kernel |
int | kernel size for blurring effect on object’s costmap |
Flowchart
@startuml
title onTimer
start
if (scenario is active?) then (yes)
else (no)
stop
endif
:get current pose;
:set the center of costmap to current pose;
if (use wayarea or use parkinglot?) then (yes)
:generate map primitives costmap;
endif
if (use objects?) then (yes)
:generate objects costmap;
endif
if (use points?) then (yes)
:generate points costmap;
endif
:combine costmap;
:publish costmap;
stop
@enduml
Changelog for package autoware_costmap_generator
0.47.0 (2025-08-11)
0.46.0 (2025-06-20)
0.45.0 (2025-05-22)
0.44.2 (2025-06-10)
0.44.1 (2025-05-01)
0.44.0 (2025-04-18)
0.43.0 (2025-03-21)
- Merge remote-tracking branch 'origin/main' into chore/bump-version-0.43
- chore: rename from [autoware.universe]{.title-ref} to [autoware_universe]{.title-ref} (#10306)
- Contributors: Hayato Mizushima, Yutaka Kondo
0.42.0 (2025-03-03)
- Merge remote-tracking branch 'origin/main' into tmp/bot/bump_version_base
- feat(autoware_utils): replace autoware_universe_utils with autoware_utils (#10191)
- feat!: replace scenario msg from tier4_planning_msgs to autoware_internal_planning_msgs (#10180)
- Contributors: Fumiya Watanabe, Ryohsuke Mitsudome, 心刚
0.41.2 (2025-02-19)
- chore: bump version to 0.41.1 (#10088)
- Contributors: Ryohsuke Mitsudome
0.41.1 (2025-02-10)
0.41.0 (2025-01-29)
- Merge remote-tracking branch 'origin/main' into tmp/bot/bump_version_base
- feat(autoware_costmap_generator): tier4_debug_msgs changed to autoware_internal-debug_msgs in autoware_costmap_generator (#9901) feat: tier4_debug_msgs changed to autoware_internal-debug_msgs in files planning/autoware_costmap_generator
- fix(autoware_costmap_generator): fix bugprone-branch-clone (#9669) fix: bugprone-error
- chore(autoware_costmap_generator): suppress Could not find a connection between 'map' and 'base_link' (#9655)
- Contributors: Fumiya Watanabe, Vishal Chauhan, Yukinari Hisaki, kobayu858
0.40.0 (2024-12-12)
-
Merge branch 'main' into release-0.40.0
-
Revert "chore(package.xml): bump version to 0.39.0 (#9587)" This reverts commit c9f0f2688c57b0f657f5c1f28f036a970682e7f5.
-
fix: fix ticket links in CHANGELOG.rst (#9588)
-
chore(package.xml): bump version to 0.39.0 (#9587)
- chore(package.xml): bump version to 0.39.0
- fix: fix ticket links in CHANGELOG.rst
* fix: remove unnecessary diff ---------Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
-
fix: fix ticket links in CHANGELOG.rst (#9588)
-
feat(costmap_generator, scenario_selector): improve freespace planning stability (#9579)
- discretize updating grid center position by size of grid resolution
- modify logic for switching to lane driving in scenario selector
* fix spelling ---------
-
fix(cpplint): include what you use - planning (#9570)
-
refactor: correct spelling (#9528)
File truncated at 100 lines see the full file
Package Dependencies
System Dependencies
Name |
---|
libpcl-all-dev |
Dependant Packages
Name | Deps |
---|---|
tier4_planning_launch |
Launch files
- launch/costmap_generator.launch.xml
-
- input_objects [default: ~/input/objects]
- input_points_no_ground [default: ~/input/points_no_ground]
- input_lanelet_map [default: ~/input/vector_map]
- input_scenario [default: ~/input/scenario]
- output_grid_map [default: ~/output/grid_map]
- output_occupancy_grid [default: ~/output/occupancy_grid]
- costmap_generator_param_file [default: $(find-pkg-share autoware_costmap_generator)/config/costmap_generator.param.yaml]
Messages
Services
Plugins
Recent questions tagged autoware_costmap_generator at Robotics Stack Exchange
Package Summary
Tags | No category tags. |
Version | 0.47.0 |
License | Apache License 2.0 |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Description | |
Checkout URI | https://github.com/autowarefoundation/autoware_universe.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2025-08-16 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | planner ros calibration self-driving-car autonomous-driving autonomous-vehicles ros2 3d-map autoware |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- Kosuke Takeuchi
- Takamasa Horibe
- Takayuki Murooka
Authors
costmap_generator
costmap_generator_node
This node reads PointCloud
and/or DynamicObjectArray
and creates an OccupancyGrid
and GridMap
. VectorMap(Lanelet2)
is optional.
Input topics
Name | Type | Description |
---|---|---|
~input/objects |
autoware_perception_msgs::PredictedObjects | predicted objects, for obstacles areas |
~input/points_no_ground |
sensor_msgs::PointCloud2 | ground-removed points, for obstacle areas which can’t be detected as objects |
~input/vector_map |
autoware_map_msgs::msg::LaneletMapBin | vector map, for drivable areas |
~input/scenario |
tier4_planning_msgs::Scenario | scenarios to be activated, for node activation |
Output topics
Name | Type | Description |
---|---|---|
~output/grid_map |
grid_map_msgs::GridMap | costmap as GridMap, values are from 0.0 to 1.0 |
~output/occupancy_grid |
nav_msgs::OccupancyGrid | costmap as OccupancyGrid, values are from 0 to 100 |
Output TFs
None
How to launch
-
Execute the command
source install/setup.bash
to setup the environment -
Run
ros2 launch costmap_generator costmap_generator.launch.xml
to launch the node
Parameters
Name | Type | Description |
---|---|---|
update_rate |
double | timer’s update rate |
activate_by_scenario |
bool | if true, activate by scenario = parking. Otherwise, activate if vehicle is inside parking lot. |
use_objects |
bool | whether using ~input/objects or not |
use_points |
bool | whether using ~input/points_no_ground or not |
use_wayarea |
bool | whether using wayarea from ~input/vector_map or not |
use_parkinglot |
bool | whether using parkinglot from ~input/vector_map or not |
costmap_frame |
string | created costmap’s coordinate |
vehicle_frame |
string | vehicle’s coordinate |
map_frame |
string | map’s coordinate |
grid_min_value |
double | minimum cost for gridmap |
grid_max_value |
double | maximum cost for gridmap |
grid_resolution |
double | resolution for gridmap |
grid_length_x |
int | size of gridmap for x direction |
grid_length_y |
int | size of gridmap for y direction |
grid_position_x |
int | offset from coordinate in x direction |
grid_position_y |
int | offset from coordinate in y direction |
maximum_lidar_height_thres |
double | maximum height threshold for pointcloud data (relative to the vehicle_frame) |
minimum_lidar_height_thres |
double | minimum height threshold for pointcloud data (relative to the vehicle_frame) |
expand_rectangle_size |
double | expand object’s rectangle with this value |
size_of_expansion_kernel |
int | kernel size for blurring effect on object’s costmap |
Flowchart
@startuml
title onTimer
start
if (scenario is active?) then (yes)
else (no)
stop
endif
:get current pose;
:set the center of costmap to current pose;
if (use wayarea or use parkinglot?) then (yes)
:generate map primitives costmap;
endif
if (use objects?) then (yes)
:generate objects costmap;
endif
if (use points?) then (yes)
:generate points costmap;
endif
:combine costmap;
:publish costmap;
stop
@enduml
Changelog for package autoware_costmap_generator
0.47.0 (2025-08-11)
0.46.0 (2025-06-20)
0.45.0 (2025-05-22)
0.44.2 (2025-06-10)
0.44.1 (2025-05-01)
0.44.0 (2025-04-18)
0.43.0 (2025-03-21)
- Merge remote-tracking branch 'origin/main' into chore/bump-version-0.43
- chore: rename from [autoware.universe]{.title-ref} to [autoware_universe]{.title-ref} (#10306)
- Contributors: Hayato Mizushima, Yutaka Kondo
0.42.0 (2025-03-03)
- Merge remote-tracking branch 'origin/main' into tmp/bot/bump_version_base
- feat(autoware_utils): replace autoware_universe_utils with autoware_utils (#10191)
- feat!: replace scenario msg from tier4_planning_msgs to autoware_internal_planning_msgs (#10180)
- Contributors: Fumiya Watanabe, Ryohsuke Mitsudome, 心刚
0.41.2 (2025-02-19)
- chore: bump version to 0.41.1 (#10088)
- Contributors: Ryohsuke Mitsudome
0.41.1 (2025-02-10)
0.41.0 (2025-01-29)
- Merge remote-tracking branch 'origin/main' into tmp/bot/bump_version_base
- feat(autoware_costmap_generator): tier4_debug_msgs changed to autoware_internal-debug_msgs in autoware_costmap_generator (#9901) feat: tier4_debug_msgs changed to autoware_internal-debug_msgs in files planning/autoware_costmap_generator
- fix(autoware_costmap_generator): fix bugprone-branch-clone (#9669) fix: bugprone-error
- chore(autoware_costmap_generator): suppress Could not find a connection between 'map' and 'base_link' (#9655)
- Contributors: Fumiya Watanabe, Vishal Chauhan, Yukinari Hisaki, kobayu858
0.40.0 (2024-12-12)
-
Merge branch 'main' into release-0.40.0
-
Revert "chore(package.xml): bump version to 0.39.0 (#9587)" This reverts commit c9f0f2688c57b0f657f5c1f28f036a970682e7f5.
-
fix: fix ticket links in CHANGELOG.rst (#9588)
-
chore(package.xml): bump version to 0.39.0 (#9587)
- chore(package.xml): bump version to 0.39.0
- fix: fix ticket links in CHANGELOG.rst
* fix: remove unnecessary diff ---------Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
-
fix: fix ticket links in CHANGELOG.rst (#9588)
-
feat(costmap_generator, scenario_selector): improve freespace planning stability (#9579)
- discretize updating grid center position by size of grid resolution
- modify logic for switching to lane driving in scenario selector
* fix spelling ---------
-
fix(cpplint): include what you use - planning (#9570)
-
refactor: correct spelling (#9528)
File truncated at 100 lines see the full file
Package Dependencies
System Dependencies
Name |
---|
libpcl-all-dev |
Dependant Packages
Name | Deps |
---|---|
tier4_planning_launch |
Launch files
- launch/costmap_generator.launch.xml
-
- input_objects [default: ~/input/objects]
- input_points_no_ground [default: ~/input/points_no_ground]
- input_lanelet_map [default: ~/input/vector_map]
- input_scenario [default: ~/input/scenario]
- output_grid_map [default: ~/output/grid_map]
- output_occupancy_grid [default: ~/output/occupancy_grid]
- costmap_generator_param_file [default: $(find-pkg-share autoware_costmap_generator)/config/costmap_generator.param.yaml]
Messages
Services
Plugins
Recent questions tagged autoware_costmap_generator at Robotics Stack Exchange
Package Summary
Tags | No category tags. |
Version | 0.47.0 |
License | Apache License 2.0 |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Description | |
Checkout URI | https://github.com/autowarefoundation/autoware_universe.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2025-08-16 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | planner ros calibration self-driving-car autonomous-driving autonomous-vehicles ros2 3d-map autoware |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- Kosuke Takeuchi
- Takamasa Horibe
- Takayuki Murooka
Authors
costmap_generator
costmap_generator_node
This node reads PointCloud
and/or DynamicObjectArray
and creates an OccupancyGrid
and GridMap
. VectorMap(Lanelet2)
is optional.
Input topics
Name | Type | Description |
---|---|---|
~input/objects |
autoware_perception_msgs::PredictedObjects | predicted objects, for obstacles areas |
~input/points_no_ground |
sensor_msgs::PointCloud2 | ground-removed points, for obstacle areas which can’t be detected as objects |
~input/vector_map |
autoware_map_msgs::msg::LaneletMapBin | vector map, for drivable areas |
~input/scenario |
tier4_planning_msgs::Scenario | scenarios to be activated, for node activation |
Output topics
Name | Type | Description |
---|---|---|
~output/grid_map |
grid_map_msgs::GridMap | costmap as GridMap, values are from 0.0 to 1.0 |
~output/occupancy_grid |
nav_msgs::OccupancyGrid | costmap as OccupancyGrid, values are from 0 to 100 |
Output TFs
None
How to launch
-
Execute the command
source install/setup.bash
to setup the environment -
Run
ros2 launch costmap_generator costmap_generator.launch.xml
to launch the node
Parameters
Name | Type | Description |
---|---|---|
update_rate |
double | timer’s update rate |
activate_by_scenario |
bool | if true, activate by scenario = parking. Otherwise, activate if vehicle is inside parking lot. |
use_objects |
bool | whether using ~input/objects or not |
use_points |
bool | whether using ~input/points_no_ground or not |
use_wayarea |
bool | whether using wayarea from ~input/vector_map or not |
use_parkinglot |
bool | whether using parkinglot from ~input/vector_map or not |
costmap_frame |
string | created costmap’s coordinate |
vehicle_frame |
string | vehicle’s coordinate |
map_frame |
string | map’s coordinate |
grid_min_value |
double | minimum cost for gridmap |
grid_max_value |
double | maximum cost for gridmap |
grid_resolution |
double | resolution for gridmap |
grid_length_x |
int | size of gridmap for x direction |
grid_length_y |
int | size of gridmap for y direction |
grid_position_x |
int | offset from coordinate in x direction |
grid_position_y |
int | offset from coordinate in y direction |
maximum_lidar_height_thres |
double | maximum height threshold for pointcloud data (relative to the vehicle_frame) |
minimum_lidar_height_thres |
double | minimum height threshold for pointcloud data (relative to the vehicle_frame) |
expand_rectangle_size |
double | expand object’s rectangle with this value |
size_of_expansion_kernel |
int | kernel size for blurring effect on object’s costmap |
Flowchart
@startuml
title onTimer
start
if (scenario is active?) then (yes)
else (no)
stop
endif
:get current pose;
:set the center of costmap to current pose;
if (use wayarea or use parkinglot?) then (yes)
:generate map primitives costmap;
endif
if (use objects?) then (yes)
:generate objects costmap;
endif
if (use points?) then (yes)
:generate points costmap;
endif
:combine costmap;
:publish costmap;
stop
@enduml
Changelog for package autoware_costmap_generator
0.47.0 (2025-08-11)
0.46.0 (2025-06-20)
0.45.0 (2025-05-22)
0.44.2 (2025-06-10)
0.44.1 (2025-05-01)
0.44.0 (2025-04-18)
0.43.0 (2025-03-21)
- Merge remote-tracking branch 'origin/main' into chore/bump-version-0.43
- chore: rename from [autoware.universe]{.title-ref} to [autoware_universe]{.title-ref} (#10306)
- Contributors: Hayato Mizushima, Yutaka Kondo
0.42.0 (2025-03-03)
- Merge remote-tracking branch 'origin/main' into tmp/bot/bump_version_base
- feat(autoware_utils): replace autoware_universe_utils with autoware_utils (#10191)
- feat!: replace scenario msg from tier4_planning_msgs to autoware_internal_planning_msgs (#10180)
- Contributors: Fumiya Watanabe, Ryohsuke Mitsudome, 心刚
0.41.2 (2025-02-19)
- chore: bump version to 0.41.1 (#10088)
- Contributors: Ryohsuke Mitsudome
0.41.1 (2025-02-10)
0.41.0 (2025-01-29)
- Merge remote-tracking branch 'origin/main' into tmp/bot/bump_version_base
- feat(autoware_costmap_generator): tier4_debug_msgs changed to autoware_internal-debug_msgs in autoware_costmap_generator (#9901) feat: tier4_debug_msgs changed to autoware_internal-debug_msgs in files planning/autoware_costmap_generator
- fix(autoware_costmap_generator): fix bugprone-branch-clone (#9669) fix: bugprone-error
- chore(autoware_costmap_generator): suppress Could not find a connection between 'map' and 'base_link' (#9655)
- Contributors: Fumiya Watanabe, Vishal Chauhan, Yukinari Hisaki, kobayu858
0.40.0 (2024-12-12)
-
Merge branch 'main' into release-0.40.0
-
Revert "chore(package.xml): bump version to 0.39.0 (#9587)" This reverts commit c9f0f2688c57b0f657f5c1f28f036a970682e7f5.
-
fix: fix ticket links in CHANGELOG.rst (#9588)
-
chore(package.xml): bump version to 0.39.0 (#9587)
- chore(package.xml): bump version to 0.39.0
- fix: fix ticket links in CHANGELOG.rst
* fix: remove unnecessary diff ---------Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
-
fix: fix ticket links in CHANGELOG.rst (#9588)
-
feat(costmap_generator, scenario_selector): improve freespace planning stability (#9579)
- discretize updating grid center position by size of grid resolution
- modify logic for switching to lane driving in scenario selector
* fix spelling ---------
-
fix(cpplint): include what you use - planning (#9570)
-
refactor: correct spelling (#9528)
File truncated at 100 lines see the full file
Package Dependencies
System Dependencies
Name |
---|
libpcl-all-dev |
Dependant Packages
Name | Deps |
---|---|
tier4_planning_launch |
Launch files
- launch/costmap_generator.launch.xml
-
- input_objects [default: ~/input/objects]
- input_points_no_ground [default: ~/input/points_no_ground]
- input_lanelet_map [default: ~/input/vector_map]
- input_scenario [default: ~/input/scenario]
- output_grid_map [default: ~/output/grid_map]
- output_occupancy_grid [default: ~/output/occupancy_grid]
- costmap_generator_param_file [default: $(find-pkg-share autoware_costmap_generator)/config/costmap_generator.param.yaml]
Messages
Services
Plugins
Recent questions tagged autoware_costmap_generator at Robotics Stack Exchange
Package Summary
Tags | No category tags. |
Version | 0.47.0 |
License | Apache License 2.0 |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Description | |
Checkout URI | https://github.com/autowarefoundation/autoware_universe.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2025-08-16 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | planner ros calibration self-driving-car autonomous-driving autonomous-vehicles ros2 3d-map autoware |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- Kosuke Takeuchi
- Takamasa Horibe
- Takayuki Murooka
Authors
costmap_generator
costmap_generator_node
This node reads PointCloud
and/or DynamicObjectArray
and creates an OccupancyGrid
and GridMap
. VectorMap(Lanelet2)
is optional.
Input topics
Name | Type | Description |
---|---|---|
~input/objects |
autoware_perception_msgs::PredictedObjects | predicted objects, for obstacles areas |
~input/points_no_ground |
sensor_msgs::PointCloud2 | ground-removed points, for obstacle areas which can’t be detected as objects |
~input/vector_map |
autoware_map_msgs::msg::LaneletMapBin | vector map, for drivable areas |
~input/scenario |
tier4_planning_msgs::Scenario | scenarios to be activated, for node activation |
Output topics
Name | Type | Description |
---|---|---|
~output/grid_map |
grid_map_msgs::GridMap | costmap as GridMap, values are from 0.0 to 1.0 |
~output/occupancy_grid |
nav_msgs::OccupancyGrid | costmap as OccupancyGrid, values are from 0 to 100 |
Output TFs
None
How to launch
-
Execute the command
source install/setup.bash
to setup the environment -
Run
ros2 launch costmap_generator costmap_generator.launch.xml
to launch the node
Parameters
Name | Type | Description |
---|---|---|
update_rate |
double | timer’s update rate |
activate_by_scenario |
bool | if true, activate by scenario = parking. Otherwise, activate if vehicle is inside parking lot. |
use_objects |
bool | whether using ~input/objects or not |
use_points |
bool | whether using ~input/points_no_ground or not |
use_wayarea |
bool | whether using wayarea from ~input/vector_map or not |
use_parkinglot |
bool | whether using parkinglot from ~input/vector_map or not |
costmap_frame |
string | created costmap’s coordinate |
vehicle_frame |
string | vehicle’s coordinate |
map_frame |
string | map’s coordinate |
grid_min_value |
double | minimum cost for gridmap |
grid_max_value |
double | maximum cost for gridmap |
grid_resolution |
double | resolution for gridmap |
grid_length_x |
int | size of gridmap for x direction |
grid_length_y |
int | size of gridmap for y direction |
grid_position_x |
int | offset from coordinate in x direction |
grid_position_y |
int | offset from coordinate in y direction |
maximum_lidar_height_thres |
double | maximum height threshold for pointcloud data (relative to the vehicle_frame) |
minimum_lidar_height_thres |
double | minimum height threshold for pointcloud data (relative to the vehicle_frame) |
expand_rectangle_size |
double | expand object’s rectangle with this value |
size_of_expansion_kernel |
int | kernel size for blurring effect on object’s costmap |
Flowchart
@startuml
title onTimer
start
if (scenario is active?) then (yes)
else (no)
stop
endif
:get current pose;
:set the center of costmap to current pose;
if (use wayarea or use parkinglot?) then (yes)
:generate map primitives costmap;
endif
if (use objects?) then (yes)
:generate objects costmap;
endif
if (use points?) then (yes)
:generate points costmap;
endif
:combine costmap;
:publish costmap;
stop
@enduml
Changelog for package autoware_costmap_generator
0.47.0 (2025-08-11)
0.46.0 (2025-06-20)
0.45.0 (2025-05-22)
0.44.2 (2025-06-10)
0.44.1 (2025-05-01)
0.44.0 (2025-04-18)
0.43.0 (2025-03-21)
- Merge remote-tracking branch 'origin/main' into chore/bump-version-0.43
- chore: rename from [autoware.universe]{.title-ref} to [autoware_universe]{.title-ref} (#10306)
- Contributors: Hayato Mizushima, Yutaka Kondo
0.42.0 (2025-03-03)
- Merge remote-tracking branch 'origin/main' into tmp/bot/bump_version_base
- feat(autoware_utils): replace autoware_universe_utils with autoware_utils (#10191)
- feat!: replace scenario msg from tier4_planning_msgs to autoware_internal_planning_msgs (#10180)
- Contributors: Fumiya Watanabe, Ryohsuke Mitsudome, 心刚
0.41.2 (2025-02-19)
- chore: bump version to 0.41.1 (#10088)
- Contributors: Ryohsuke Mitsudome
0.41.1 (2025-02-10)
0.41.0 (2025-01-29)
- Merge remote-tracking branch 'origin/main' into tmp/bot/bump_version_base
- feat(autoware_costmap_generator): tier4_debug_msgs changed to autoware_internal-debug_msgs in autoware_costmap_generator (#9901) feat: tier4_debug_msgs changed to autoware_internal-debug_msgs in files planning/autoware_costmap_generator
- fix(autoware_costmap_generator): fix bugprone-branch-clone (#9669) fix: bugprone-error
- chore(autoware_costmap_generator): suppress Could not find a connection between 'map' and 'base_link' (#9655)
- Contributors: Fumiya Watanabe, Vishal Chauhan, Yukinari Hisaki, kobayu858
0.40.0 (2024-12-12)
-
Merge branch 'main' into release-0.40.0
-
Revert "chore(package.xml): bump version to 0.39.0 (#9587)" This reverts commit c9f0f2688c57b0f657f5c1f28f036a970682e7f5.
-
fix: fix ticket links in CHANGELOG.rst (#9588)
-
chore(package.xml): bump version to 0.39.0 (#9587)
- chore(package.xml): bump version to 0.39.0
- fix: fix ticket links in CHANGELOG.rst
* fix: remove unnecessary diff ---------Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
-
fix: fix ticket links in CHANGELOG.rst (#9588)
-
feat(costmap_generator, scenario_selector): improve freespace planning stability (#9579)
- discretize updating grid center position by size of grid resolution
- modify logic for switching to lane driving in scenario selector
* fix spelling ---------
-
fix(cpplint): include what you use - planning (#9570)
-
refactor: correct spelling (#9528)
File truncated at 100 lines see the full file
Package Dependencies
System Dependencies
Name |
---|
libpcl-all-dev |
Dependant Packages
Name | Deps |
---|---|
tier4_planning_launch |
Launch files
- launch/costmap_generator.launch.xml
-
- input_objects [default: ~/input/objects]
- input_points_no_ground [default: ~/input/points_no_ground]
- input_lanelet_map [default: ~/input/vector_map]
- input_scenario [default: ~/input/scenario]
- output_grid_map [default: ~/output/grid_map]
- output_occupancy_grid [default: ~/output/occupancy_grid]
- costmap_generator_param_file [default: $(find-pkg-share autoware_costmap_generator)/config/costmap_generator.param.yaml]