couple of dependency fixes
This commit is contained in:
parent
4234f895f8
commit
4e6a2a7d43
|
@ -11,6 +11,7 @@ set (BOOST_INCLUDEDIR "/usr/include")
|
||||||
find_package(catkin REQUIRED COMPONENTS
|
find_package(catkin REQUIRED COMPONENTS
|
||||||
roscpp
|
roscpp
|
||||||
std_msgs
|
std_msgs
|
||||||
|
mavros_msgs
|
||||||
)
|
)
|
||||||
|
|
||||||
## System dependencies are found with CMake's conventions
|
## System dependencies are found with CMake's conventions
|
||||||
|
@ -37,7 +38,7 @@ find_package(catkin REQUIRED COMPONENTS
|
||||||
catkin_package(
|
catkin_package(
|
||||||
INCLUDE_DIRS include
|
INCLUDE_DIRS include
|
||||||
# LIBRARIES xbee_ros_node
|
# LIBRARIES xbee_ros_node
|
||||||
CATKIN_DEPENDS roscpp std_msgs
|
CATKIN_DEPENDS roscpp std_msgs mavros_msgs
|
||||||
# DEPENDS system_lib
|
# DEPENDS system_lib
|
||||||
)
|
)
|
||||||
|
|
||||||
|
|
|
@ -13,6 +13,9 @@
|
||||||
<build_depend>std_msgs</build_depend>
|
<build_depend>std_msgs</build_depend>
|
||||||
<run_depend>roscpp</run_depend>
|
<run_depend>roscpp</run_depend>
|
||||||
<run_depend>std_msgs</run_depend>
|
<run_depend>std_msgs</run_depend>
|
||||||
|
|
||||||
|
<build_depend>mavros_msgs</build_depend>
|
||||||
|
<run_depend>mavros_msgs</run_depend>
|
||||||
|
|
||||||
<export>
|
<export>
|
||||||
</export>
|
</export>
|
||||||
|
|
|
@ -8,7 +8,7 @@
|
||||||
#include <stdlib.h>
|
#include <stdlib.h>
|
||||||
#include <time.h>
|
#include <time.h>
|
||||||
|
|
||||||
#include<mavros_msgs/Mavlink.h>
|
#include <mavros_msgs/Mavlink.h>
|
||||||
#include <ros/ros.h>
|
#include <ros/ros.h>
|
||||||
|
|
||||||
|
|
||||||
|
|
Reference in New Issue