#include <ros/ros.h>
#include <signal.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 <ucl_drone/StrategyMsg.h>
#include <ucl_drone/ucl_drone.h>
#include <ucl_drone/cellUpdate.h>
Go to the source code of this file.
Classes | |
class | PathPlanning |
the reference position to the drone
Part of ucl_drone. Controller ROS node for the ardrone. Contains:
Definition in file path_planning.h.