Namespaces | Classes | Enumerations | Functions
jsk_footstep_planner Namespace Reference

Namespaces

namespace  projection_state

Classes

class  ANNGrid
 ANNGrid is a class to provide approximate near neighbors search based on 2.5-D representation. All the z values of pointcloud is ignored and it sorted as 2-D array. More...
class  ANNGridCell
class  AStarSolver
class  BestFirstSearchSolver
class  BreadthFirstSearchSolver
class  DepthFirstSearchSolver
class  FootstepAStarSolver
class  FootstepGraph
class  FootstepPlanner
 Actionlib server for footstep planning. More...
class  FootstepState
class  FootstepStateDiscreteCloseList
 FootstepStateDiscreteCloseList is a special clas to use for close list of FootstepState. More...
class  FootstepStateDiscreteCloseListLocal
class  Graph
class  Line2D
class  Node
class  PointCloudModelGenerator
 just a pointcloud generator for sample usage More...
class  SimpleNeighboredGraph
class  SimpleNeighboredNode
class  Solver
class  SolverNode
class  TransitionLimit
class  TransitionLimitXYZRPY

Enumerations

enum  FootstepSupportState { NOT_SUPPORTED, SUPPORTED, CLOSE_TO_SUPPORTED }
enum  PlanningStatus { OK, WARNING, ERROR }

Functions

Eigen::Affine3f affineFromXYYaw (double x, double y, double yaw)
double footstepHeuristicStepCost (SolverNode< FootstepState, FootstepGraph >::Ptr node, FootstepGraph::Ptr graph, double first_rotation_weight, double second_rotation_weight)
double footstepHeuristicStraight (SolverNode< FootstepState, FootstepGraph >::Ptr node, FootstepGraph::Ptr graph)
double footstepHeuristicStraightRotation (SolverNode< FootstepState, FootstepGraph >::Ptr node, FootstepGraph::Ptr graph)
double footstepHeuristicZero (SolverNode< FootstepState, FootstepGraph >::Ptr node, FootstepGraph::Ptr graph)
size_t hash_value (const FootstepState::Ptr &s)
std::string projectStateToString (unsigned int state)

Enumeration Type Documentation

Enumerator:
NOT_SUPPORTED 
SUPPORTED 
CLOSE_TO_SUPPORTED 

Definition at line 70 of file footstep_state.h.

Enumerator:
OK 
WARNING 
ERROR 

Definition at line 61 of file footstep_planner.h.


Function Documentation

Eigen::Affine3f jsk_footstep_planner::affineFromXYYaw ( double  x,
double  y,
double  yaw 
) [inline]

Definition at line 42 of file util.h.

double jsk_footstep_planner::footstepHeuristicStepCost ( SolverNode< FootstepState, FootstepGraph >::Ptr  node,
FootstepGraph::Ptr  graph,
double  first_rotation_weight,
double  second_rotation_weight 
)

Definition at line 280 of file footstep_graph.cpp.

double jsk_footstep_planner::footstepHeuristicStraight ( SolverNode< FootstepState, FootstepGraph >::Ptr  node,
FootstepGraph::Ptr  graph 
)

Definition at line 260 of file footstep_graph.cpp.

double jsk_footstep_planner::footstepHeuristicStraightRotation ( SolverNode< FootstepState, FootstepGraph >::Ptr  node,
FootstepGraph::Ptr  graph 
)

Definition at line 270 of file footstep_graph.cpp.

double jsk_footstep_planner::footstepHeuristicZero ( SolverNode< FootstepState, FootstepGraph >::Ptr  node,
FootstepGraph::Ptr  graph 
)

Definition at line 254 of file footstep_graph.cpp.

size_t jsk_footstep_planner::hash_value ( const FootstepState::Ptr &  s) [inline]

Definition at line 227 of file footstep_state.h.

Definition at line 47 of file footstep_state.cpp.



jsk_footstep_planner
Author(s): Ryohei Ueda
autogenerated on Wed Sep 16 2015 04:37:57