Skip to content

Commit

Permalink
Fix problem introduced with the merge
Browse files Browse the repository at this point in the history
  • Loading branch information
j-rivero committed Feb 13, 2017
1 parent 97ac7d6 commit 0a5763a
Showing 1 changed file with 17 additions and 18 deletions.
35 changes: 17 additions & 18 deletions gazebo_plugins/CMakeLists.txt
Original file line number Diff line number Diff line change
Expand Up @@ -4,24 +4,23 @@ project(gazebo_plugins)
option(ENABLE_DISPLAY_TESTS "Enable the building of tests that requires a display" OFF)

find_package(catkin REQUIRED COMPONENTS
message_generation
gazebo_msgs
roscpp
rospy
nodelet
angles
std_srvs
geometry_msgs
sensor_msgs
nav_msgs
urdf
tf
tf2_ros
dynamic_reconfigure
driver_base
rosgraph_msgs
trajectory_msgs
image_transport
message_generation
gazebo_msgs
roscpp
rospy
nodelet
angles
std_srvs
geometry_msgs
sensor_msgs
nav_msgs
urdf
tf
tf2_ros
dynamic_reconfigure
rosgraph_msgs
trajectory_msgs
image_transport
rosconsole
cv_bridge
polled_camera
Expand Down

0 comments on commit 0a5763a

Please sign in to comment.