32 #ifndef ROSFLIGHT_COMMON_JOY_JOY_H    33 #define ROSFLIGHT_COMMON_JOY_JOY_H    35 #include <gazebo_msgs/ModelState.h>    37 #include <rosflight_msgs/Command.h>    38 #include <sensor_msgs/Joy.h>   104   bool override_autopilot_ = 
true;
   129   void PauseSimulation();
   130   void ResumeSimulation();
   132   void JoyCallback(
const sensor_msgs::JoyConstPtr &msg);
   133   void APCommandCallback(
const rosflight_msgs::CommandConstPtr &msg);
   140 #endif // ROSFLIGHT_COMMON_JOY_JOY_H 
double current_y_setpoint_
sensor_msgs::Joy current_joy_
geometry_msgs::Twist reset_twist_
rosflight_msgs::Command command_msg_
ros::Subscriber autopilot_command_sub_
double equilibrium_thrust_
double current_x_setpoint_
ros::Publisher command_pub_
double current_yaw_setpoint_
std::string autopilot_command_topic_
double current_altitude_setpoint_
rosflight_msgs::Command autopilot_command_
sensor_msgs::Joy::_buttons_type ButtonType
geometry_msgs::Pose reset_pose_
std::string command_topic_