image_cb_detector_node_old.cpp File Reference

#include <ros/ros.h>
#include "sensor_msgs/Image.h"
#include "image_transport/image_transport.h"
#include "cv_bridge/CvBridge.h"
#include <opencv/cv.h>
#include <opencv/highgui.h>
#include <image_cb_detector/image_cb_detector_old.h>
#include <sstream>
Include dependency graph for image_cb_detector_node_old.cpp:

Go to the source code of this file.

Defines

#define ROS_INFO_CONFIG(name)

Functions

image_cb_detector::ConfigGoal getParamConfig (ros::NodeHandle &n)
void imageCallback (ros::Publisher *pub, ImageCbDetectorOld *detector, const sensor_msgs::ImageConstPtr &image)
int main (int argc, char **argv)

Define Documentation

#define ROS_INFO_CONFIG ( name   ) 
Value:
{\
  ostringstream ss;\
  ss << "[" << #name << "] -> " << config.name;\
  ROS_INFO(ss.str().c_str());\
}

Definition at line 49 of file image_cb_detector_node_old.cpp.


Function Documentation

image_cb_detector::ConfigGoal getParamConfig ( ros::NodeHandle &  n  ) 

Definition at line 58 of file image_cb_detector_node_old.cpp.

void imageCallback ( ros::Publisher *  pub,
ImageCbDetectorOld detector,
const sensor_msgs::ImageConstPtr &  image 
)

Definition at line 104 of file image_cb_detector_node_old.cpp.

int main ( int  argc,
char **  argv 
)

Definition at line 118 of file image_cb_detector_node_old.cpp.

 All Classes Namespaces Files Functions Variables Typedefs Defines


image_cb_detector
Author(s): Vijay Pradeep and Eitan Marder-Eppstein
autogenerated on Fri Jan 11 09:53:33 2013