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> 9 #include <tuw_multi_robot_msgs/RobotInfo.h> 49 void setPath(std::shared_ptr<std::vector<PathPoint>> _path);
63 void setSpeedParams(
float _max_v,
float _max_w);
70 void getSpeed(
float *_v,
float *_w);
76 void setGoalRadius(
float _r);
84 void setPID(
float _Kp,
float _Ki,
float _Kd);
90 void setState(state
s);
107 void setOrderId(
int);
109 void setOrderStatus(
int);
110 int getOrderStatus();
116 float normalizeAngle(
float _angle);
117 float absolute(
float _val);
119 std::shared_ptr<std::vector<PathPoint>>
path_;
122 int pathCounter_ = 0;
123 bool plan_active =
false;
129 float goal_radius_ = 0.25;
131 int robot_status = tuw_multi_robot_msgs::RobotInfo::STATUS_STOPPED;
143 #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
std::vector< int > actualPreconditions
std::vector< PathPrecondition > precondition
struct velocity_controller::PathPrecondition_t PathPrecondition