Skip to content

Commit 137d577

Browse files
Fix integration test
Signed-off-by: Luca Della Vedova <[email protected]>
1 parent 0c958dc commit 137d577

File tree

1 file changed

+1
-0
lines changed

1 file changed

+1
-0
lines changed

nav2_costmap_2d/test/integration/test_costmap_topic_collision_checker.cpp

Lines changed: 1 addition & 0 deletions
Original file line numberDiff line numberDiff line change
@@ -97,6 +97,7 @@ class TestCollisionChecker : public nav2_util::LifecycleNode
9797
global_frame_("map")
9898
{
9999
// Declare non-plugin specific costmap parameters
100+
declare_parameter("__parent_namespace", rclcpp::ParameterValue(std::string("/")));
100101
declare_parameter("map_topic", rclcpp::ParameterValue(std::string("map")));
101102
declare_parameter("track_unknown_space", rclcpp::ParameterValue(true));
102103
declare_parameter("use_maximum", rclcpp::ParameterValue(false));

0 commit comments

Comments
 (0)