Functions
test_scan_filter_chain.cpp File Reference
#include <gtest/gtest.h>
#include <filters/filter_chain.h>
#include <ros/ros.h>
#include "sensor_msgs/LaserScan.h"
#include <pluginlib/class_loader.h>
Include dependency graph for test_scan_filter_chain.cpp:

Go to the source code of this file.

Functions

void expect_ranges_eq (const std::vector< float > &a, const std::vector< float > &b)
sensor_msgs::LaserScan gen_msg ()
int main (int argc, char **argv)
 TEST (ScanToScanFilterChain, BadConfiguration)
 TEST (ScanToScanFilterChain, IntensityFilter)
 TEST (ScanToScanFilterChain, InterpFilter)
 TEST (ScanToScanFilterChain, ShadowFilter)
 TEST (ScanToScanFilterChain, ArrayFilter)
 TEST (ScanToScanFilterChain, MaskFilter)

Function Documentation

void expect_ranges_eq ( const std::vector< float > &  a,
const std::vector< float > &  b 
)

Verifies that two vectors of range values are the same. Allows the case where corresponding values are both NaN.

Definition at line 61 of file test_scan_filter_chain.cpp.

sensor_msgs::LaserScan gen_msg ( )

Definition at line 37 of file test_scan_filter_chain.cpp.

int main ( int  argc,
char **  argv 
)

Definition at line 197 of file test_scan_filter_chain.cpp.

TEST ( ScanToScanFilterChain  ,
BadConfiguration   
)

Definition at line 72 of file test_scan_filter_chain.cpp.

TEST ( ScanToScanFilterChain  ,
IntensityFilter   
)

Definition at line 88 of file test_scan_filter_chain.cpp.

TEST ( ScanToScanFilterChain  ,
InterpFilter   
)

Definition at line 107 of file test_scan_filter_chain.cpp.

TEST ( ScanToScanFilterChain  ,
ShadowFilter   
)

Definition at line 128 of file test_scan_filter_chain.cpp.

TEST ( ScanToScanFilterChain  ,
ArrayFilter   
)

Definition at line 148 of file test_scan_filter_chain.cpp.

TEST ( ScanToScanFilterChain  ,
MaskFilter   
)

Definition at line 176 of file test_scan_filter_chain.cpp.



laser_filters
Author(s): Tully Foote
autogenerated on Sat Sep 9 2017 02:57:38