#include "ros/ros.h"
#include "quad_can_driver/Thrust.h"
#include "mav_msgs/Height.h"
#include "quad_height/pid_height.h"
#include <sensor_msgs/Imu.h>
#include <tf/transform_datatypes.h>
#include <std_msgs/Float64.h>
#include <std_msgs/Float32.h>
#include <math.h>
#include <geometry_msgs/Vector3Stamped.h>
#include "px_comm/OpticalFlow.h"
Go to the source code of this file.
Functions | |
void | desired_heightCallback (std_msgs::Float32 const &msg) |
void | heightCallback (const mav_msgs::Height &msg) |
void | imuCallback (sensor_msgs::Imu const &imu) |
int | main (int argc, char **argv) |
void | Ref_Generator (double t) |
Variables | |
ros::Publisher | Accz_pub |
ros::Publisher | desired_pub |
Height_str | Height |
bool | init_control = false |
bool | init_ref = false |
tfScalar | pitch |
double | RC |
Reference | Ref |
tfScalar | roll |
ros::Publisher | thrust_pub |
tfScalar | yaw |
ros::Publisher | zhat_pub |
void desired_heightCallback | ( | std_msgs::Float32 const & | msg | ) |
Definition at line 24 of file height_controller.cpp.
void heightCallback | ( | const mav_msgs::Height & | msg | ) |
Definition at line 35 of file height_controller.cpp.
void imuCallback | ( | sensor_msgs::Imu const & | imu | ) |
Definition at line 29 of file height_controller.cpp.
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 76 of file height_controller.cpp.
void Ref_Generator | ( | double | t | ) |
Definition at line 51 of file height_controller.cpp.
Definition at line 20 of file height_controller.cpp.
Definition at line 20 of file height_controller.cpp.
Definition at line 16 of file height_controller.cpp.
bool init_control = false |
Definition at line 22 of file height_controller.cpp.
bool init_ref = false |
Definition at line 22 of file height_controller.cpp.
Definition at line 17 of file height_controller.cpp.
double RC |
Definition at line 19 of file height_controller.cpp.
Definition at line 14 of file height_controller.cpp.
Definition at line 17 of file height_controller.cpp.
Definition at line 20 of file height_controller.cpp.
Definition at line 17 of file height_controller.cpp.
Definition at line 20 of file height_controller.cpp.