Skip to content

Commit

Permalink
Merge pull request #4 from bulwahn/hydro-devel
Browse files Browse the repository at this point in the history
make rostest in CMakeLists optional (ros/rosdistro#3010)
  • Loading branch information
vrabaud committed Jan 18, 2015
2 parents f4f2b31 + a4404ea commit 3d5b865
Showing 1 changed file with 3 additions and 2 deletions.
5 changes: 3 additions & 2 deletions CMakeLists.txt
Original file line number Diff line number Diff line change
Expand Up @@ -10,8 +10,7 @@ tf sensor_msgs message_filters roscpp laser_geometry filters)

find_package(catkin REQUIRED COMPONENTS
${THIS_PACKAGE_ROS_DEPS}
message_generation
rostest)
message_generation)
find_package(Boost REQUIRED COMPONENTS system signals)
include_directories(include ${catkin_INCLUDE_DIRS} ${Boost_INCLUDE_DIRS})

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

if(CATKIN_ENABLE_TESTING)
find_package(rostest)

add_executable(periodic_snapshotter examples/periodic_snapshotter.cpp)
target_link_libraries(periodic_snapshotter ${catkin_LIBRARIES} ${Boost_LIBRARIES})
add_dependencies(periodic_snapshotter ${PROJECT_NAME}_gencpp)
Expand Down

0 comments on commit 3d5b865

Please sign in to comment.