Go to the documentation of this file.
18 #ifndef SONAR_RECORDER_HPP
19 #define SONAR_RECORDER_HPP
24 #include <boost/circular_buffer.hpp>
30 #include "../helpers/recorder_helpers.hpp"
35 #include <sensor_msgs/Range.h>
46 SonarRecorder(
const std::vector<std::string>& topics,
float buffer_frequency = 0 );
48 void write(
const std::vector<sensor_msgs::Range>& sonar_msgs );
52 void bufferize(
const std::vector<sensor_msgs::Range>& sonar_msgs );
58 inline std::string
topic()
const
81 boost::circular_buffer< std::vector<sensor_msgs::Range> >
buffer_;
void bufferize(const std::vector< sensor_msgs::Range > &sonar_msgs)
void write(const std::vector< sensor_msgs::Range > &sonar_msgs)
boost::circular_buffer< std::vector< sensor_msgs::Range > > buffer_
void subscribe(bool state)
void reset(boost::shared_ptr< naoqi::recorder::GlobalRecorder > gr, float conv_frequency)
bool isInitialized() const
void writeDump(const ros::Time &time)
boost::shared_ptr< naoqi::recorder::GlobalRecorder > gr_
std::string topic() const
void setBufferDuration(float duration)
bool isSubscribed() const
SonarRecorder(const std::vector< std::string > &topics, float buffer_frequency=0)
std::vector< std::string > topics_
naoqi_driver
Author(s): Karsten Knese
autogenerated on Sat Feb 3 2024 03:50:06