1 #ifndef COORDINTERFACEMISSMAN_H 2 #define COORDINTERFACEMISSMAN_H 7 #include <geometry_msgs/TwistStamped.h> 8 #include <geometry_msgs/Vector3Stamped.h> 9 #include <peg_msgs/toCoord.h> 10 #include <peg_msgs/transformMat.h> 11 #include <std_msgs/Bool.h> 13 #include "../../support/header/defines.h" 24 bool getStartFromCoord();
25 void pubIamReadyOrNot(
bool ready);
27 int publishToCoord(Eigen::Matrix<double, VEHICLE_DOF, 1> nonCoopCartVel_eigen,
28 Eigen::Matrix<double, VEHICLE_DOF, VEHICLE_DOF> admisVelTool_eigen);
30 int getCoopCartVel(Eigen::Matrix<double, VEHICLE_DOF, 1> *coopCartVel_eigen);
36 std::string robotName;
38 ros::Publisher readyPub;
40 ros::Subscriber startSub;
42 void startSubCallback(
const std_msgs::Bool::ConstPtr& start);
45 ros::Publisher pubToCoord;
46 peg_msgs::toCoord toCoordMsg;
48 ros::Subscriber coopVelSub;
49 std::vector<double> tempCoopVel;
50 void subMMFromCoordCallBack(
const geometry_msgs::TwistStamped& msg);
53 geometry_msgs::Vector3 updatedPosLin;
54 std::vector<double> updatedPosAng;
55 ros::Subscriber subUpdatedGoal;
56 void subUpdatedGoalCallback(
const peg_msgs::transformMat::ConstPtr &msg);
58 bool updateGoalArrived;
63 #endif // COORDINTERFACEMISSMAN_H int getUpdatedGoal(Eigen::Matrix4d *wTgoalTool_eigen)
change goal thingss
The CoordInterface class class to deal with ros comunications (pub/sub) from MissionManager node to C...
int publishToCoord(Eigen::Matrix< double, VEHICLE_DOF, 1 > nonCoopCartVel_eigen, Eigen::Matrix< double, VEHICLE_DOF, VEHICLE_DOF > admisVelTool_eigen)
CoordInterface::publishToCoord publish the necessary thing to the coordinator node.
CoordInterfaceMissMan(ros::NodeHandle nh, std::string robotName)