#include <ros/ros.h>#include <image_transport/image_transport.h>#include <opencv/cv.h>#include <opencv/highgui.h>#include <cv_bridge/CvBridge.h>#include <boost/thread/mutex.hpp>#include <motld/BoundingBox.h>
Go to the source code of this file.
Functions | |
| static void | addTextAndBB (IplImage *img) |
| int | main (int argc, char **argv) |
| static void | mouseHandler (int event, int x, int y, int flags, void *param) |
| static void | trackerCallback (const sensor_msgs::ImageConstPtr &msg) |
Variables | |
| static CvRect | bb_ |
| ros::Publisher | box_pub_ |
| sensor_msgs::CvBridge | bridge_ |
| static IplImage * | color_image_ |
| bool | correctBB = false |
| static IplImage * | curr_image_ |
| static int | drag_ = 0 |
| static CvFont | font_ |
| static IplImage * | imgc_ |
| bool | isMouseCallbackSet_ = false |
| static CvPoint | point_ |
| static CvPoint | point_next_ |
| boost::mutex | state_mutex_ |
| static void addTextAndBB | ( | IplImage * | img | ) | [static] |
| static void mouseHandler | ( | int | event, |
| int | x, | ||
| int | y, | ||
| int | flags, | ||
| void * | param | ||
| ) | [static] |
| static void trackerCallback | ( | const sensor_msgs::ImageConstPtr & | msg | ) | [static] |
IplImage* color_image_ [static] |
IplImage* curr_image_ [static] |
| bool isMouseCallbackSet_ = false |
CvPoint point_next_ [static] |
| boost::mutex state_mutex_ |