Go to the documentation of this file.
37 #include <boost/circular_buffer.hpp>
38 #include <std_msgs/Float32.h>
42 class WallDurationTimer;
44 class ScopedWallDurationReporter
65 class WallDurationTimer
71 virtual ScopedWallDurationReporter
reporter();
72 virtual ScopedWallDurationReporter
reporter(
81 boost::circular_buffer<ros::WallDuration>
buffer_;
virtual void clearBuffer()
WallDurationTimer * parent_
virtual double latestSec()
ros::Publisher pub_average_
ros::WallTime start_time_
virtual size_t sampleNum()
virtual ScopedWallDurationReporter reporter()
virtual ~ScopedWallDurationReporter()
virtual void report(ros::WallDuration &duration)
boost::circular_buffer< ros::WallDuration > buffer_
boost::shared_ptr< ScopedWallDurationReporter > Ptr
ScopedWallDurationReporter(WallDurationTimer *parent)
WallDurationTimer(const int max_num)
virtual void setIsEnabled(bool)
virtual void setIsPublish(bool)
boost::shared_ptr< WallDurationTimer > Ptr
ros::Publisher pub_latest_