Heifu_simple_waypoint.hpp
Go to the documentation of this file.
1 #ifndef HEIFU_SIMPLE_WAYPOINT_HPP
2 #define HEIFU_SIMPLE_WAYPOINT_HPP
3 
4 #include <ros/ros.h>
5 #include <ros/package.h>
6 #include <iterator>
7 #include <numeric>
8 #include <ctime>
9 #include <std_msgs/Empty.h>
10 #include <geometry_msgs/TwistStamped.h>
11 #include <geometry_msgs/Pose.h>
12 #include <geometry_msgs/PoseStamped.h>
13 #include <sensor_msgs/NavSatFix.h>
14 #include <tf/transform_listener.h>
15 #include <math.h>
16 #include <nav_msgs/Odometry.h>
18 #include <geographic_msgs/GeoPose.h>
19 
20 
21 namespace HSW
22 {
24  {
25  public:
26 
28  virtual ~Heifu_simple_waypoint (){};
29 
30  void run();
31 
32  private:
34 
35  // Subscribers
38 
39  // Publishers
43 
44  // Parameters
45  double paramNodeRate;
46 
47  // TF relation
50  geometry_msgs::TwistStamped msgVel;
51 
52  // Parameters
53  std_msgs::Empty emptyMsg;
54 
55  // Variables
56  geometry_msgs::PoseStamped currentPosition;
57 
58  // Functions
59  void cbOdomUAV(const geometry_msgs::PoseStampedConstPtr& msg);
60  void cbPoseCommander(const geometry_msgs::Pose& msg);
61  };
62 
63 }
64 
65 #endif
void cbPoseCommander(const geometry_msgs::Pose &msg)
geometry_msgs::TwistStamped msgVel
void cbOdomUAV(const geometry_msgs::PoseStampedConstPtr &msg)
geometry_msgs::PoseStamped currentPosition
tf::TransformListener tfListener


heifu_simple_waypoint
Author(s):
autogenerated on Tue Feb 2 2021 03:56:37