#include <ros/ros.h>#include <image_transport/image_transport.h>#include <opencv/cv.h>#include <opencv/highgui.h>#include <cv_bridge/CvBridge.h>#include <ar_recog/Tag.h>#include <ar_recog/Tags.h>#include <ar_recog/CalibrateDistance.h>#include <math.h>#include <AR/ar.h>#include <AR/video.h>#include <AR/matrix.h>#include "object.h"#include <iostream>
Go to the source code of this file.
Defines | |
| #define | THRESH 100 |
| #define | THRESH_RANGE_LIMIT 40 |
| #define | THRESH_VARIATION 5 |
Functions | |
| bool | calibrateDistance (ar_recog::CalibrateDistance::Request &req, ar_recog::CalibrateDistance::Response &resp) |
| IplImage * | drawHistogram (IplImage *img) |
| void | handleImage (const sensor_msgs::ImageConstPtr &in, const sensor_msgs::CameraInfoConstPtr &camera_info) |
| void | handleRawImage (const sensor_msgs::ImageConstPtr &in) |
| void | init (int width, int height) |
| void | localThreshold (Mat &img, Mat &dst, double k, int window) |
| int | main (int argc, char **argv) |
Variables | |
| image_transport::Publisher | ar_hist |
| image_transport::Publisher | ar_img |
| bool | ar_smooth = true |
| ARParam | cparam |
| char | cparam_name [65536] |
| double | haov |
| int | kThresh = 1 |
| int | last_reported_distance |
| char | model_name [65536] |
| ObjectData_T * | object |
| int | objectnum |
| double | patt_trans [3][4] |
| int | sign = 1 |
| ros::Publisher | tags_pub |
| int | thresh = THRESH |
| int | threshVariation = THRESH_VARIATION |
| bool | using_rectified_images |
| double | vaov |
| #define THRESH 100 |
Definition at line 25 of file ar_recog.cpp.
| #define THRESH_RANGE_LIMIT 40 |
Definition at line 27 of file ar_recog.cpp.
| #define THRESH_VARIATION 5 |
Definition at line 26 of file ar_recog.cpp.
| bool calibrateDistance | ( | ar_recog::CalibrateDistance::Request & | req, |
| ar_recog::CalibrateDistance::Response & | resp | ||
| ) |
Definition at line 587 of file ar_recog.cpp.
| IplImage* drawHistogram | ( | IplImage * | img | ) |
Definition at line 69 of file ar_recog.cpp.
| void handleImage | ( | const sensor_msgs::ImageConstPtr & | in, |
| const sensor_msgs::CameraInfoConstPtr & | camera_info | ||
| ) |
Definition at line 149 of file ar_recog.cpp.
| void handleRawImage | ( | const sensor_msgs::ImageConstPtr & | in | ) |
Definition at line 581 of file ar_recog.cpp.
| void init | ( | int | width, |
| int | height | ||
| ) |
Definition at line 46 of file ar_recog.cpp.
| void localThreshold | ( | Mat & | img, |
| Mat & | dst, | ||
| double | k, | ||
| int | window | ||
| ) |
Definition at line 124 of file ar_recog.cpp.
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 596 of file ar_recog.cpp.
Definition at line 146 of file ar_recog.cpp.
Definition at line 145 of file ar_recog.cpp.
| bool ar_smooth = true |
Definition at line 143 of file ar_recog.cpp.
Definition at line 31 of file ar_recog.cpp.
| char cparam_name[65536] |
Definition at line 30 of file ar_recog.cpp.
| double haov |
Definition at line 142 of file ar_recog.cpp.
| int kThresh = 1 |
Definition at line 43 of file ar_recog.cpp.
Definition at line 147 of file ar_recog.cpp.
| char model_name[65536] |
Definition at line 33 of file ar_recog.cpp.
Definition at line 34 of file ar_recog.cpp.
| int objectnum |
Definition at line 35 of file ar_recog.cpp.
| double patt_trans[3][4] |
Definition at line 36 of file ar_recog.cpp.
| int sign = 1 |
Definition at line 44 of file ar_recog.cpp.
Definition at line 144 of file ar_recog.cpp.
Definition at line 41 of file ar_recog.cpp.
Definition at line 42 of file ar_recog.cpp.
Definition at line 38 of file ar_recog.cpp.
| double vaov |
Definition at line 142 of file ar_recog.cpp.