Enumerations | Functions | Variables
ibgho_tracker_node.cpp File Reference
#include <cv_bridge/cv_bridge.h>
#include <homography_optimizer/ibg.h>
#include <image_transport/image_transport.h>
#include <opencv2/highgui/highgui.hpp>
#include <ros/ros.h>
#include <std_msgs/Char.h>
#include <vtec_msgs/TrackingResult.h>
Include dependency graph for ibgho_tracker_node.cpp:

Go to the source code of this file.

Enumerations

enum  tracking_states {
  STARTING = 0, NOT_TRACKING = 1, TRACKING = 2, STARTING = 0,
  NOT_TRACKING = 1, TRACKING = 2
}
 

Functions

void cmdCallback (const std_msgs::Char cmd_msg)
 Callback for the keyboard command. More...
 
void fillTrackingMsg (vtec_msgs::TrackingResult &msg, const double score, const cv::Mat &H, const float alpha, const float beta, int bbox_size_x, int bbox_size_y)
 Fills a vtec_msgs/TrackingResult message. More...
 
void imageCallback (const sensor_msgs::ImageConstPtr &msg)
 Callback to handle incoming images. More...
 
int main (int argc, char **argv)
 
void start_tracking ()
 Starts a tracking. More...
 

Variables

float alpha
 
image_transport::Publisherannotated_pub_ptr
 
int BBOX_POS_X
 
int BBOX_POS_Y
 
int BBOX_SIZE_X
 
int BBOX_SIZE_Y
 
float beta
 
cv::Mat cur_img
 
cv::Mat H
 
VTEC::IBGHomographyOptimizer * ibg_optimizer
 
int image_index = 0
 
ros::Time last_ref_pub_time
 
cv::Mat out_ref_template
 
image_transport::Publisherreference_pub_ptr
 
ros::Publisherresults_pub_ptr
 
image_transport::Publisherstabilized_pub_ptr
 
bool start_command = false
 
int state = STARTING
 

Enumeration Type Documentation

Enumerator
STARTING 
NOT_TRACKING 
TRACKING 
STARTING 
NOT_TRACKING 
TRACKING 

Definition at line 9 of file ibgho_tracker_node.cpp.

Function Documentation

void cmdCallback ( const std_msgs::Char  cmd_msg)

Callback for the keyboard command.

Parameters
[in]cmd_msgThe command message

Definition at line 191 of file ibgho_tracker_node.cpp.

void fillTrackingMsg ( vtec_msgs::TrackingResult &  msg,
const double  score,
const cv::Mat &  H,
const float  alpha,
const float  beta,
int  bbox_size_x,
int  bbox_size_y 
)

Fills a vtec_msgs/TrackingResult message.

Parameters
msgThe message
[in]scoreThe (zncc) score
[in]HThe homography matrix
[in]alphaThe photometric gain
[in]betaThe photometric bias
[in]bbox_size_xThe bounding box size x
[in]bbox_size_yThe bounding box size y

Definition at line 42 of file ibgho_tracker_node.cpp.

void imageCallback ( const sensor_msgs::ImageConstPtr &  msg)

Callback to handle incoming images.

Parameters
[in]msgThe message

Definition at line 109 of file ibgho_tracker_node.cpp.

int main ( int  argc,
char **  argv 
)

Definition at line 203 of file ibgho_tracker_node.cpp.

void start_tracking ( )

Starts a tracking.

Definition at line 88 of file ibgho_tracker_node.cpp.

Variable Documentation

float alpha

Definition at line 14 of file ibgho_tracker_node.cpp.

image_transport::Publisher* annotated_pub_ptr

Definition at line 15 of file ibgho_tracker_node.cpp.

int BBOX_POS_X

Definition at line 21 of file ibgho_tracker_node.cpp.

int BBOX_POS_Y

Definition at line 21 of file ibgho_tracker_node.cpp.

int BBOX_SIZE_X

Definition at line 20 of file ibgho_tracker_node.cpp.

int BBOX_SIZE_Y

Definition at line 20 of file ibgho_tracker_node.cpp.

float beta

Definition at line 14 of file ibgho_tracker_node.cpp.

cv::Mat cur_img

Definition at line 27 of file ibgho_tracker_node.cpp.

cv::Mat H

Definition at line 13 of file ibgho_tracker_node.cpp.

VTEC::IBGHomographyOptimizer* ibg_optimizer

Definition at line 11 of file ibgho_tracker_node.cpp.

int image_index = 0

Definition at line 29 of file ibgho_tracker_node.cpp.

ros::Time last_ref_pub_time

Definition at line 23 of file ibgho_tracker_node.cpp.

cv::Mat out_ref_template

Definition at line 24 of file ibgho_tracker_node.cpp.

image_transport::Publisher * reference_pub_ptr

Definition at line 15 of file ibgho_tracker_node.cpp.

ros::Publisher* results_pub_ptr

Definition at line 17 of file ibgho_tracker_node.cpp.

image_transport::Publisher * stabilized_pub_ptr

Definition at line 15 of file ibgho_tracker_node.cpp.

bool start_command = false

Definition at line 26 of file ibgho_tracker_node.cpp.

int state = STARTING

Definition at line 19 of file ibgho_tracker_node.cpp.



vtec_tracker
Author(s):
autogenerated on Sat Dec 7 2019 03:17:05