#include <ros/ros.h>#include <visualization_msgs/Marker.h>#include <visualization_msgs/MarkerArray.h>#include <geometry_msgs/Point.h>#include <vslam_system/vo.h>#include <vslam_system/place_recognizer.h>#include <posest/pe2d.h>#include <sba/sba.h>#include <frame_common/frame.h>#include <boost/shared_ptr.hpp>#include <cstdio>#include <fstream>#include <dirent.h>#include <fnmatch.h>#include <opencv/highgui.h>#include <opencv2/nonfree/nonfree.hpp>#include <sys/time.h>
Go to the source code of this file.
| Defines | |
| #define | VISMATCH | 
| Functions | |
| void | drawgraph (SysSBA &sba, SysSPA &spa, ros::Publisher &cam_pub, ros::Publisher &pt_pub, int dec, ros::Publisher &cst_pub, ros::Publisher &link_pub) | 
| int | getidir (struct dirent const *entry) | 
| int | getleft (struct dirent const *entry) | 
| int | getright (struct dirent const *entry) | 
| int | main (int argc, char **argv) | 
| static double | mstime () | 
| Variables | |
| char * | dreg | 
| char * | lreg | 
| double | maxang = 10.0 | 
| double | maxdist = 0.5 | 
| int | mininls = 30 | 
| int | ndi = 0 | 
| char * | rreg | 
| #define VISMATCH | 
Definition at line 67 of file run_mono.cpp.
| void drawgraph | ( | SysSBA & | sba, | 
| SysSPA & | spa, | ||
| ros::Publisher & | cam_pub, | ||
| ros::Publisher & | pt_pub, | ||
| int | dec, | ||
| ros::Publisher & | cst_pub, | ||
| ros::Publisher & | link_pub | ||
| ) | 
Definition at line 111 of file run_mono.cpp.
| int getidir | ( | struct dirent const * | entry | ) | 
Definition at line 100 of file run_mono.cpp.
| int getleft | ( | struct dirent const * | entry | ) | 
Definition at line 85 of file run_mono.cpp.
| int getright | ( | struct dirent const * | entry | ) | 
Definition at line 92 of file run_mono.cpp.
| int main | ( | int | argc, | 
| char ** | argv | ||
| ) | 
Definition at line 285 of file run_mono.cpp.
| static double mstime | ( | ) |  [static] | 
Definition at line 71 of file run_mono.cpp.
| char * dreg | 
Definition at line 82 of file run_mono.cpp.
| char* lreg | 
Definition at line 82 of file run_mono.cpp.
| double maxang = 10.0 | 
Definition at line 281 of file run_mono.cpp.
| double maxdist = 0.5 | 
Definition at line 280 of file run_mono.cpp.
| int mininls = 30 | 
Definition at line 282 of file run_mono.cpp.
| int ndi = 0 | 
Definition at line 283 of file run_mono.cpp.
| char * rreg | 
Definition at line 82 of file run_mono.cpp.