#include <mutex>#include <algorithm>#include <ros/ros.h>#include <opencv2/opencv.hpp>#include <sensor_msgs/CameraInfo.h>#include <tf2/LinearMath/Matrix3x3.h>#include <tf2/LinearMath/Quaternion.h>#include <tf2_eigen/tf2_eigen.h>#include <geometry_msgs/TransformStamped.h>#include <opencv2/core/eigen.hpp>

Go to the source code of this file.
Classes | |
| class | moveit_handeye_calibration::HandEyeTargetBase |
| Provides an interface for handeye calibration target detectors. A target used for handeye calibration is usually a 2D board that consists of an array of markers. The markers can be circles, rectangles or their combinations. More... | |
| class | moveit_handeye_calibration::HandEyeTargetBase::Parameter |
| union | moveit_handeye_calibration::HandEyeTargetBase::Parameter::Value |
Namespaces | |
| moveit_handeye_calibration | |