Controller for the ardrone: performs position control. More...
#include <ros/ros.h>
#include <signal.h>
#include <ucl_drone/ucl_drone.h>
#include <ucl_drone/profiling.h>
#include <geometry_msgs/Twist.h>
#include <std_msgs/Empty.h>
#include <ucl_drone/Pose3D.h>
#include <ucl_drone/PoseRef.h>
#include <std_srvs/Empty.h>
Go to the source code of this file.
Classes | |
class | BasicController |
A basic position controller. More... |
Controller for the ardrone: performs position control.
Part of ucl_drone. Controller ROS node for the ardrone. Contains:
Definition in file controller.h.