Public Member Functions | Private Attributes | List of all members
LaserFootprintFilter Class Reference

Public Member Functions

bool inFootprint (const geometry_msgs::PointStamped &scan_pt)
 
 LaserFootprintFilter ()
 
void update (const sensor_msgs::LaserScan &input_scan)
 

Private Attributes

std::string base_frame_
 
ros::Publisher debug_pub_
 
double inscribed_radius_
 
tf::TransformListener listener_
 
ros::NodeHandle nh_
 
ros::Publisher scan_filtered_pub_
 
ros::Subscriber scan_sub_
 

Detailed Description

Definition at line 40 of file laser_footprint_filter.cpp.

Constructor & Destructor Documentation

LaserFootprintFilter::LaserFootprintFilter ( )
inline

Definition at line 43 of file laser_footprint_filter.cpp.

Member Function Documentation

bool LaserFootprintFilter::inFootprint ( const geometry_msgs::PointStamped &  scan_pt)
inline

Definition at line 89 of file laser_footprint_filter.cpp.

void LaserFootprintFilter::update ( const sensor_msgs::LaserScan &  input_scan)
inline

Definition at line 53 of file laser_footprint_filter.cpp.

Member Data Documentation

std::string LaserFootprintFilter::base_frame_
private

Definition at line 101 of file laser_footprint_filter.cpp.

ros::Publisher LaserFootprintFilter::debug_pub_
private

Definition at line 103 of file laser_footprint_filter.cpp.

double LaserFootprintFilter::inscribed_radius_
private

Definition at line 100 of file laser_footprint_filter.cpp.

tf::TransformListener LaserFootprintFilter::listener_
private

Definition at line 99 of file laser_footprint_filter.cpp.

ros::NodeHandle LaserFootprintFilter::nh_
private

Definition at line 98 of file laser_footprint_filter.cpp.

ros::Publisher LaserFootprintFilter::scan_filtered_pub_
private

Definition at line 102 of file laser_footprint_filter.cpp.

ros::Subscriber LaserFootprintFilter::scan_sub_
private

Definition at line 104 of file laser_footprint_filter.cpp.


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


turtlebot_navigation
Author(s): Tully Foote
autogenerated on Mon Jun 10 2019 15:44:21