-
Notifications
You must be signed in to change notification settings - Fork 1.7k
Closed
Description
Bug report
While trying to debug why the loacal costmap is not getting published when namespacing my robot(solved in here), i saw, that the Docker Server subscribed to not namespace topics of the local_costmap.
Required Info:
- Operating System:
- Computer: Ubuntu 24.04
- ROS2 Version: Jazzy
- Version or commit hash: 1.3.5-1noble.20250210.222234
- DDS implementation: cyclon
Steps to reproduce issue
ros2 launch nav2_bringup tb3_simulation_launch.py namespace:=tb3_0
Expected behavior
The Node should subscribe to the namespaced local_costmap.
Actual behavior
When Running `ros2 node info /tb3_0/docking_server subscribs to non-namespaced topics, while the needed data is published on namespaced topics
Subscribers:
/clock: rosgraph_msgs/msg/Clock
/local_costmap/costmap_raw: nav2_msgs/msg/Costmap
/local_costmap/costmap_raw_updates: nav2_msgs/msg/CostmapUpdate
/local_costmap/published_footprint: geometry_msgs/msg/PolygonStamped
Additional information
I believe this is due to changes to the nav2_param.yaml file when adding collision detection for docking in #4752.
controller:
k_phi: 3.0
k_delta: 2.0
v_linear_min: 0.15
v_linear_max: 0.15
use_collision_detection: true
costmap_topic: "/local_costmap/costmap_raw"
footprint_topic: "/local_costmap/published_footprint"
transform_tolerance: 0.1
projection_time: 5.0
simulation_step: 0.1
dock_collision_threshold: 0.3
Metadata
Metadata
Assignees
Labels
No labels