Public Member Functions | Protected Member Functions | List of all members
TestFilter Class Reference
Inheritance diagram for TestFilter:
Inheritance graph
[legend]

Public Member Functions

bool update (const std::string &data_in, std::string &data_out) override
 
- Public Member Functions inherited from filters::FilterBase< std::string >
bool configure (const std::string &param_name, ros::NodeHandle node_handle=ros::NodeHandle())
 
bool configure (XmlRpc::XmlRpcValue &config)
 
 FilterBase ()
 
const std::string & getName () const
 
std::string getType ()
 
virtual ~FilterBase ()
 

Protected Member Functions

bool configure () override
 
- Protected Member Functions inherited from robot_body_filter::FilterBase< std::string >
getParamVerbose (const std::string &name, const T &defaultValue=T(), const std::string &unit="", bool *defaultUsed=nullptr, ToStringFn< T > valueToStringFn=&to_string) const
 Get the value of the given filter parameter, falling back to the specified default value, and print out a ROS info/warning message with the loaded values. More...
 
std::string getParamVerbose (const std::string &name, const char *defaultValue, const std::string &unit="", bool *defaultUsed=nullptr, ToStringFn< std::string > valueToStringFn=&to_string) const
 Get the value of the given filter parameter, falling back to the specified default value, and print out a ROS info/warning message with the loaded values. More...
 
uint64_t getParamVerbose (const std::string &name, const uint64_t &defaultValue, const std::string &unit="", bool *defaultUsed=nullptr, ToStringFn< int > valueToStringFn=&to_string) const
 Get the value of the given filter parameter, falling back to the specified default value, and print out a ROS info/warning message with the loaded values. More...
 
unsigned int getParamVerbose (const std::string &name, const unsigned int &defaultValue, const std::string &unit="", bool *defaultUsed=nullptr, ToStringFn< int > valueToStringFn=&to_string) const
 Get the value of the given filter parameter, falling back to the specified default value, and print out a ROS info/warning message with the loaded values. More...
 
ros::Duration getParamVerbose (const std::string &name, const ros::Duration &defaultValue, const std::string &unit="", bool *defaultUsed=nullptr, ToStringFn< double > valueToStringFn=&to_string) const
 Get the value of the given filter parameter, falling back to the specified default value, and print out a ROS info/warning message with the loaded values. More...
 
MapType getParamVerboseMap (const std::string &name, const std::map< std::string, T > &defaultValue=std::map< std::string, T >(), const std::string &unit="", bool *defaultUsed=nullptr, ToStringFn< MapType > valueToStringFn=&to_string) const
 
std::set< T > getParamVerboseSet (const std::string &name, const std::set< T > &defaultValue=std::set< T >(), const std::string &unit="", bool *defaultUsed=nullptr, ToStringFn< std::vector< T >> valueToStringFn=&to_string) const
 Get the value of the given filter parameter as a set of strings, falling back to the specified default value, and print out a ROS info/warning message with the loaded values. More...
 
- Protected Member Functions inherited from filters::FilterBase< std::string >
bool getParam (const std::string &name, std::string &value) const
 
bool getParam (const std::string &name, XmlRpc::XmlRpcValue &value) const
 
bool getParam (const std::string &name, double &value) const
 
bool getParam (const std::string &name, std::vector< double > &value) const
 
bool getParam (const std::string &name, unsigned int &value) const
 
bool getParam (const std::string &name, int &value) const
 
bool getParam (const std::string &name, std::vector< std::string > &value) const
 
bool getParam (const std::string &name, bool &value) const
 
bool loadConfiguration (XmlRpc::XmlRpcValue &config)
 

Additional Inherited Members

- Protected Types inherited from robot_body_filter::FilterBase< std::string >
using ToStringFn = std::string(*)(const T &)
 Type of function that converts anything to a string. More...
 
- Protected Attributes inherited from filters::FilterBase< std::string >
bool configured_
 
std::string filter_name_
 
std::string filter_type_
 
string_map_t params_
 

Detailed Description

Definition at line 6 of file test_filter_utils.cpp.

Member Function Documentation

◆ configure()

bool TestFilter::configure ( )
inlineoverrideprotectedvirtual

Implements filters::FilterBase< std::string >.

Definition at line 13 of file test_filter_utils.cpp.

◆ update()

bool TestFilter::update ( const std::string &  data_in,
std::string &  data_out 
)
inlineoverridevirtual

Implements filters::FilterBase< std::string >.

Definition at line 8 of file test_filter_utils.cpp.


The documentation for this class was generated from the following file:


robot_body_filter
Author(s): Eitan Marder-Eppstein, Tomas Petricek, Martin Pecka
autogenerated on Thu Apr 13 2023 03:00:27