Functions | Variables
test_tracking.cpp File Reference
#include <cmath>
#include <deque>
#include <sstream>
#include <unistd.h>
#include <vector>
#include <cv_bridge/cv_bridge.h>
#include <ros/ros.h>
#include <rosbag/bag.h>
#include <rosbag/view.h>
#include <sensor_msgs/Image.h>
#include <opencv2/core/core.hpp>
#include <opencv2/highgui/highgui.hpp>
#include "cam/CamRadtan.h"
#include "feat/Feature.h"
#include "feat/FeatureDatabase.h"
#include "track/TrackAruco.h"
#include "track/TrackDescriptor.h"
#include "track/TrackKLT.h"
#include "utils/opencv_yaml_parse.h"
#include "utils/print.h"
Include dependency graph for test_tracking.cpp:

Go to the source code of this file.

Functions

void handle_stereo (double time0, double time1, cv::Mat img0, cv::Mat img1)
 
int main (int argc, char **argv)
 

Variables

int clone_states = 10
 
std::deque< double > clonetimes
 
TrackBaseextractor
 
int featslengths = 0
 
int frames = 0
 
int max_cameras = 2
 
int num_lostfeats = 0
 
int num_margfeats = 0
 
ros::Time time_start
 

Function Documentation

◆ handle_stereo()

void handle_stereo ( double  time0,
double  time1,
cv::Mat  img0,
cv::Mat  img1 
)

This function will process the new stereo pair with the extractor!

Definition at line 284 of file test_tracking.cpp.

◆ main()

int main ( int  argc,
char **  argv 
)

Definition at line 68 of file test_tracking.cpp.

Variable Documentation

◆ clone_states

int clone_states = 10

Definition at line 57 of file test_tracking.cpp.

◆ clonetimes

std::deque<double> clonetimes

Definition at line 58 of file test_tracking.cpp.

◆ extractor

TrackBase* extractor

Definition at line 49 of file test_tracking.cpp.

◆ featslengths

int featslengths = 0

Definition at line 56 of file test_tracking.cpp.

◆ frames

int frames = 0

Definition at line 53 of file test_tracking.cpp.

◆ max_cameras

int max_cameras = 2

Definition at line 62 of file test_tracking.cpp.

◆ num_lostfeats

int num_lostfeats = 0

Definition at line 54 of file test_tracking.cpp.

◆ num_margfeats

int num_margfeats = 0

Definition at line 55 of file test_tracking.cpp.

◆ time_start

ros::Time time_start

Definition at line 59 of file test_tracking.cpp.



ov_core
Author(s): Patrick Geneva , Kevin Eckenhoff , Guoquan Huang
autogenerated on Mon Jan 22 2024 03:08:17