19 #ifndef ROBOT_CALIBRATION_MODELS_CAMERA3D_H 20 #define ROBOT_CALIBRATION_MODELS_CAMERA3D_H 47 virtual std::vector<geometry_msgs::PointStamped>
project(
48 const robot_calibration_msgs::CalibrationData& data,
54 #endif // ROBOT_CALIBRATION_MODELS_CAMERA3D_H
Combined parser and configuration for calibration offsets. Holds the configuration of what is to be c...
Camera3dModel(const std::string &name, KDL::Tree model, std::string root, std::string tip)
Create a new camera 3d model (Kinect/Primesense).
Calibration code lives under this namespace.
Model of a camera on a kinematic chain.
virtual std::vector< geometry_msgs::PointStamped > project(const robot_calibration_msgs::CalibrationData &data, const CalibrationOffsetParser &offsets)
Compute the updated positions of the observed points.
Model of a kinematic chain. This is the basic instance where we transform the world observations into...