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


multisense_ros
Author(s):
autogenerated on Thu Feb 20 2025 03:51:03