1 #ifndef SEGMENT_CONTROLLER_H 2 #define SEGMENT_CONTROLLER_H 6 #include <geometry_msgs/Twist.h> 7 #include <nav_msgs/Odometry.h> 8 #include <nav_msgs/Path.h> 48 void setPath(std::shared_ptr<std::vector<PathPoint>> _path);
62 void setSpeedParams(
float _max_v,
float _max_w);
69 void getSpeed(
float *_v,
float *_w);
75 void setGoalRadius(
float _r);
83 void setPID(
float _Kp,
float _Ki,
float _Kd);
89 void setState(state
s);
107 float normalizeAngle(
float _angle);
110 std::shared_ptr<std::vector<PathPoint>>
path_;
113 int pathCounter_ = 0;
114 bool plan_active =
false;
120 float goal_radius_ = 0.25;
129 #endif // CONTROLLER_NODE_H
struct velocity_controller::Point_t PathPoint
std::shared_ptr< std::vector< PathPoint > > path_
void update(const std::string &key, const XmlRpc::XmlRpcValue &v)
enum velocity_controller::state_t state
TFSIMD_FORCE_INLINE Vector3 absolute() const
std::vector< int > actualPreconditions
std::vector< PathPrecondition > precondition
struct velocity_controller::PathPrecondition_t PathPrecondition