driver.h
Go to the documentation of this file.
1 /* -*- mode: C++ -*- */
2 /*
3  * License: Modified BSD Software License Agreement
4  *
5  * $Id$
6  */
7 
13 #ifndef _O3M151_DRIVER_H_
14 #define _O3M151_DRIVER_H_ 1
15 
16 #include <string>
17 #include <ros/ros.h>
18 #include <pcl_ros/point_cloud.h>
21 #include <pcl/visualization/cloud_viewer.h>
22 
23 #include <o3m151_driver/input.h>
24 
25 namespace o3m151_driver
26 {
27 
29 {
30 public:
31 
33  ros::NodeHandle private_nh);
35 
36  bool poll(void);
37 
38 private:
39 
40  // configuration parameters
41  std::string frame_id_;
42 
45 
52 };
53 
54 } // namespace o3m151_driver
55 
56 #endif // _O3M151_DRIVER_H_
boost::shared_ptr< diagnostic_updater::TopicDiagnostic > diag_topic_
Definition: driver.h:50
O3M151Driver(ros::NodeHandle node, ros::NodeHandle private_nh)
Definition: driver.cc:24
std::string frame_id_
tf frame ID
Definition: driver.h:41
boost::shared_ptr< pcl::visualization::PCLVisualizer > viewer_
Definition: driver.h:51
boost::shared_ptr< Input > input_
Definition: driver.h:43
ros::Publisher output_
Definition: driver.h:44
diagnostic_updater::Updater diagnostics_
Definition: driver.h:47


o3m151_driver
Author(s): Vincent Rousseau
autogenerated on Mon Jun 10 2019 14:07:55