Public Member Functions | Public Attributes | List of all members
laser_filters::ScanShadowsFilter Class Reference

#include <scan_shadows_filter.h>

Inheritance diagram for laser_filters::ScanShadowsFilter:
Inheritance graph
[legend]

Public Member Functions

bool configure ()
 
void reconfigureCB (ScanShadowsFilterConfig &config, uint32_t level)
 
 ScanShadowsFilter ()
 
bool update (const sensor_msgs::LaserScan &scan_in, sensor_msgs::LaserScan &scan_out)
 Filter shadow points based on 3 global parameters: min_angle, max_angle and window. {min,max}_angle specify the allowed angle interval (in degrees) between the created lines (see getAngleWithViewPoint). Window specifies how many consecutive measurements to take into account for one point. More...
 
virtual ~ScanShadowsFilter ()
 
- Public Member Functions inherited from filters::FilterBase< sensor_msgs::LaserScan >
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 ()
 

Public Attributes

std::shared_ptr< dynamic_reconfigure::Server< laser_filters::ScanShadowsFilterConfig > > dyn_server_
 
double laser_max_range_
 
double max_angle_
 
double min_angle_
 
int neighbors_
 
boost::recursive_mutex own_mutex_
 
ScanShadowsFilterConfig param_config
 
bool remove_shadow_start_point_
 
ScanShadowDetector shadow_detector_
 
int window_
 

Additional Inherited Members

- Protected Member Functions inherited from filters::FilterBase< sensor_msgs::LaserScan >
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)
 
- Protected Attributes inherited from filters::FilterBase< sensor_msgs::LaserScan >
bool configured_
 
std::string filter_name_
 
std::string filter_type_
 
string_map_t params_
 

Detailed Description

ScanShadowsFilter is a simple filter that filters shadow points in a laser scan line

Definition at line 55 of file scan_shadows_filter.h.

Constructor & Destructor Documentation

◆ ScanShadowsFilter()

laser_filters::ScanShadowsFilter::ScanShadowsFilter ( )
inline

Definition at line 70 of file scan_shadows_filter.h.

◆ ~ScanShadowsFilter()

virtual laser_filters::ScanShadowsFilter::~ScanShadowsFilter ( )
inlinevirtual

Definition at line 155 of file scan_shadows_filter.h.

Member Function Documentation

◆ configure()

bool laser_filters::ScanShadowsFilter::configure ( )
inlinevirtual

Configure the filter from XML

Implements filters::FilterBase< sensor_msgs::LaserScan >.

Definition at line 75 of file scan_shadows_filter.h.

◆ reconfigureCB()

void laser_filters::ScanShadowsFilter::reconfigureCB ( ScanShadowsFilterConfig &  config,
uint32_t  level 
)
inline

Definition at line 142 of file scan_shadows_filter.h.

◆ update()

bool laser_filters::ScanShadowsFilter::update ( const sensor_msgs::LaserScan &  scan_in,
sensor_msgs::LaserScan &  scan_out 
)
inlinevirtual

Filter shadow points based on 3 global parameters: min_angle, max_angle and window. {min,max}_angle specify the allowed angle interval (in degrees) between the created lines (see getAngleWithViewPoint). Window specifies how many consecutive measurements to take into account for one point.

Parameters
scan_inthe input LaserScan message
scan_outthe output LaserScan message

Implements filters::FilterBase< sensor_msgs::LaserScan >.

Definition at line 167 of file scan_shadows_filter.h.

Member Data Documentation

◆ dyn_server_

std::shared_ptr<dynamic_reconfigure::Server<laser_filters::ScanShadowsFilterConfig> > laser_filters::ScanShadowsFilter::dyn_server_

Definition at line 65 of file scan_shadows_filter.h.

◆ laser_max_range_

double laser_filters::ScanShadowsFilter::laser_max_range_

Definition at line 58 of file scan_shadows_filter.h.

◆ max_angle_

double laser_filters::ScanShadowsFilter::max_angle_

Definition at line 59 of file scan_shadows_filter.h.

◆ min_angle_

double laser_filters::ScanShadowsFilter::min_angle_

Definition at line 59 of file scan_shadows_filter.h.

◆ neighbors_

int laser_filters::ScanShadowsFilter::neighbors_

Definition at line 60 of file scan_shadows_filter.h.

◆ own_mutex_

boost::recursive_mutex laser_filters::ScanShadowsFilter::own_mutex_

Definition at line 66 of file scan_shadows_filter.h.

◆ param_config

ScanShadowsFilterConfig laser_filters::ScanShadowsFilter::param_config

Definition at line 67 of file scan_shadows_filter.h.

◆ remove_shadow_start_point_

bool laser_filters::ScanShadowsFilter::remove_shadow_start_point_

Definition at line 61 of file scan_shadows_filter.h.

◆ shadow_detector_

ScanShadowDetector laser_filters::ScanShadowsFilter::shadow_detector_

Definition at line 63 of file scan_shadows_filter.h.

◆ window_

int laser_filters::ScanShadowsFilter::window_

Definition at line 60 of file scan_shadows_filter.h.


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


laser_filters
Author(s): Tully Foote
autogenerated on Mon Feb 28 2022 22:39:24