ros2 / demos

Apache License 2.0
491 stars 329 forks source link

Change occupancy value in `dummy_map_server` to 1. #680

Closed marcoag closed 2 months ago

marcoag commented 3 months ago

As pointed out in https://github.com/osrf/ros2_test_cases/issues/1200, dummy map server occupancy value should be 1 as specified in https://github.com/ros2/common_interfaces/blob/rolling/nav_msgs/msg/OccupancyGrid.msg.

We should backport this once merged.

audrow commented 2 months ago

My full thoughts on the values published in Occupancy Grids can be seen in the robot_navigation documentation. To stay consistent with the RViz visualization, I would probably stick with 100.

This is a good justification to me to keep things as they are then. I'm going to close this PR. We can reopen it if we decide to revisit this.

Thanks for the suggestion @marcoag!