Skip to content

Commit

Permalink
fix catkin make errors
Browse files Browse the repository at this point in the history
  • Loading branch information
jack-oquin committed Mar 9, 2013
1 parent 3842cd6 commit c9b77fd
Showing 1 changed file with 0 additions and 3 deletions.
3 changes: 0 additions & 3 deletions CMakeLists.txt
Expand Up @@ -5,15 +5,12 @@ find_package(catkin REQUIRED COMPONENTS message_generation std_msgs)
# We want boost/format.hpp, which isn't in its own component.
find_package(Boost REQUIRED)

include_directories(include)

add_message_files(
DIRECTORY msg
FILES AckermannDrive.msg AckermannDriveStamped.msg)

generate_messages(DEPENDENCIES std_msgs)

catkin_package(
INCLUDE_DIRS include
CATKIN_DEPENDS message_runtime std_msgs
DEPENDS Boost)

0 comments on commit c9b77fd

Please sign in to comment.