Skip to content

Commit

Permalink
Format pcl_recorder/CMakeLists.txt
Browse files Browse the repository at this point in the history
  • Loading branch information
FelipeGdM committed Nov 21, 2023
1 parent 91090fe commit cde5555
Showing 1 changed file with 8 additions and 2 deletions.
10 changes: 8 additions & 2 deletions pcl_recorder/CMakeLists.txt
Original file line number Diff line number Diff line change
Expand Up @@ -65,8 +65,14 @@ elseif(${ROS_VERSION} EQUAL 2)

add_executable(${PROJECT_NAME}_node src/PclRecorderROS2.cpp src/mainROS2.cpp)

ament_target_dependencies(${PROJECT_NAME}_node rclcpp sensor_msgs
pcl_conversions tf2 tf2_ros tf2_eigen)
ament_target_dependencies(
${PROJECT_NAME}_node
rclcpp
sensor_msgs
pcl_conversions
tf2
tf2_ros
tf2_eigen)

target_link_libraries(${PROJECT_NAME}_node ${Boost_SYSTEM_LIBRARY}
${PCL_LIBRARIES})
Expand Down

0 comments on commit cde5555

Please sign in to comment.