velocity.h
Go to the documentation of this file.
1 #ifndef VELOCITY_H
2 #define VELOCITY_H
3 
4 #include <ros/ros.h>
5 #include <geometry_msgs/Point.h>
6 #include <geometry_msgs/Pose.h>
7 #include <geometry_msgs/Twist.h>
8 #include <geometry_msgs/TwistStamped.h>
9 #include "position.h"
10 #include "cpswarm_msgs/Vector.h"
11 
12 using namespace std;
13 using namespace ros;
14 
18 class velocity
19 {
20 public:
25  velocity (double altitude);
26 
30  ~velocity ();
31 
38  geometry_msgs::Vector3 compute_velocity (geometry_msgs::Point goal, double velocity);
39 
44  geometry_msgs::Vector3 get_velocity () const;
45 
50 
57 
64 
69 
74 
79 
84 
89 
94 
99 
A class to provide velocity related functionalities.
Definition: velocity.h:18


swarm_behaviors_velocity
Author(s):
autogenerated on Sat Feb 6 2021 03:11:35