6 #include <geometry_msgs/Twist.h> 7 #include <nav_msgs/Odometry.h> 8 #include <nav_msgs/Path.h> 41 void setPath(std::shared_ptr<std::vector<PathPoint>> _path);
55 void setSpeedParams(
float _max_v,
float _max_w);
62 void getSpeed(
float *_v,
float *_w);
68 void setGoalRadius(
float _r);
76 void setPID(
float _Kp,
float _Ki,
float _Kd);
82 void setState(state
s);
85 float normalizeAngle(
float _angle);
88 std::shared_ptr<std::vector<PathPoint>>
path_;
92 bool plan_active =
false;
98 float goal_radius_ = 0.25;
108 #endif // CONTROLLER_NODE_H
struct velocity_controller::Point_t PathPoint
void update(const std::string &key, const XmlRpc::XmlRpcValue &v)
std::vector< PathPoint >::iterator path_iterator_
enum velocity_controller::state_t state
TFSIMD_FORCE_INLINE Vector3 absolute() const
std::shared_ptr< std::vector< PathPoint > > path_