camera_pose_calibration/CalibrationEstimate Message

File: camera_pose_calibration/CalibrationEstimate.msg

Header header
CameraPose[] cameras
geometry_msgs/Pose[] targets

Expanded Definition

Header header
    uint32 seq
    time stamp
    string frame_id
CameraPose[] cameras
    string camera_id
    geometry_msgs/Pose pose
        geometry_msgs/Point position
            float64 x
            float64 y
            float64 z
        geometry_msgs/Quaternion orientation
            float64 x
            float64 y
            float64 z
            float64 w
geometry_msgs/Pose[] targets
    geometry_msgs/Point position
        float64 x
        float64 y
        float64 z
    geometry_msgs/Quaternion orientation
        float64 x
        float64 y
        float64 z
        float64 w