barcode_reader_nodelet.h
Go to the documentation of this file.
1 
32 #ifndef ZBAR_ROS_ZBAR_ROS_NODELET_H
33 #define ZBAR_ROS_ZBAR_ROS_NODELET_H
34 
35 #include "ros/ros.h"
36 #include "opencv/cv.h"
37 #include "cv_bridge/cv_bridge.h"
38 #include "zbar.h"
39 #include "boost/unordered_map.hpp"
40 #include <string>
41 #include "nodelet/nodelet.h"
42 
43 namespace zbar_ros
44 {
45 
47  {
48  public:
50 
51  private:
52  virtual void onInit();
53  void connectCb();
54  void disconnectCb();
55  void imageCb(const sensor_msgs::ImageConstPtr &image);
56  void cleanCb();
57 
62  zbar::ImageScanner scanner_;
63  boost::unordered_map<std::string, ros::Time> barcode_memory_;
64 
65  double throttle_;
66  };
67 
68 } // namespace zbar_ros
69 
70 #endif // ZBAR_ROS_ZBAR_ROS_NODELET_H
void imageCb(const sensor_msgs::ImageConstPtr &image)
boost::unordered_map< std::string, ros::Time > barcode_memory_


zbar_ros
Author(s): Paul Bovbel
autogenerated on Thu Jun 6 2019 19:19:39