File tree Expand file tree Collapse file tree 1 file changed +8
-9
lines changed Expand file tree Collapse file tree 1 file changed +8
-9
lines changed Original file line number Diff line number Diff line change @@ -116,15 +116,14 @@ if(TARGET test_static_publisher)
116116 add_launch_test(test /static_publisher.launch.py)
117117endif ()
118118
119- # TODO (ahcorde): activate when tf2_bullet is merged
120- # ament_add_gtest(test_tf2_bullet test/test_tf2_bullet.cpp)
121- # if(TARGET test_tf2_bullet)
122- # ament_target_dependencies(test_tf2_bullet
123- # rclcpp
124- # tf2_bullet
125- # tf2_ros
126- # )
127- # endif()
119+ ament_add_gtest(test_tf2_bullet test /test_tf2_bullet.cpp)
120+ if (TARGET test_tf2_bullet)
121+ ament_target_dependencies(test_tf2_bullet
122+ rclcpp
123+ tf2_bullet
124+ tf2_ros
125+ )
126+ endif ()
128127#
129128# add_launch_test(test/test_buffer_client.launch.py)
130129# add_rostest(${CMAKE_CURRENT_SOURCE_DIR}/test/test_tf2_bullet.launch)
You can’t perform that action at this time.
0 commit comments