aruco_ros_utils.h
Go to the documentation of this file.
00001 #ifndef ARUCO_ROS_UTILS_H
00002 #define ARUCO_ROS_UTILS_H
00003 
00004 #include <aruco/aruco.h>
00005 #include <sensor_msgs/CameraInfo.h>
00006 #include <tf/transform_datatypes.h>
00007 
00008 namespace aruco_ros
00009 {
00018   aruco::CameraParameters rosCameraInfo2ArucoCamParams(const sensor_msgs::CameraInfo& cam_info,
00019                                                        bool useRectifiedParameters);
00020 
00021   //FIXME: make parameter const as soon as the used function is also const
00022   tf::Transform arucoMarker2Tf(const aruco::Marker& marker);
00023 
00024 }
00025 #endif // ARUCO_ROS_UTILS_H


aruco_ros
Author(s): Rafael Muñoz Salinas , Bence Magyar
autogenerated on Wed Jul 26 2017 02:17:27