File tree Expand file tree Collapse file tree 1 file changed +3
-2
lines changed Expand file tree Collapse file tree 1 file changed +3
-2
lines changed Original file line number Diff line number Diff line change @@ -10,8 +10,7 @@ tf sensor_msgs message_filters roscpp laser_geometry filters)
10
10
11
11
find_package (catkin REQUIRED COMPONENTS
12
12
${THIS_PACKAGE_ROS_DEPS}
13
- message_generation
14
- rostest)
13
+ message_generation)
15
14
find_package (Boost REQUIRED COMPONENTS system signals)
16
15
include_directories (include ${catkin_INCLUDE_DIRS} ${Boost_INCLUDE_DIRS} )
17
16
@@ -68,6 +67,8 @@ add_dependencies(point_cloud2_assembler ${PROJECT_NAME}_gencpp)
68
67
## unit testing
69
68
70
69
if (CATKIN_ENABLE_TESTING)
70
+ find_package (rostest)
71
+
71
72
add_executable (periodic_snapshotter examples/periodic_snapshotter.cpp)
72
73
target_link_libraries (periodic_snapshotter ${catkin_LIBRARIES} ${Boost_LIBRARIES} )
73
74
add_dependencies (periodic_snapshotter ${PROJECT_NAME} _gencpp)
You can’t perform that action at this time.
0 commit comments