aruco_ros/include/aruco_ros/aruco_ros_utils.h
Go to the documentation of this file.
1 #ifndef ARUCO_ROS_UTILS_H
2 #define ARUCO_ROS_UTILS_H
3 
4 #include <aruco/aruco.h>
5 #include <sensor_msgs/CameraInfo.h>
7 
8 namespace aruco_ros
9 {
18  aruco::CameraParameters rosCameraInfo2ArucoCamParams(const sensor_msgs::CameraInfo& cam_info,
19  bool useRectifiedParameters);
20 
21  //FIXME: make parameter const as soon as the used function is also const
22  tf::Transform arucoMarker2Tf(const aruco::Marker& marker, bool rotate_marker_axis=true);
23 
24 }
25 #endif // ARUCO_ROS_UTILS_H
tf::Transform arucoMarker2Tf(const aruco::Marker &marker, bool rotate_marker_axis=true)
This class represents a marker. It is a vector of the fours corners ot the 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 ...


lidar_camera_calibration
Author(s):
autogenerated on Sat Feb 6 2021 03:39:37