Skip to content

Commit 0ce6d0d

Browse files
Update controller_server.cpp
Signed-off-by: Steve Macenski <[email protected]>
1 parent 8ebc6e0 commit 0ce6d0d

File tree

1 file changed

+1
-2
lines changed

1 file changed

+1
-2
lines changed

nav2_controller/src/controller_server.cpp

Lines changed: 1 addition & 2 deletions
Original file line numberDiff line numberDiff line change
@@ -68,8 +68,7 @@ ControllerServer::ControllerServer(const rclcpp::NodeOptions & options)
6868
// The costmap node is used in the implementation of the controller
6969
costmap_ros_ = std::make_shared<nav2_costmap_2d::Costmap2DROS>(
7070
"local_costmap", std::string{get_namespace()},
71-
get_parameter("use_sim_time").as_bool(), options
72-
);
71+
get_parameter("use_sim_time").as_bool(), options);
7372
}
7473

7574
ControllerServer::~ControllerServer()

0 commit comments

Comments
 (0)