#include <math.h>
#include <boost/bind.hpp>
#include "RRT.h"
#include "PRM.h"
#include "TGT.h"
#include "OmniWheel.h"
#include "ShortcutOptimizer.h"
#include "RandomShortcutOptimizer.h"
#include "ConfigurationSpace.h"
#include "PathPlanner.h"
#include <hrpCorba/OpenHRPCommon.hh>
#include <hrpModel/Body.h>
#include <hrpModel/Link.h>
#include <hrpModel/ModelLoaderUtil.h>
Go to the source code of this file.
Functions | |
void | computeBoundingBox (BodyPtr body, double min[3], double max[3]) |
BodyPtr | createBoundingBoxBody (BodyPtr body) |
bool | setConfigurationToBaseXYTheta (PathPlanner *planner, const Configuration &cfg) |
Variables | |
static const bool | USE_INTERNAL_COLLISION_DETECTOR = true |
void computeBoundingBox | ( | BodyPtr | body, |
double | min[3], | ||
double | max[3] | ||
) |
Definition at line 337 of file hrplib/hrpPlanner/PathPlanner.cpp.
BodyPtr createBoundingBoxBody | ( | BodyPtr | body | ) |
Definition at line 367 of file hrplib/hrpPlanner/PathPlanner.cpp.
bool setConfigurationToBaseXYTheta | ( | PathPlanner * | planner, |
const Configuration & | cfg | ||
) |
Definition at line 61 of file hrplib/hrpPlanner/PathPlanner.cpp.
const bool USE_INTERNAL_COLLISION_DETECTOR = true [static] |
Definition at line 25 of file hrplib/hrpPlanner/PathPlanner.cpp.