Class IIOBuffer
Defined in File iio_buffer.hpp
Class Documentation
-
class IIOBuffer
Public Functions
-
~IIOBuffer()
-
bool createIIOBuffer(std::string &message, bool output = false, bool cyclic = false)
-
void destroyIIOBuffer()
-
bool refill(std::string &message)
-
bool push(std::string &message, std_msgs::msg::Int32MultiArray &data)
-
void enableTopic(std::string topic_name, double loopRate)
-
void disableTopic()
-
void publishingLoop()
-
inline int32_t samples_count()
-
inline std::string device_path()
-
inline std::vector<std::string> channels()
-
inline iio_buffer *buffer()
-
inline bool topic_enabled()
-
inline std_msgs::msg::Int32MultiArray &data()
-
inline void set_samples_count(int32_t samples_count)
-
inline void set_device_path(std::string device_path)
-
inline void set_channels(std::vector<std::string> channels)
-
~IIOBuffer()