Template Class MultiChannelFilterChain

Class Documentation

template<typename T>
class MultiChannelFilterChain

A class which will construct and sequentially call Filters according to xml.

This is the primary way in which users are expected to interact with Filters

Public Functions

inline explicit MultiChannelFilterChain(std::string data_type)

Create the filter chain object.

inline bool update(const std::vector<T> &data_in, std::vector<T> &data_out)

process data through each of the filters added sequentially

inline ~MultiChannelFilterChain()
inline bool clear()

Clear all filters from this chain.

inline bool configure(size_t number_of_channels, const std::string &param_prefix, const rclcpp::node_interfaces::NodeLoggingInterface::SharedPtr &node_logger, const rclcpp::node_interfaces::NodeParametersInterface::SharedPtr &node_params)

Configure the filter chain.

This will call configure on all filters which have been added as well as allocate the buffers