ros: mavlink node: add mavconn link

This commit is contained in:
Thomas Gubler 2015-02-10 23:34:26 +01:00
parent 2d0c5616cb
commit 001575e740
4 changed files with 9 additions and 1 deletions

View File

@ -3,6 +3,7 @@ project(px4)
set(CMAKE_CXX_FLAGS "${CMAKE_CXX_FLAGS} -std=c++11")
add_definitions(-D__PX4_ROS)
add_definitions(-D__EXPORT=)
add_definitions(-DMAVLINK_DIALECT=common)
## Find catkin macros and libraries
## if COMPONENTS list like find_package(catkin REQUIRED COMPONENTS xyz)
@ -16,6 +17,7 @@ find_package(catkin REQUIRED COMPONENTS
gazebo_msgs
sensor_msgs
mav_msgs
libmavconn
)
find_package(Eigen REQUIRED)
@ -109,7 +111,7 @@ generate_messages(
catkin_package(
INCLUDE_DIRS src/include
LIBRARIES px4
CATKIN_DEPENDS message_runtime roscpp rospy std_msgs
CATKIN_DEPENDS message_runtime roscpp rospy std_msgs libmavconn
DEPENDS system_lib
)

View File

@ -44,10 +44,12 @@
<build_depend>rospy</build_depend>
<build_depend>std_msgs</build_depend>
<build_depend>eigen</build_depend>
<build_depend>libmavconn</build_depend>
<run_depend>roscpp</run_depend>
<run_depend>rospy</run_depend>
<run_depend>std_msgs</run_depend>
<run_depend>eigen</run_depend>
<run_depend>libmavconn</run_depend>
<!-- The export tag contains other, unspecified, tags -->

View File

@ -49,6 +49,8 @@ using namespace px4;
Mavlink::Mavlink() :
_n()
{
_link = mavconn::MAVConnInterface::open_url("udp://localhost:14551@localhost:14552");
}
int main(int argc, char **argv)

View File

@ -41,6 +41,7 @@
*/
#include "ros/ros.h"
#include <mavconn/interface.h>
namespace px4
{
@ -55,6 +56,7 @@ public:
protected:
ros::NodeHandle _n;
mavconn::MAVConnInterface::Ptr _link;
};
}