AUV-Coop-Assembly
Master Thesis for Robotics Engineering. Cooperative peg-in-hole assembly with two underwater vehicles guided by vision
coordInterfaceCoord_old.h
1 #ifndef COORDINTERFACECOORD_H
2 #define COORDINTERFACECOORD_H
3 
4 #include <iostream>
5 #include <vector>
6 #include <ros/ros.h>
7 #include <std_msgs/Bool.h>
8 #include <peg_msgs/toCoord.h>
9 #include <Eigen/Core>
10 #include "../../support/header/defines.h"
11 
17 {
18 public:
19  CoordInterfaceCoord(ros::NodeHandle nh, std::string robotName);
20  bool getReadyRob();
21  int getNonCoopCartVel(Eigen::Matrix<double, VEHICLE_DOF, 1> *nonCoopCartVel_eigen);
22  int getJJsharp(Eigen::Matrix<double, VEHICLE_DOF, VEHICLE_DOF> *admisVelTool_eigen);
23 
24 private:
25  std::string robotName;
26  bool readyRob;
27  ros::Subscriber readyRobSub;
28  ros::Subscriber subCoordFromMM;
29 
30  std::vector<double> tempXdot;
31  std::vector<double> tempJJsharp;
32 
33  void readyRobSubCallback(const std_msgs::Bool::ConstPtr& start);
34  void subCoordFromMMCallBack(const peg_msgs::toCoord::ConstPtr& msg);
35 
36 
37 };
38 
39 #endif // COORDINTERFACECOORD_H
The CoordInterfaceCoord class.