#include <algorithm>
#include <ros/ros.h>
#include <nodelet/nodelet.h>
#include <pluginlib/class_list_macros.h>
#include <diagnostic_updater/diagnostic_updater.h>
#include <diagnostic_updater/update_functions.h>
#include <string>
#include <angles/angles.h>
#include <tf/tf.h>
#include <tf/transform_listener.h>
#include <tf/transform_datatypes.h>
#include <nav_msgs/Odometry.h>
#include <Eigen/Eigen>
Go to the source code of this file.
Classes | |
class | flyer_est::Estimator |
Namespaces | |
namespace | flyer_est |
Functions | |
flyer_est::PLUGINLIB_DECLARE_CLASS (flyer_est, Estimator, flyer_est::Estimator, nodelet::Nodelet) | |
Variables | |
const double | flyer_est::VEL_FILT_A = 0.9 |
const double | flyer_est::VEL_FILT_B = 0.1 |