Skip to content

Commit 4755a1e

Browse files
authored
Temporarily disable dump_params test (#1856)
Signed-off-by: Sarthak Mittal <[email protected]>
1 parent 647b53b commit 4755a1e

File tree

2 files changed

+10
-6
lines changed

2 files changed

+10
-6
lines changed

nav2_util/test/CMakeLists.txt

Lines changed: 10 additions & 6 deletions
Original file line numberDiff line numberDiff line change
@@ -41,9 +41,13 @@ ament_add_gtest(test_robot_utils test_robot_utils.cpp)
4141
ament_target_dependencies(test_robot_utils geometry_msgs)
4242
target_link_libraries(test_robot_utils ${library_name})
4343

44-
add_launch_test(
45-
"test_dump_params/test_dump_params.launch.py"
46-
TIMEOUT 30
47-
ENV
48-
TEST_EXECUTABLE=$<TARGET_FILE:dump_params>
49-
)
44+
# This test is disabled due to failing services
45+
# https://github.com/ros-planning/navigation2/issues/1836
46+
47+
# add_launch_test(
48+
# "test_dump_params/test_dump_params.test.py"
49+
# TARGET "test_dump_params"
50+
# TIMEOUT 30
51+
# ENV
52+
# TEST_EXECUTABLE=$<TARGET_FILE:dump_params>
53+
# )

0 commit comments

Comments
 (0)