status.h
Go to the documentation of this file.
1 
34 #ifndef MULTISENSE_ROS_STATUS_H
35 #define MULTISENSE_ROS_STATUS_H
36 
37 #include <boost/shared_ptr.hpp>
38 #include <boost/thread.hpp>
39 #include <ros/ros.h>
40 
41 #include <multisense_lib/MultiSenseChannel.hh>
42 
43 namespace multisense_ros {
44 
45 class Status {
46 public:
47 
49  ~Status();
50 
51 private:
52 
53  //
54  // CRL sensor API
55 
57 
58  //
59  // Driver nodes
60 
62 
63  //
64  // Device Status publisher
65 
67 
68  //
69  // A timer to query our device status at a fixed rate
70 
72 
73  //
74  // The callback used to query the device status in the timer routine
75 
76  void queryStatus(const ros::TimerEvent& event);
77 
78 
79  //
80  // Publish control
81 
82  int32_t subscribers_;
83  void connect();
84  void disconnect();
85 
86 };
87 
88 }
89 
90 #endif
91 
Status(crl::multisense::Channel *driver)
Definition: status.cpp:40
ros::Timer status_timer_
Definition: status.h:71
ros::Publisher status_pub_
Definition: status.h:66
int32_t subscribers_
Definition: status.h:82
ros::NodeHandle device_nh_
Definition: status.h:61
crl::multisense::Channel * driver_
Definition: status.h:56
void queryStatus(const ros::TimerEvent &event)
Definition: status.cpp:58


multisense_ros
Author(s):
autogenerated on Sat Apr 6 2019 02:16:53