Public Member Functions | |
| void | callback (const sensor_msgs::LaserScan::ConstPtr &msg_in) |
| void | deprecation_warn (const ros::TimerEvent &e) |
| ScanToScanFilterChain (const ros::NodeHandle &nh={}, const ros::NodeHandle &pnh={"~"}) | |
| ~ScanToScanFilterChain () | |
Protected Attributes | |
| ros::Timer | deprecation_timer_ |
| filters::FilterChain< sensor_msgs::LaserScan > | filter_chain_ |
| sensor_msgs::LaserScan | msg_ |
| ros::NodeHandle | nh_ |
| ros::Publisher | output_pub_ |
| ros::NodeHandle | private_nh_ |
| message_filters::Subscriber< sensor_msgs::LaserScan > | scan_sub_ |
| tf::TransformListener * | tf_ |
| tf::MessageFilter< sensor_msgs::LaserScan > * | tf_filter_ |
| double | tf_filter_tolerance_ |
| bool | using_filter_chain_deprecated_ |
Definition at line 43 of file scan_to_scan_filter_chain.cpp.
|
inline |
Definition at line 69 of file scan_to_scan_filter_chain.cpp.
|
inline |
Definition at line 116 of file scan_to_scan_filter_chain.cpp.
|
inline |
Definition at line 132 of file scan_to_scan_filter_chain.cpp.
|
inline |
Definition at line 125 of file scan_to_scan_filter_chain.cpp.
|
protected |
Definition at line 64 of file scan_to_scan_filter_chain.cpp.
|
protected |
Definition at line 57 of file scan_to_scan_filter_chain.cpp.
|
protected |
Definition at line 60 of file scan_to_scan_filter_chain.cpp.
|
protected |
Definition at line 47 of file scan_to_scan_filter_chain.cpp.
|
protected |
Definition at line 61 of file scan_to_scan_filter_chain.cpp.
|
protected |
Definition at line 48 of file scan_to_scan_filter_chain.cpp.
|
protected |
Definition at line 52 of file scan_to_scan_filter_chain.cpp.
|
protected |
Definition at line 51 of file scan_to_scan_filter_chain.cpp.
|
protected |
Definition at line 53 of file scan_to_scan_filter_chain.cpp.
|
protected |
Definition at line 54 of file scan_to_scan_filter_chain.cpp.
|
protected |
Definition at line 65 of file scan_to_scan_filter_chain.cpp.