debug.h
Go to the documentation of this file.
00001 
00033 #ifndef __D_DEBUG__
00034 #define __D_DEBUG__
00035 
00036 #include <opencv/cv.h>
00037 #include <iostream>
00038 #include <string>
00039 #include <sstream>
00040 #include <fstream>
00041 #include <vector>
00042 
00043 #include "geometry_msgs/Point.h"
00044 
00045 using namespace std;
00046 
00047 class debug
00048 {
00049 public:
00050 
00051   // Creates a VRML file with the axis of the given transformation
00052   static void saveTscene(const cv::Mat &rTo, 
00053     const std::vector<geometry_msgs::Point> &wP3d,
00054     const std::string &filename);
00055 
00056 protected:
00057 
00058   // prints the VRML code for drawing a reference
00059   static void saveRef(fstream &f, const cv::Mat &wTr);
00060   
00061   // prints the VRML code for drawing a rectangle
00062   static void saveRectangle(fstream &f, const cv::Mat &wTr, float width, 
00063     float height);
00064   
00065   // prints the VRML code for drawing 3d points
00066   static void savePoints(fstream &f, 
00067     const std::vector<geometry_msgs::Point> &wP3d);
00068 
00069 };
00070 
00071 
00072 
00073 #endif


re_vision
Author(s): Dorian Galvez-Lopez
autogenerated on Sun Jan 5 2014 11:31:00