Skip to content

Commit 3d5b865

Browse files
committed
Merge pull request #4 from bulwahn/hydro-devel
make rostest in CMakeLists optional (ros/rosdistro#3010)
2 parents f4f2b31 + a4404ea commit 3d5b865

File tree

1 file changed

+3
-2
lines changed

1 file changed

+3
-2
lines changed

CMakeLists.txt

Lines changed: 3 additions & 2 deletions
Original file line numberDiff line numberDiff line change
@@ -10,8 +10,7 @@ tf sensor_msgs message_filters roscpp laser_geometry filters)
1010

1111
find_package(catkin REQUIRED COMPONENTS
1212
${THIS_PACKAGE_ROS_DEPS}
13-
message_generation
14-
rostest)
13+
message_generation)
1514
find_package(Boost REQUIRED COMPONENTS system signals)
1615
include_directories(include ${catkin_INCLUDE_DIRS} ${Boost_INCLUDE_DIRS})
1716

@@ -68,6 +67,8 @@ add_dependencies(point_cloud2_assembler ${PROJECT_NAME}_gencpp)
6867
## unit testing
6968

7069
if(CATKIN_ENABLE_TESTING)
70+
find_package(rostest)
71+
7172
add_executable(periodic_snapshotter examples/periodic_snapshotter.cpp)
7273
target_link_libraries(periodic_snapshotter ${catkin_LIBRARIES} ${Boost_LIBRARIES})
7374
add_dependencies(periodic_snapshotter ${PROJECT_NAME}_gencpp)

0 commit comments

Comments
 (0)