PX4 simulation stack
Functions | Variables
offb_node.cpp File Reference
#include <ros/ros.h>
#include <geometry_msgs/PoseStamped.h>
#include <mavros_msgs/CommandBool.h>
#include <mavros_msgs/SetMode.h>
#include <mavros_msgs/State.h>
#include <mavros_msgs/CommandTOL.h>
Include dependency graph for offb_node.cpp:

Go to the source code of this file.

Functions

void state_cb (const mavros_msgs::State::ConstPtr &msg)
 
int main (int argc, char **argv)
 

Variables

mavros_msgs::State current_state
 

Function Documentation

int main ( int  argc,
char **  argv 
)

Definition at line 14 of file offb_node.cpp.

void state_cb ( const mavros_msgs::State::ConstPtr &  msg)

Definition at line 10 of file offb_node.cpp.

Variable Documentation

mavros_msgs::State current_state

Definition at line 8 of file offb_node.cpp.