#include <gtest/gtest.h>
#include <ros/ros.h>
#include <costmap_2d/costmap_2d_ros.h>
#include <tf2_geometry_msgs/tf2_geometry_msgs.h>
#include <tf2_ros/transform_listener.h>
Go to the source code of this file.
Functions | |
int | main (int argc, char **argv) |
TEST (Costmap2DROS, footprint_empty) | |
TEST (Costmap2DROS, footprint_from_same_level_param) | |
TEST (Costmap2DROS, footprint_from_xmlrpc_param) | |
TEST (Costmap2DROS, footprint_from_xmlrpc_param_failure) | |
TEST (Costmap2DROS, padded_footprint_from_string_param) | |
TEST (Costmap2DROS, radius_param) | |
TEST (Costmap2DROS, unpadded_footprint_from_string_param) | |
Variables | |
tf2_ros::Buffer * | tf_ |
tf2_ros::TransformListener * | tfl_ |
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 163 of file footprint_tests.cpp.
TEST | ( | Costmap2DROS | , |
footprint_empty | |||
) |
Definition at line 151 of file footprint_tests.cpp.
TEST | ( | Costmap2DROS | , |
footprint_from_same_level_param | |||
) |
Definition at line 127 of file footprint_tests.cpp.
TEST | ( | Costmap2DROS | , |
footprint_from_xmlrpc_param | |||
) |
Definition at line 104 of file footprint_tests.cpp.
TEST | ( | Costmap2DROS | , |
footprint_from_xmlrpc_param_failure | |||
) |
Definition at line 146 of file footprint_tests.cpp.
TEST | ( | Costmap2DROS | , |
padded_footprint_from_string_param | |||
) |
Definition at line 67 of file footprint_tests.cpp.
TEST | ( | Costmap2DROS | , |
radius_param | |||
) |
Definition at line 86 of file footprint_tests.cpp.
TEST | ( | Costmap2DROS | , |
unpadded_footprint_from_string_param | |||
) |
Definition at line 48 of file footprint_tests.cpp.
tf2_ros::Buffer* tf_ |
Definition at line 46 of file footprint_tests.cpp.
Definition at line 45 of file footprint_tests.cpp.