#include <gtest/gtest.h>
#include <iostream>
#include <vector>
#include <utility>
#include <base_local_planner/map_cell.h>
#include <base_local_planner/map_grid.h>
#include <base_local_planner/trajectory.h>
#include <base_local_planner/trajectory_planner.h>
#include <base_local_planner/costmap_model.h>
#include <costmap_2d/costmap_2d.h>
#include <math.h>
#include <geometry_msgs/Point.h>
#include <base_local_planner/Position2DInt.h>
Go to the source code of this file.
Classes | |
class | base_local_planner::TrajectoryPlannerTest |
class | base_local_planner::WavefrontMapAccessor |
Namespaces | |
namespace | base_local_planner |
Functions | |
int | main (int argc, char **argv) |
TEST (MapGrid, properGridConstruction) | |
TEST (TrajectoryPlannerTest, correctFootprint) | |
TEST (TrajectoryPlannerTest, footprintObstacles) | |
TEST (TrajectoryPlannerTest, checkGoalDistance) | |
TEST (TrajectoryPlannerTest, checkPathDistance) | |
Variables | |
TrajectoryPlannerTest * | tct = NULL |
TEST | ( | TrajectoryPlannerTest | , |
correctFootprint | |||
) |
TEST | ( | TrajectoryPlannerTest | , |
footprintObstacles | |||
) |
TEST | ( | TrajectoryPlannerTest | , |
checkGoalDistance | |||
) |
TEST | ( | TrajectoryPlannerTest | , |
checkPathDistance | |||
) |
TrajectoryPlannerTest* tct = NULL |