Pose estimation node of the drone (x,y,z,theta,phi,psi) in an absolute coordinate frame. At the present: on the basis of the Odometry received from ardrone_autonomy and Visual pose estimation from the mapping node In future developpment: Kalman filters, visual odometry, raw sensors, etc. More...
#include <ucl_drone/ucl_drone.h>
#include <ucl_drone/profiling.h>
#include <ardrone_autonomy/Navdata.h>
#include <ros/ros.h>
#include <signal.h>
#include <tf/transform_broadcaster.h>
#include <tf/transform_datatypes.h>
#include <tf/transform_listener.h>
#include <queue>
#include <nav_msgs/Odometry.h>
#include <sensor_msgs/Imu.h>
#include <std_msgs/Empty.h>
#include <std_srvs/Empty.h>
#include <ucl_drone/Pose3D.h>
Go to the source code of this file.
Classes | |
class | PoseEstimator |
Pose estimation node of the drone (x,y,z,theta,phi,psi) in an absolute coordinate frame. At the present: on the basis of the Odometry received from ardrone_autonomy and Visual pose estimation from the mapping node In future developpment: Kalman filters, visual odometry, raw sensors, etc.
Part of ucl_drone. Pose estimation ROS node for the ardrone.
Definition in file pose_estimation.h.