EnvIntervalLat Member List

This is the complete list of members for EnvIntervalLat, including all inherited members.
affectedpredstatesVEnvIntervalLattice [protected]
affectedsuccstatesVEnvIntervalLattice [protected]
bNeedtoRecomputeGoalHeuristicsEnvIntervalLattice [protected]
bNeedtoRecomputeStartHeuristicsEnvIntervalLattice [protected]
CalculateFootprintForPose(SBPL_4Dpt_t pose, vector< SBPL_4Dcell_t > *footprint)EnvIntervalLattice [protected]
CheckQuant(FILE *fOut)EnvIntervalLattice [protected]
ClearStates()EnvIntervalLat [protected]
ComputeHeuristicValues()EnvIntervalLattice [protected]
ComputeReplanningData()EnvIntervalLattice [protected]
ComputeReplanningDataforAction(envIntervalLatAction_t *action)EnvIntervalLattice [protected]
ConvertStateIDPathintoXYThetaPath(vector< int > *stateIDPath, vector< SBPL_4Dpt_t > *xythetaPath)EnvIntervalLat [virtual]
Coord2StateIDHashTableEnvIntervalLat [protected]
CreateNewHashEntry(int X, int Y, int Theta, int interval, int T, bool Opt)EnvIntervalLat [protected]
CreateStartandGoalStates()EnvIntervalLattice [protected]
dumpDynamicObstaclesToFile()EnvIntervalLat
dumpEnvironmentToFile()EnvIntervalLat
dumpStatesToFile()EnvIntervalLat
dynamicObstaclesEnvIntervalLattice [protected]
envIntervalLatEnvIntervalLattice [protected]
envIntervalLatCfgEnvIntervalLattice [protected]
EnvIntervalLattice()EnvIntervalLattice
EuclideanDistance_m(int X1, int Y1, int X2, int Y2)EnvIntervalLattice [protected]
FillInBubble(int CenterX, int CenterY, int T, int rad)EnvIntervalLattice [protected]
FillInBubbleCell(int x, int y, int T)EnvIntervalLattice [protected]
FillInBubbleColumn(int x, int topY, int botY, int T)EnvIntervalLattice [protected]
GetActionCost(int SourceX, int SourceY, int SourceTheta, envIntervalLatAction_t *action)EnvIntervalLattice [protected, virtual]
getArrivalTimeToInterval(envIntervalLatHashEntry_t *state, envIntervalLatAction_t *action, int start_t, int end_t)EnvIntervalLattice [protected]
GetCoordFromState(int stateID, int &x, int &y, int &theta, int &t) const EnvIntervalLat [virtual]
GetCoordFromState(int stateID, int &x, int &y, int &theta, int &t, bool &opt) const EnvIntervalLat
getEntryFromID(int id)EnvIntervalLat [protected, virtual]
GetEnvNavConfig()EnvIntervalLattice
GetEnvParameter(const char *parameter)EnvIntervalLattice [virtual]
GetEnvParms(int *size_x, int *size_y, double *startx, double *starty, double *starttheta, double *startTime, double *goalx, double *goaly, double *goaltheta, double *cellsize_m, double *timeResolution, double *temporal_padding_, double *nominalvel_mpersecs, double *timetoturn45degsinplace_secs, unsigned char *obsthresh, unsigned char *dyn_obs_thresh, vector< SBPL_xythetainterval_mprimitive > *motionprimitiveV)EnvIntervalLattice
getExpansions(vector< SBPL_4Dpt_t > *p)EnvIntervalLat [virtual]
GetFromToHeuristic(int FromStateID, int ToStateID)EnvIntervalLat [virtual]
GetGoalHeuristic(int stateID)EnvIntervalLat [virtual]
getGoalID()EnvIntervalLattice
GETHASHBIN(unsigned int X, unsigned int Y, unsigned int Theta, unsigned int interval, bool Opt)EnvIntervalLat [protected]
GetHashEntry(int X, int Y, int Theta, int interval, int T, bool Opt)EnvIntervalLat [protected]
getInterval(int x, int y, int t)EnvIntervalLattice [protected]
getIntervals(vector< int > *intervals, vector< int > *times, envIntervalLatHashEntry_t *state, envIntervalLatAction_t *action)EnvIntervalLattice [protected]
GetMapCost(int x, int y)EnvIntervalLattice [virtual]
GetPreds(int TargetStateID, vector< int > *PredIDV, vector< int > *CostV)EnvIntervalLat [protected, virtual]
GetPredsofChangedEdges(vector< nav2dcell_t > const *changedcellsV, vector< int > *preds_of_changededgesIDV)EnvIntervalLat [protected, virtual]
GetStartHeuristic(int stateID)EnvIntervalLat [virtual]
getStartID()EnvIntervalLattice
GetStateFromCoord(int x, int y, int theta, int t)EnvIntervalLat
GetSuccs(int SourceStateID, vector< int > *SuccIDV, vector< int > *CostV, vector< bool > *OptV, bool optSearch, vector< envIntervalLatAction_t * > *actionV=NULL)EnvIntervalLat [virtual]
EnvIntervalLattice::GetSuccs(int SourceStateID, vector< int > *SuccIDV, vector< int > *CostV, vector< bool > *OptV, bool optSearch)EnvIntervalLattice [protected, virtual]
DiscreteSpaceTimeIntervalInformation::GetSuccs(int SourceStateID, vector< int > *SuccIDV, vector< int > *CostV)DiscreteSpaceTimeIntervalInformation [inline, virtual]
GetSuccsofChangedEdges(vector< nav2dcell_t > const *changedcellsV, vector< int > *succs_of_changededgesIDV)EnvIntervalLat [protected, virtual]
grid2DsearchfromgoalEnvIntervalLattice [protected]
grid2DsearchfromstartEnvIntervalLattice [protected]
HashTableSizeEnvIntervalLat [protected]
InitGeneral(vector< SBPL_xythetainterval_mprimitive > *motionprimitiveV)EnvIntervalLattice [protected]
InitializeEnv(const char *sEnvFile, const vector< sbpl_2Dpt_t > &perimeterptsV, const char *sMotPrimFile, const char *sDynObsFile)EnvIntervalLattice
InitializeEnv(const char *sEnvFile, const vector< sbpl_2Dpt_t > &perimeterptsV, const char *sMotPrimFile)EnvIntervalLattice
InitializeEnv(int width, int height, const unsigned char *mapdata, double startx, double starty, double starttheta, double startTime, double goalx, double goaly, double goaltheta, double goaltol_x, double goaltol_y, double goaltol_theta, const vector< sbpl_2Dpt_t > &perimeterptsV, double cellsize_m, double timeResolution, double temporal_padding_c, double nominalvel_mpersecs, double timetoturn45degsinplace_secs, unsigned char obsthresh, unsigned char dynobsthresh, const char *sMotPrimFile, vector< SBPL_DynamicObstacle_t > &dynObs)EnvIntervalLattice [virtual]
InitializeEnv(const char *sEnvFile)EnvIntervalLattice [protected]
InitializeEnv(int width, int height, const unsigned char *mapdata, double startx, double starty, double starttheta, double startTime, double goalx, double goaly, double goaltheta, double goaltol_x, double goaltol_y, double goaltol_theta, const vector< sbpl_2Dpt_t > &perimeterptsV, double cellsize_m, double timeResolution, double temporal_padding_c, double nominalvel_mpersecs, double timetoturn45degsinplace_secs, unsigned char obsthresh, unsigned char dynobsthresh, const char *sMotPrimFile)EnvIntervalLattice [protected]
InitializeEnvConfig(vector< SBPL_xythetainterval_mprimitive > *motionprimitiveV)EnvIntervalLattice [protected]
InitializeEnvironment()EnvIntervalLat [protected, virtual]
InitializeMDPCfg(MDPConfig *MDPCfg)EnvIntervalLattice [protected]
InitializeTimelineMap()EnvIntervalLattice [protected]
intervalMapEnvIntervalLattice [protected]
intervals2Timeline(int x, int y)EnvIntervalLattice [protected]
IsObstacle(int x, int y)EnvIntervalLattice
IsValidCell(int X, int Y)EnvIntervalLattice [protected]
IsValidConfiguration(int X, int Y, int Theta)EnvIntervalLattice
IsWithinMapCell(int X, int Y)EnvIntervalLattice
iterationEnvIntervalLattice [protected]
pairCompare(pair< int, int > i, pair< int, int > j)EnvIntervalLattice [inline, protected, static]
PoseContToDisc(double px, double py, double pth, double pt, int &ix, int &iy, int &ith, int &it) const EnvIntervalLattice
PoseDiscToCont(int ix, int iy, int ith, int it, double &px, double &py, double &pth, double &pt) const EnvIntervalLattice
PrecomputeActions()EnvIntervalLattice [protected]
PrecomputeActionswithBaseMotionPrimitive(vector< SBPL_xythetainterval_mprimitive > *motionprimitiveV)EnvIntervalLattice [protected]
PrecomputeActionswithCompleteMotionPrimitive(vector< SBPL_xythetainterval_mprimitive > *motionprimitiveV)EnvIntervalLattice [protected]
PrintEnv_Config(FILE *fOut)EnvIntervalLattice
PrintHashTableHist()EnvIntervalLat [protected]
PrintHeuristicValues()EnvIntervalLattice [protected]
PrintState(int stateID, bool bVerbose, FILE *fOut=NULL)EnvIntervalLat
PrintTimeStat(FILE *fOut)EnvIntervalLattice
PrintVars()EnvIntervalLat [inline, virtual]
ReadConfiguration(FILE *fCfg)EnvIntervalLattice [protected, virtual]
ReadDynamicObstacles(FILE *fDynObs)EnvIntervalLattice [protected]
ReadinCell(SBPL_4Dcell_t *cell, char *fIn)EnvIntervalLattice [protected]
ReadinMotionPrimitive(SBPL_xythetainterval_mprimitive *pMotPrim, FILE *fIn, bool &isWaitMotion)EnvIntervalLattice [protected]
ReadinPose(SBPL_4Dpt_t *pose, char *fIn)EnvIntervalLattice [protected]
ReadMotionPrimitives(FILE *fMotPrims)EnvIntervalLattice [protected]
Relax(int stateID)EnvIntervalLat [virtual]
RemoveSourceFootprint(SBPL_4Dpt_t sourcepose, vector< SBPL_4Dcell_t > *footprint)EnvIntervalLattice [protected]
SetAllActionsandAllOutcomes(CMDPSTATE *state)EnvIntervalLat [protected, virtual]
SetAllPreds(CMDPSTATE *state)EnvIntervalLattice [protected, virtual]
SetConfiguration(int width, int height, const unsigned char *mapdata, int startx, int starty, int starttheta, int startTime, int goalx, int goaly, int goaltheta, double cellsize_m, double timeResolution, double nominalvel_mpersecs, double timetoturn45degsinplace_secs, const vector< sbpl_2Dpt_t > &robot_perimeterV)EnvIntervalLattice [protected]
setDynamicObstacles(vector< SBPL_DynamicObstacle_t > dynObs, bool reset_states=true)EnvIntervalLat [virtual]
SetEnvParameter(const char *parameter, int value)EnvIntervalLattice [virtual]
SetGoal(double x, double y, double theta)EnvIntervalLat [virtual]
SetStart(double x, double y, double theta, double startTime)EnvIntervalLat [virtual]
SizeofCreatedEnv()EnvIntervalLat [virtual]
StateID2CoordTableEnvIntervalLat [protected]
temporal_paddingEnvIntervalLattice [protected]
timelineMapEnvIntervalLattice [protected]
UpdateCost(int x, int y, unsigned char newcost)EnvIntervalLattice [virtual]
UpdateTimelineMap()EnvIntervalLattice [protected]
~EnvIntervalLat()EnvIntervalLat
~EnvIntervalLattice()EnvIntervalLattice
 All Classes Files Functions Variables Typedefs Defines


sbpl_dynamic_planner
Author(s): Michael Phillips, Maxim Likhachev
autogenerated on Fri Jan 11 09:41:06 2013