Skip to content

Commit 33e78d7

Browse files
authored
Add namespace support for rviz costmap cost tool (#5268)
Signed-off-by: Maurice-1235 <[email protected]>
1 parent 2a80675 commit 33e78d7

File tree

1 file changed

+2
-2
lines changed

1 file changed

+2
-2
lines changed

nav2_rviz_plugins/src/costmap_cost_tool.cpp

Lines changed: 2 additions & 2 deletions
Original file line numberDiff line numberDiff line change
@@ -54,12 +54,12 @@ void CostmapCostTool::onInitialize()
5454
rclcpp::Node::SharedPtr node = node_ptr_->get_raw_node();
5555
local_cost_client_ =
5656
std::make_shared<nav2_util::ServiceClient<nav2_msgs::srv::GetCosts>>(
57-
"/local_costmap/get_cost_local_costmap",
57+
"local_costmap/get_cost_local_costmap",
5858
node,
5959
false /* Does not create and spin an internal executor*/);
6060
global_cost_client_ =
6161
std::make_shared<nav2_util::ServiceClient<nav2_msgs::srv::GetCosts>>(
62-
"/global_costmap/get_cost_global_costmap",
62+
"global_costmap/get_cost_global_costmap",
6363
node,
6464
false /* Does not create and spin an internal executor*/);
6565
}

0 commit comments

Comments
 (0)