Classes | Defines | Typedefs | Functions | Variables
flow.hpp File Reference

Declarations for the FLOW node. More...

#include "general_resources.hpp"
#include "ros_resources.hpp"
#include "opencv_resources.hpp"
#include "improc.hpp"
#include "video.hpp"
#include "features.hpp"
#include "tracks.hpp"
#include "initialization.hpp"
#include "feature_tracks.h"
#include "flowConfig.h"
#include "boost/filesystem.hpp"
Include dependency graph for flow.hpp:
This graph shows which files directly or indirectly include this file:

Go to the source code of this file.

Classes

class  featureTrackerNode
 Manages the optical flow procedure. More...
struct  trackerData
 Stores configuration information for the sparse optical flow routine. More...

Defines

#define ADAPTIVE_WINDOW_CONTIGENCY_FACTOR   5.0
#define COLOR_MATCHED_POINTS   CV_RGB(255, 255, 0)
#define COLOR_RECOVERED_POINTS   CV_RGB(0, 255, 0)
#define COLOR_TRACKED_PATH   CV_RGB(255, 128, 127)
#define COLOR_TRACKED_POINTS   CV_RGB(255, 0, 0)
#define COLOR_UNMATCHED_POINTS   CV_RGB(255, 0, 255)
#define DEFAULT_ALPHA   0.00
#define FAST_DETECTOR_SENSITIVITY_SCALING   200.0
#define FEATURE_DROP_TRIGGER   0.40
#define MAX_HISTORY_FRAMES   16
#define MIN_FEATURES_FOR_FEATURE_MOTION   10
#define MINIMUM_GFTT_SENSITIVITY   0.001
#define MINIMUM_HARRIS_SENSITIVITY   0.0001
#define MINIMUM_PROP_OF_PREVIOUS_FEATURES   0.8
#define MS_PER_SEC   1000.0
#define SKIP_WARNING_TIME_PERIOD   10.0
#define TIGHT_DISTANCE_CONSTRAINT   3

Typedefs

typedef
dynamic_reconfigure::Server
< thermalvis::flowConfig > 
Server

Functions

void connected (const ros::SingleSubscriberPublisher &)
void disconnected (const ros::SingleSubscriberPublisher &)
void imageCallback (const sensor_msgs::ImageConstPtr &msg)
void mySigintHandler (int sig)
void parameterCallback (const sensor_msgs::CameraInfo &msg)

Variables

const char __PROGRAM__ [] = "THERMALVIS_FLOW"
boost::shared_ptr
< featureTrackerNode > * 
globalNodePtr
bool wantsToShutdown = false

Detailed Description

Declarations for the FLOW node.

Definition in file flow.hpp.


Define Documentation

Definition at line 56 of file flow.hpp.

#define COLOR_MATCHED_POINTS   CV_RGB(255, 255, 0)

Definition at line 54 of file flow.hpp.

#define COLOR_RECOVERED_POINTS   CV_RGB(0, 255, 0)

Definition at line 52 of file flow.hpp.

#define COLOR_TRACKED_PATH   CV_RGB(255, 128, 127)

Definition at line 51 of file flow.hpp.

#define COLOR_TRACKED_POINTS   CV_RGB(255, 0, 0)

Definition at line 50 of file flow.hpp.

#define COLOR_UNMATCHED_POINTS   CV_RGB(255, 0, 255)

Definition at line 53 of file flow.hpp.

#define DEFAULT_ALPHA   0.00

Definition at line 29 of file flow.hpp.

Definition at line 34 of file flow.hpp.

#define FEATURE_DROP_TRIGGER   0.40

Definition at line 37 of file flow.hpp.

#define MAX_HISTORY_FRAMES   16

Definition at line 59 of file flow.hpp.

Definition at line 58 of file flow.hpp.

#define MINIMUM_GFTT_SENSITIVITY   0.001

Definition at line 32 of file flow.hpp.

#define MINIMUM_HARRIS_SENSITIVITY   0.0001

Definition at line 33 of file flow.hpp.

Definition at line 39 of file flow.hpp.

#define MS_PER_SEC   1000.0

Definition at line 30 of file flow.hpp.

#define SKIP_WARNING_TIME_PERIOD   10.0

Definition at line 41 of file flow.hpp.

#define TIGHT_DISTANCE_CONSTRAINT   3

Definition at line 36 of file flow.hpp.


Typedef Documentation

typedef dynamic_reconfigure::Server< thermalvis::flowConfig > Server

Definition at line 27 of file flow.hpp.


Function Documentation

Definition at line 339 of file flow.hpp.

Definition at line 340 of file flow.hpp.

void imageCallback ( const sensor_msgs::ImageConstPtr &  msg)
void mySigintHandler ( int  sig)

Definition at line 350 of file calibrator.cpp.

void parameterCallback ( const sensor_msgs::CameraInfo &  msg)

Variable Documentation

const char __PROGRAM__[] = "THERMALVIS_FLOW"

Definition at line 25 of file flow.hpp.

boost::shared_ptr< featureTrackerNode >* globalNodePtr

Definition at line 342 of file flow.hpp.

bool wantsToShutdown = false

Definition at line 61 of file flow.hpp.



thermalvis
Author(s): Stephen Vidas
autogenerated on Sun Jan 5 2014 11:38:45