#include <Heifu_simple_waypoint.hpp>
Public Member Functions | |
Heifu_simple_waypoint () | |
void | run () |
virtual | ~Heifu_simple_waypoint () |
Private Member Functions | |
void | cbOdomUAV (const geometry_msgs::PoseStampedConstPtr &msg) |
void | cbPoseCommander (const geometry_msgs::Pose &msg) |
Private Attributes | |
geometry_msgs::PoseStamped | currentPosition |
std_msgs::Empty | emptyMsg |
geometry_msgs::TwistStamped | msgVel |
ros::NodeHandle | n |
double | paramNodeRate |
ros::Publisher | pubDesiredPosition |
ros::Publisher | pubMissionStart |
ros::Publisher | pubMissionStop |
ros::Subscriber | subOdomUAV |
ros::Subscriber | subPoseCommander |
tf::TransformListener | tfListener |
tf::StampedTransform | tfTransform |
Definition at line 23 of file Heifu_simple_waypoint.hpp.
Heifu_simple_waypoint::Heifu_simple_waypoint | ( | ) |
Definition at line 5 of file Heifu_simple_waypoint.cpp.
|
inlinevirtual |
Definition at line 28 of file Heifu_simple_waypoint.hpp.
|
private |
Definition at line 32 of file Heifu_simple_waypoint.cpp.
|
private |
Definition at line 38 of file Heifu_simple_waypoint.cpp.
void Heifu_simple_waypoint::run | ( | ) |
Definition at line 22 of file Heifu_simple_waypoint.cpp.
|
private |
Definition at line 56 of file Heifu_simple_waypoint.hpp.
|
private |
Definition at line 53 of file Heifu_simple_waypoint.hpp.
|
private |
Definition at line 50 of file Heifu_simple_waypoint.hpp.
|
private |
Definition at line 33 of file Heifu_simple_waypoint.hpp.
|
private |
Definition at line 45 of file Heifu_simple_waypoint.hpp.
|
private |
Definition at line 42 of file Heifu_simple_waypoint.hpp.
|
private |
Definition at line 40 of file Heifu_simple_waypoint.hpp.
|
private |
Definition at line 41 of file Heifu_simple_waypoint.hpp.
|
private |
Definition at line 36 of file Heifu_simple_waypoint.hpp.
|
private |
Definition at line 37 of file Heifu_simple_waypoint.hpp.
|
private |
Definition at line 48 of file Heifu_simple_waypoint.hpp.
|
private |
Definition at line 49 of file Heifu_simple_waypoint.hpp.