$search
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"
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 | DEFAULT_ALPHA 0.00 |
#define | MS_PER_SEC 1000.0 |
Typedefs | |
typedef dynamic_reconfigure::Server < thermalvis::flowConfig > | Server |
Functions | |
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 |
Declarations for the FLOW node.
Definition in file flow.hpp.
typedef dynamic_reconfigure::Server< thermalvis::flowConfig > Server |
void imageCallback | ( | const sensor_msgs::ImageConstPtr & | msg | ) |
void mySigintHandler | ( | int | sig | ) |
Definition at line 240 of file calibrator.cpp.
void parameterCallback | ( | const sensor_msgs::CameraInfo & | msg | ) |
const char __PROGRAM__[] = "THERMALVIS_FLOW" |
boost::shared_ptr< featureTrackerNode >* globalNodePtr |
bool wantsToShutdown = false |