37 double degreesToRadiant =M_PI/180.0;
38 Eigen::Translation<double, 3> translation(0.102046, 0.00162421, 0.101897);
39 Eigen::Affine3d rotationA(Eigen::AngleAxisd(77.75461941777554*degreesToRadiant, Eigen::Vector3d(0, 0, 1.0)));
40 Eigen::Affine3d rotationB(Eigen::AngleAxisd(-90.30507946507706*degreesToRadiant, Eigen::Vector3d(0.0, 1.0, 0.0)));
41 Eigen::Affine3d rotationC(Eigen::AngleAxisd(-77.27385977970101*degreesToRadiant, Eigen::Vector3d(1.0, 0, 0.0)));
47 Eigen::Affine3d temp = translation * rotationA *rotationB * rotationC;
59 Eigen::Affine3d rotationZ(Eigen::AngleAxisd(rotZ, Eigen::Vector3d(0, 0, 1.0)));
60 Eigen::Translation<double, 3> translation(transX, 0.0, transZ);
61 Eigen::Affine3d rotationX(Eigen::AngleAxisd(rotX, Eigen::Vector3d(1.0, 0, 0)));
62 return rotationZ * translation * rotationX;
EIGEN_MAKE_ALIGNED_OPERATOR_NEW Calibration_Object()
double marker_left_transformation_z
double marker_left_rotation_z
Eigen::Affine3d getDHTransformation(double rotZ, double transZ, double rotX, double transX)
double marker_left_transformation_x
Eigen::Matrix4d frame_marker_left
double marker_left_rotation_x
double marker_right_transformation_z
Eigen::Matrix4d frame_marker_right
double marker_right_rotation_z
void calculateTransformationFrames()
double marker_right_rotation_x
double marker_right_transformation_x