#include <debug.h>
Static Public Member Functions | |
static void | saveTscene (const cv::Mat &rTo, const std::vector< geometry_msgs::Point > &wP3d, const std::string &filename) |
Static Protected Member Functions | |
static void | savePoints (fstream &f, const std::vector< geometry_msgs::Point > &wP3d) |
static void | saveRectangle (fstream &f, const cv::Mat &wTr, float width, float height) |
static void | saveRef (fstream &f, const cv::Mat &wTr) |
void debug::savePoints | ( | fstream & | f, |
const std::vector< geometry_msgs::Point > & | wP3d | ||
) | [static, protected] |
void debug::saveRectangle | ( | fstream & | f, |
const cv::Mat & | wTr, | ||
float | width, | ||
float | height | ||
) | [static, protected] |
void debug::saveRef | ( | fstream & | f, |
const cv::Mat & | wTr | ||
) | [static, protected] |
void debug::saveTscene | ( | const cv::Mat & | rTo, |
const std::vector< geometry_msgs::Point > & | wP3d, | ||
const std::string & | filename | ||
) | [static] |