Skip to content

Commit

Permalink
Comment that tf2_ros is used but intentionally not linked
Browse files Browse the repository at this point in the history
Signed-off-by: Shane Loretz <sloretz@osrfoundation.org>
  • Loading branch information
sloretz committed Jan 11, 2022
1 parent 1656569 commit 983cd0d
Showing 1 changed file with 4 additions and 1 deletion.
5 changes: 4 additions & 1 deletion tf2_geometry_msgs/CMakeLists.txt
Original file line number Diff line number Diff line change
Expand Up @@ -50,7 +50,10 @@ if(BUILD_TESTING)
if(TARGET test_tf2_geometry_msgs)
target_link_libraries(test_tf2_geometry_msgs
${PROJECT_NAME}
rclcpp::rclcpp)
rclcpp::rclcpp
# Used, but not linked to test ${PROJECT_NAME}'s exports:
# tf2_ros::tf2_ros
)
endif()
endif()

Expand Down

0 comments on commit 983cd0d

Please sign in to comment.