Typedefs | Functions | Variables
print_objects_detected_node.cpp File Reference
#include <ros/ros.h>
#include <find_object_2d/ObjectsStamped.h>
#include <message_filters/subscriber.h>
#include <message_filters/time_synchronizer.h>
#include <image_transport/image_transport.h>
#include <image_transport/subscriber_filter.h>
#include <cv_bridge/cv_bridge.h>
#include <opencv2/opencv.hpp>
#include <QTransform>
#include <QColor>
Include dependency graph for print_objects_detected_node.cpp:

Go to the source code of this file.

Typedefs

typedef message_filters::sync_policies::ExactTime< sensor_msgs::Image, find_object_2d::ObjectsStamped > MyExactSyncPolicy
 

Functions

void imageObjectsDetectedCallback (const sensor_msgs::ImageConstPtr &imageMsg, const find_object_2d::ObjectsStampedConstPtr &objectsMsg)
 
int main (int argc, char **argv)
 
void objectsDetectedCallback (const std_msgs::Float32MultiArrayConstPtr &msg)
 

Variables

image_transport::Publisher imagePub
 

Typedef Documentation

typedef message_filters::sync_policies::ExactTime<sensor_msgs::Image, find_object_2d::ObjectsStamped> MyExactSyncPolicy

Definition at line 139 of file print_objects_detected_node.cpp.

Function Documentation

void imageObjectsDetectedCallback ( const sensor_msgs::ImageConstPtr &  imageMsg,
const find_object_2d::ObjectsStampedConstPtr &  objectsMsg 
)

Definition at line 83 of file print_objects_detected_node.cpp.

int main ( int  argc,
char **  argv 
)

Definition at line 141 of file print_objects_detected_node.cpp.

void objectsDetectedCallback ( const std_msgs::Float32MultiArrayConstPtr &  msg)

IMPORTANT : Parameter General/MirrorView must be false Parameter Homography/homographyComputed must be true

Definition at line 46 of file print_objects_detected_node.cpp.

Variable Documentation

Definition at line 39 of file print_objects_detected_node.cpp.



find_object_2d
Author(s): Mathieu Labbe
autogenerated on Thu Jun 6 2019 19:22:26