aboutsummaryrefslogtreecommitdiff
path: root/CMakeLists.txt
diff options
context:
space:
mode:
authorLorenz Meier <lm@inf.ethz.ch>2014-10-06 08:12:41 -0700
committerLorenz Meier <lm@inf.ethz.ch>2014-10-06 08:12:41 -0700
commit3956a2c836df9aa411815b4a4027fdcfb864f041 (patch)
treee43a900957e49c14bf7cd2457770fbefd6a2d5d0 /CMakeLists.txt
parent3b2b280a41f093020eab1a8a8945603fb3ffacfb (diff)
downloadpx4-firmware-3956a2c836df9aa411815b4a4027fdcfb864f041.tar.gz
px4-firmware-3956a2c836df9aa411815b4a4027fdcfb864f041.tar.bz2
px4-firmware-3956a2c836df9aa411815b4a4027fdcfb864f041.zip
Baby steps towards PX4 ROS nodes
Diffstat (limited to 'CMakeLists.txt')
-rw-r--r--CMakeLists.txt4
1 files changed, 2 insertions, 2 deletions
diff --git a/CMakeLists.txt b/CMakeLists.txt
index d370c5a3f..144bdcbc3 100644
--- a/CMakeLists.txt
+++ b/CMakeLists.txt
@@ -80,7 +80,7 @@ generate_messages(
## CATKIN_DEPENDS: catkin_packages dependent projects also need
## DEPENDS: system dependencies of this project that dependent projects also need
catkin_package(
-# INCLUDE_DIRS include
+ INCLUDE_DIRS include
# LIBRARIES px4
# CATKIN_DEPENDS roscpp rospy std_msgs
# DEPENDS system_lib
@@ -92,7 +92,7 @@ catkin_package(
## Specify additional locations of header files
## Your package locations should be listed before other locations
-# include_directories(include)
+include_directories(include)
include_directories(
${catkin_INCLUDE_DIRS}
)