Skip to content

Commit

Permalink
more improvements
Browse files Browse the repository at this point in the history
Signed-off-by: Alejandro Hernández Cordero <[email protected]>
  • Loading branch information
ahcorde committed Jun 28, 2024
1 parent 966649e commit 0d70b99
Showing 1 changed file with 1 addition and 2 deletions.
3 changes: 1 addition & 2 deletions turtle_tf2_cpp/CMakeLists.txt
Original file line number Diff line number Diff line change
Expand Up @@ -70,8 +70,7 @@ target_link_libraries(fixed_frame_tf2_broadcaster PRIVATE
)

add_executable(dynamic_frame_tf2_broadcaster src/dynamic_frame_tf2_broadcaster.cpp)
target_link_libraries(
dynamic_frame_tf2_broadcaster
target_link_libraries(dynamic_frame_tf2_broadcaster PRIVATE
${geometry_msgs_TARGETS}
rclcpp::rclcpp
tf2_ros::tf2_ros
Expand Down

0 comments on commit 0d70b99

Please sign in to comment.