External camera calibration from an AR tag with known position on the CARL robot. More...
#include <ros/ros.h>
#include <ar_track_alvar_msgs/AlvarMarkers.h>
#include <geometry_msgs/Pose.h>
#include <tf/transform_broadcaster.h>
#include <tf/transform_listener.h>
#include <std_msgs/Int16.h>
#include <fstream>
Go to the source code of this file.
Classes | |
class | CalibrationFromCarl |
Defines | |
#define | CAMERA_LINK_NAME "calibration_ceiling_camera_" |
#define | REQUIRED_SAMPLES 25 |
Functions | |
int | main (int argc, char **argv) |
External camera calibration from an AR tag with known position on the CARL robot.
Definition in file calibration_from_carl.h.
#define CAMERA_LINK_NAME "calibration_ceiling_camera_" |
Definition at line 24 of file calibration_from_carl.h.
#define REQUIRED_SAMPLES 25 |
Definition at line 26 of file calibration_from_carl.h.
int main | ( | int | argc, |
char ** | argv | ||
) |
Creates and runs the calibration_from_carl node.
argc | argument count that is passed to ros::init |
argv | arguments that are passed to ros::init |
Creates and runs the calibration node.
argc | argument count that is passed to ros::init |
argv | arguments that are passed to ros::init |
Definition at line 254 of file calibration.cpp.