Calibration of camera transforms from a fixed AR tag on CARL. 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/Float64.h>

Go to the source code of this file.
Classes | |
| class | CameraExternalCalibration |
Defines | |
| #define | REQUIRED_SAMPLES 100 |
Functions | |
| int | main (int argc, char **argv) |
Calibration of camera transforms from a fixed AR tag on CARL.
Definition in file camera_external_calibration.h.
| #define REQUIRED_SAMPLES 100 |
Definition at line 19 of file camera_external_calibration.h.
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Creates and runs the camera_external_calibration node.
| argc | argument count that is passed to ros::init |
| argv | arguments that are passed to ros::init |
Definition at line 157 of file camera_external_calibration.cpp.