51 #include <geometry_msgs/Transform.h> 52 #include "visp_hand2eye_calibration/TransformArray.h" 56 #include <visp/vpCalibration.h> 57 #include <visp/vpExponentialMap.h> 71 =
n_.
serviceClient<visp_hand2eye_calibration::compute_effector_camera> (
74 =
n_.
serviceClient<visp_hand2eye_calibration::compute_effector_camera_quick> (
91 vpHomogeneousMatrix cMo;
92 vpHomogeneousMatrix wMe;
93 vpHomogeneousMatrix eMc;
96 vpTranslationVector etc(0.1, 0.2, 0.3);
98 erc[0] = vpMath::rad(10);
99 erc[1] = vpMath::rad(-10);
100 erc[2] = vpMath::rad(25);
102 eMc.buildFrom(etc, erc);
108 for (
int i = 0; i < N; i++)
114 cMo.buildFrom(0, 0, 0.5, 0, 0, 0);
115 wMe.buildFrom(0, 0, 0, 0, 0, 0);
128 vpHomogeneousMatrix cMc;
129 cMc = vpExponentialMap::direct(v_c);
133 cMo = cMc.inverse() * cMo;
134 wMe = wMe * eMc * cMc * eMc.inverse();
138 geometry_msgs::Transform pose_c_o;
140 geometry_msgs::Transform pose_w_e;
144 emc_quick_comm.request.camera_object.transforms.push_back(pose_c_o);
145 emc_quick_comm.request.world_effector.transforms.push_back(pose_w_e);
154 vpHomogeneousMatrix eMc;
169 vpHomogeneousMatrix eMc;
ServiceClient serviceClient(const std::string &service_name, bool persistent=false, const M_string &header_values=M_string())
std::string camera_object_topic
void publish(const boost::shared_ptr< M > &message) const
ros::ServiceClient reset_service_
visp_hand2eye_calibration::compute_effector_camera_quick emc_quick_comm
bool call(MReq &req, MRes &res)
std::string compute_effector_camera_service
std::string reset_service
ros::ServiceClient compute_effector_camera_quick_service_
void computeFromTopicStream()
std::string world_effector_topic
Publisher advertise(const std::string &topic, uint32_t queue_size, bool latch=false)
ros::ServiceClient compute_effector_camera_service_
geometry_msgs::Transform toGeometryMsgsTransform(const vpHomogeneousMatrix &mat)
void computeUsingQuickService()
#define ROS_INFO_STREAM(args)
Client node calling a quick compute service, a compute service and 2 publishing to world_effector_top...
visp_hand2eye_calibration::reset reset_comm
ros::Publisher world_effector_publisher_
std::string compute_effector_camera_quick_service
visp_hand2eye_calibration::compute_effector_camera emc_comm
ros::Publisher camera_object_publisher_