1 #include "header/visionInterfaceVision.h" 3 VisionInterfaceVision::VisionInterfaceVision(ros::NodeHandle nh, std::string robotName)
5 this->robotName = robotName;
6 this->topicRoot =
"/uwsim/Vision/";
7 std::cout <<
"[" << robotName <<
"][VISION_INTERFACE] Start"<<std::endl;
10 nh.advertise<geometry_msgs::TransformStamped>((topicRoot +
"holePose"), 1);
16 int VisionInterfaceVision::publishHoleTransform(Eigen::Matrix4d wThole){
18 geometry_msgs::TransformStamped wThole_ros;
19 wThole_ros.child_frame_id =
"hole";
20 wThole_ros.transform = CONV::transfMatrix_eigen2geomMsgs(wThole);
22 pubHoleTransform.publish(wThole_ros);