Public Member Functions | |
void | checkGoalDistance () |
void | checkPathDistance () |
void | correctFootprint () |
void | footprintObstacles () |
virtual void | TestBody () |
TrajectoryPlannerTest (MapGrid *g, WavefrontMapAccessor *wave, const costmap_2d::Costmap2D &map, std::vector< geometry_msgs::Point > footprint_spec) | |
Public Attributes | |
CostmapModel | cm |
MapGrid * | map_ |
TrajectoryPlanner | tc |
WavefrontMapAccessor * | wa |
base_local_planner::TrajectoryPlannerTest::TrajectoryPlannerTest | ( | MapGrid * | g, |
WavefrontMapAccessor * | wave, | ||
const costmap_2d::Costmap2D & | map, | ||
std::vector< geometry_msgs::Point > | footprint_spec | ||
) |
void base_local_planner::TrajectoryPlannerTest::checkGoalDistance | ( | ) |
void base_local_planner::TrajectoryPlannerTest::checkPathDistance | ( | ) |
void base_local_planner::TrajectoryPlannerTest::correctFootprint | ( | ) |
void base_local_planner::TrajectoryPlannerTest::footprintObstacles | ( | ) |
|
inlinevirtual |
CostmapModel base_local_planner::TrajectoryPlannerTest::cm |
TrajectoryPlanner base_local_planner::TrajectoryPlannerTest::tc |
WavefrontMapAccessor* base_local_planner::TrajectoryPlannerTest::wa |