AUV-Coop-Assembly
Master Thesis for Robotics Engineering. Cooperative peg-in-hole assembly with two underwater vehicles guided by vision
visionInterfaceVision.h
1 #ifndef VISIONINTERFACEVISION_H
2 #define VISIONINTERFACEVISION_H
3 
4 #include <iostream>
5 #include <ros/ros.h>
6 #include <geometry_msgs/TransformStamped.h>
7 #include <Eigen/Core>
8 
9 #include "../../support/header/conversions.h"
10 
11 
12 
14 {
15 public:
16  VisionInterfaceVision(ros::NodeHandle nh, std::string robotName);
17  int publishHoleTransform(Eigen::Matrix4d wThole);
18 
19 
20 private:
21  std::string robotName;
22  std::string topicRoot;
23  ros::Publisher pubHoleTransform;
24 
25 
26 };
27 
28 #endif // VISIONINTERFACEVISION_H