#include <sys/socket.h>
#include <netinet/in.h>
#include <errno.h>
#include <thread>
#include "ros/ros.h"
#include "std_msgs/String.h"
#include "mavros_msgs/State.h"
#include "mavros_msgs/ManualControl.h"
#include "mavros_msgs/Mavlink.h"
Go to the source code of this file.
Classes | |
struct | ControlMessage |
class | RC |
Functions | |
struct ControlMessage | __attribute__ ((packed)) |
int | main (int argc, char **argv) |
Variables | |
class RC | __attribute__ |
int16_t | r |
int16_t | x |
int16_t | y |
int16_t | z |
struct ControlMessage __attribute__ | ( | (packed) | ) |
class RC __attribute__ |