Public Member Functions | Private Attributes | List of all members
mitre_fast_layered_map::ThresholdFilter Class Reference

#include <filters.hpp>

Inheritance diagram for mitre_fast_layered_map::ThresholdFilter:
Inheritance graph
[legend]

Public Member Functions

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

Private Attributes

std::string outputLayerStr_
 
float outputValue_
 
float threshold_
 
std::string valueLayerStr_
 

Additional Inherited Members

- Protected Member Functions inherited from filters::FilterBase< grid_map::GridMap >
bool getParam (const std::string &name, std::string &value)
 
bool getParam (const std::string &name, XmlRpc::XmlRpcValue &value)
 
bool getParam (const std::string &name, double &value)
 
bool getParam (const std::string &name, std::vector< double > &value)
 
bool getParam (const std::string &name, unsigned int &value)
 
bool getParam (const std::string &name, int &value)
 
bool getParam (const std::string &name, std::vector< std::string > &value)
 
bool getParam (const std::string &name, bool &value)
 
bool loadConfiguration (XmlRpc::XmlRpcValue &config)
 
- Protected Attributes inherited from filters::FilterBase< grid_map::GridMap >
bool configured_
 
std::string filter_name_
 
std::string filter_type_
 
string_map_t params_
 

Detailed Description

Definition at line 135 of file filters.hpp.

Constructor & Destructor Documentation

mitre_fast_layered_map::ThresholdFilter::ThresholdFilter ( )

Definition at line 15 of file threshold_filter.cpp.

mitre_fast_layered_map::ThresholdFilter::~ThresholdFilter ( )
virtual

Definition at line 19 of file threshold_filter.cpp.

Member Function Documentation

bool mitre_fast_layered_map::ThresholdFilter::configure ( )
virtual

Implements filters::FilterBase< grid_map::GridMap >.

Definition at line 23 of file threshold_filter.cpp.

bool mitre_fast_layered_map::ThresholdFilter::update ( const grid_map::GridMap _mapIn,
grid_map::GridMap _mapOut 
)
virtual

Implements filters::FilterBase< grid_map::GridMap >.

Definition at line 63 of file threshold_filter.cpp.

Member Data Documentation

std::string mitre_fast_layered_map::ThresholdFilter::outputLayerStr_
private

Definition at line 148 of file filters.hpp.

float mitre_fast_layered_map::ThresholdFilter::outputValue_
private

Definition at line 150 of file filters.hpp.

float mitre_fast_layered_map::ThresholdFilter::threshold_
private

Definition at line 149 of file filters.hpp.

std::string mitre_fast_layered_map::ThresholdFilter::valueLayerStr_
private

Definition at line 147 of file filters.hpp.


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


mitre_fast_layered_map
Author(s):
autogenerated on Thu Mar 11 2021 03:06:49