Skip to content

Commit ed7a110

Browse files
Revert "adding base footprint publisher to nav2_util (#3860)"
This reverts commit cefce2c.
1 parent c1e4a42 commit ed7a110

File tree

5 files changed

+0
-237
lines changed

5 files changed

+0
-237
lines changed

nav2_util/include/nav2_util/base_footprint_publisher.hpp

Lines changed: 0 additions & 129 deletions
This file was deleted.

nav2_util/src/CMakeLists.txt

Lines changed: 0 additions & 5 deletions
Original file line numberDiff line numberDiff line change
@@ -28,11 +28,6 @@ add_executable(lifecycle_bringup
2828
)
2929
target_link_libraries(lifecycle_bringup ${library_name})
3030

31-
add_executable(base_footprint_publisher
32-
base_footprint_publisher.cpp
33-
)
34-
target_link_libraries(base_footprint_publisher ${library_name})
35-
3631
find_package(Boost REQUIRED COMPONENTS program_options)
3732

3833
install(TARGETS

nav2_util/src/base_footprint_publisher.cpp

Lines changed: 0 additions & 27 deletions
This file was deleted.

nav2_util/test/CMakeLists.txt

Lines changed: 0 additions & 4 deletions
Original file line numberDiff line numberDiff line change
@@ -41,7 +41,3 @@ target_link_libraries(test_odometry_utils ${library_name})
4141
ament_add_gtest(test_robot_utils test_robot_utils.cpp)
4242
ament_target_dependencies(test_robot_utils geometry_msgs)
4343
target_link_libraries(test_robot_utils ${library_name})
44-
45-
ament_add_gtest(test_base_footprint_publisher test_base_footprint_publisher.cpp)
46-
ament_target_dependencies(test_base_footprint_publisher geometry_msgs)
47-
target_link_libraries(test_base_footprint_publisher ${library_name})

nav2_util/test/test_base_footprint_publisher.cpp

Lines changed: 0 additions & 72 deletions
This file was deleted.

0 commit comments

Comments
 (0)