#include "ros/ros.h"
#include "geometry_msgs/Vector3Stamped.h"
#include <math.h>
#include "mav_msgs/Height.h"
#include <sensor_msgs/Imu.h>
#include <tf/transform_datatypes.h>
Go to the source code of this file.
Functions | |
void | calc_field_of_view (void) |
void | heightCallback (const mav_msgs::Height &msg) |
void | imuCallback (sensor_msgs::Imu const &imu) |
int | main (int argc, char **argv) |
void | OF_RawCallback (geometry_msgs::Vector3 const &msg) |
Variables | |
double | alpha |
double | current_height |
double | current_time |
double | delta_pitch |
double | delta_roll |
double | focal_length |
double | last_pitch |
double | last_roll |
double | last_time |
geometry_msgs::Vector3Stamped | OF |
ros::Publisher | OF_message |
btScalar | pitch |
double | raw_dx = 0 |
double | raw_dy = 0 |
btScalar | roll |
double | sum_of_x = 0 |
double | sum_of_y = 0 |
ros::Duration | t |
btScalar | yaw |
void calc_field_of_view | ( | void | ) |
void heightCallback | ( | const mav_msgs::Height & | msg | ) |
void imuCallback | ( | sensor_msgs::Imu const & | imu | ) |
void OF_RawCallback | ( | geometry_msgs::Vector3 const & | msg | ) |
double current_height |
double current_time |
double delta_pitch |
double delta_roll |
double focal_length |
double last_pitch |