Functions | Variables
main.cpp File Reference
#include <ros/ros.h>
#include <image_transport/image_transport.h>
#include <cv_bridge/cv_bridge.h>
#include <sensor_msgs/image_encodings.h>
#include <opencv2/imgproc/imgproc.hpp>
#include <opencv2/highgui/highgui.hpp>
#include <geometry_msgs/PoseStamped.h>
#include "aruco/aruco.h"
#include "aruco/cvdrawingutils.h"
#include "MarkersConfig.h"
#include <iostream>
#include <fstream>
#include <sstream>
#include <tf/transform_broadcaster.h>
Include dependency graph for main.cpp:

Go to the source code of this file.

Functions

void imageCallback (const sensor_msgs::ImageConstPtr &original_image)
int main (int argc, char **argv)

Variables

std::string _camera_image
geometry_msgs::PoseStamped camera_pose_mean
MarkersConfig Markers_Sizes
MarkerDetector MDetector
image_transport::Publisher pub_img
ros::Publisher pub_pixels_disp
ros::Publisher pub_pose
ros::Publisher pub_pose_all
geometry_msgs::PoseStamped t_camera_pose
geometry_msgs::PointStamped t_pixel_disp
CameraParameters TheCameraParameters
Mat TheInputImage
Mat TheInputImageCopy
vector< MarkerTheMarkers
double TheMarkerSize = 0.057
bool want2watch = 0
string watch = ""
static const char WINDOW [] = "Image Processed"

Function Documentation

void imageCallback ( const sensor_msgs::ImageConstPtr &  original_image)

The publish() function is how you send messages. The parameter is the message object. The type of this object must agree with the type given as a template parameter to the advertise<>() call, as was done in the constructor in main().

Definition at line 63 of file main.cpp.

int main ( int  argc,
char **  argv 
)

Definition at line 273 of file main.cpp.


Variable Documentation

std::string _camera_image

Definition at line 40 of file main.cpp.

geometry_msgs::PoseStamped camera_pose_mean

Definition at line 59 of file main.cpp.

Definition at line 58 of file main.cpp.

Definition at line 32 of file main.cpp.

image_transport::Publisher pub_img

Definition at line 55 of file main.cpp.

Definition at line 57 of file main.cpp.

Definition at line 56 of file main.cpp.

Definition at line 56 of file main.cpp.

geometry_msgs::PoseStamped t_camera_pose

Definition at line 36 of file main.cpp.

geometry_msgs::PointStamped t_pixel_disp

Definition at line 37 of file main.cpp.

Definition at line 35 of file main.cpp.

Definition at line 34 of file main.cpp.

Definition at line 34 of file main.cpp.

vector<Marker> TheMarkers

Definition at line 33 of file main.cpp.

double TheMarkerSize = 0.057

Definition at line 31 of file main.cpp.

bool want2watch = 0

Definition at line 44 of file main.cpp.

string watch = ""

Definition at line 45 of file main.cpp.

const char WINDOW[] = "Image Processed" [static]

Definition at line 52 of file main.cpp.



camera_pose_aruco
Author(s): tcarreira
autogenerated on Mon Jan 6 2014 11:47:56