Classes | Typedefs | Functions
aruco_detect.cpp File Reference
#include <assert.h>
#include <sys/time.h>
#include <unistd.h>
#include <math.h>
#include <ros/ros.h>
#include <tf/transform_datatypes.h>
#include <tf2/LinearMath/Transform.h>
#include <tf2_ros/buffer.h>
#include <tf2_ros/transform_broadcaster.h>
#include <tf2_ros/transform_listener.h>
#include <tf2_geometry_msgs/tf2_geometry_msgs.h>
#include <visualization_msgs/Marker.h>
#include <image_transport/image_transport.h>
#include <cv_bridge/cv_bridge.h>
#include <sensor_msgs/image_encodings.h>
#include <dynamic_reconfigure/server.h>
#include <std_srvs/SetBool.h>
#include <std_msgs/String.h>
#include "fiducial_msgs/Fiducial.h"
#include "fiducial_msgs/FiducialArray.h"
#include "fiducial_msgs/FiducialTransform.h"
#include "fiducial_msgs/FiducialTransformArray.h"
#include "aruco_detect/DetectorParamsConfig.h"
#include <vision_msgs/Detection2D.h>
#include <vision_msgs/Detection2DArray.h>
#include <vision_msgs/ObjectHypothesisWithPose.h>
#include <opencv2/highgui.hpp>
#include <opencv2/aruco.hpp>
#include <opencv2/calib3d.hpp>
#include <list>
#include <string>
#include <boost/algorithm/string.hpp>
#include <boost/shared_ptr.hpp>
Include dependency graph for aruco_detect.cpp:

Go to the source code of this file.

Classes

class  FiducialsNode
 

Typedefs

typedef boost::shared_ptr< fiducial_msgs::FiducialArray const > FiducialArrayConstPtr
 

Functions

static double calcFiducialArea (const std::vector< cv::Point2f > &pts)
 
static double dist (const cv::Point2f &p1, const cv::Point2f &p2)
 
static double getReprojectionError (const vector< Point3f > &objectPoints, const vector< Point2f > &imagePoints, const Mat &cameraMatrix, const Mat &distCoeffs, const Vec3d &rvec, const Vec3d &tvec)
 
static void getSingleMarkerObjectPoints (float markerLength, vector< Point3f > &objPoints)
 Return object points for the system centered in a single marker, given the marker length. More...
 
int main (int argc, char **argv)
 

Typedef Documentation

typedef boost::shared_ptr< fiducial_msgs::FiducialArray const> FiducialArrayConstPtr

Definition at line 74 of file aruco_detect.cpp.

Function Documentation

static double calcFiducialArea ( const std::vector< cv::Point2f > &  pts)
static

Definition at line 175 of file aruco_detect.cpp.

static double dist ( const cv::Point2f &  p1,
const cv::Point2f &  p2 
)
static

Definition at line 160 of file aruco_detect.cpp.

static double getReprojectionError ( const vector< Point3f > &  objectPoints,
const vector< Point2f > &  imagePoints,
const Mat &  cameraMatrix,
const Mat &  distCoeffs,
const Vec3d &  rvec,
const Vec3d &  tvec 
)
static

Definition at line 199 of file aruco_detect.cpp.

static void getSingleMarkerObjectPoints ( float  markerLength,
vector< Point3f > &  objPoints 
)
static

Return object points for the system centered in a single marker, given the marker length.

Definition at line 147 of file aruco_detect.cpp.

int main ( int  argc,
char **  argv 
)

Definition at line 709 of file aruco_detect.cpp.



aruco_detect
Author(s): Jim Vaughan
autogenerated on Tue Jun 1 2021 03:03:28