Functions | |
tf::Transform | arucoMarker2Tf (const aruco::Marker &marker, bool rotate_marker_axis=true) |
tf::Transform | arucoMarker2Tf (const aruco::Marker &marker) |
aruco::CameraParameters | rosCameraInfo2ArucoCamParams (const sensor_msgs::CameraInfo &cam_info, bool useRectifiedParameters) |
rosCameraInfo2ArucoCamParams gets the camera intrinsics from a CameraInfo message and copies them to aruco_ros own data structure More... | |
tf::Transform aruco_ros::arucoMarker2Tf | ( | const aruco::Marker & | marker, |
bool | rotate_marker_axis = true |
||
) |
Definition at line 45 of file aruco_ros/src/aruco_ros_utils.cpp.
tf::Transform aruco_ros::arucoMarker2Tf | ( | const aruco::Marker & | marker | ) |
Definition at line 45 of file old/aruco_ros/src/aruco_ros_utils.cpp.
aruco::CameraParameters aruco_ros::rosCameraInfo2ArucoCamParams | ( | const sensor_msgs::CameraInfo & | cam_info, |
bool | useRectifiedParameters | ||
) |
rosCameraInfo2ArucoCamParams gets the camera intrinsics from a CameraInfo message and copies them to aruco_ros own data structure
cam_info | |
useRectifiedParameters | if true, the intrinsics are taken from cam_info.P and the distortion parameters are set to 0. Otherwise, cam_info.K and cam_info.D are taken. |
Definition at line 7 of file aruco_ros/src/aruco_ros_utils.cpp.