Template Class FilterChain

Class Documentation

template<typename T>
class FilterChain

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 FilterChain(std::string data_type)

Create the filter chain object.

inline ~FilterChain()
inline bool update(const T &data_in, T &data_out)

process data through each of the filters added sequentially

inline bool clear()

Clear all filters from this chain.

inline bool configure(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 and all filters which have been addedj.

Parameters:
  • param_prefix – The parameter name prefix of the filter chain to load

  • node_logger – node logging interface to use

  • node_params – node parameter interface to use