This file implements a camera used for projecting points and computing homographies. More...
#include "Alvar.h"
#include "Pose.h"
#include "Util.h"
#include "FileFormat.h"
#include <vector>
#include <ros/ros.h>
#include <ros/package.h>
#include <ros/console.h>
#include <geometry_msgs/TransformStamped.h>
#include <image_transport/image_transport.h>
#include <sensor_msgs/CameraInfo.h>
#include <visualization_msgs/Marker.h>
#include <resource_retriever/retriever.h>
Go to the source code of this file.
Classes | |
class | alvar::Camera |
Simple Camera class for calculating distortions, orientation or projections with pre-calibrated camera. More... | |
struct | alvar::Homography |
Simple Homography class for finding and projecting points between two planes. More... | |
struct | alvar::ProjPoints |
Simple structure for collecting 2D and 3D points e.g. for camera calibration. More... | |
Namespaces | |
namespace | alvar |
Main ALVAR namespace. |
This file implements a camera used for projecting points and computing homographies.
Definition in file Camera.h.