#include <mavros/mavros_plugin.h>
#include <mavros_msgs/Trajectory.h>
#include <mavros_msgs/PositionTarget.h>
#include <nav_msgs/Path.h>
#include <pluginlib/class_list_macros.h>
Go to the source code of this file.
Classes | |
class | mavros::extra_plugins::TrajectoryPlugin |
Trajectory plugin to receive planned path from the FCU and send back to the FCU a corrected path (collision free, smoothed) More... | |
Namespaces | |
mavros | |
mavros::extra_plugins | |
Typedefs | |
using | mavros::extra_plugins::MavPoints = std::array< float, NUM_POINTS > |
Type matching mavlink::common::msg::TRAJECTORY::TRAJECTORY_REPRESENTATION_WAYPOINTS fields. More... | |
using | mavros::extra_plugins::RosPoints = mavros_msgs::PositionTarget |
Variables | |
static constexpr size_t | mavros::extra_plugins::NUM_POINTS = 5 |
Points count in TRAJECTORY message. More... | |