addNode(StatePtr state) | jsk_footstep_planner::Graph< FootstepState > | inlinevirtual |
clearPerceptionDuration() | jsk_footstep_planner::FootstepGraph | inlinevirtual |
collision_bbox_offset_ | jsk_footstep_planner::FootstepGraph | protected |
collision_bbox_size_ | jsk_footstep_planner::FootstepGraph | protected |
finalizeSteps(const StatePtr &last_1_Step, const StatePtr &lastStep, std::vector< StatePtr > &finalizeSteps) | jsk_footstep_planner::FootstepGraph | |
FootstepGraph(const Eigen::Vector3f &resolution, const bool use_pointcloud_model=false, const bool lazy_projection=true, const bool local_movement=false, const bool use_obstacle_model=false) | jsk_footstep_planner::FootstepGraph | inline |
footstepHeuristicFollowPathLine(SolverNode< FootstepState, FootstepGraph >::Ptr node, FootstepGraph::Ptr graph) | jsk_footstep_planner::FootstepGraph | friend |
getGlobalTransitionLimit() | jsk_footstep_planner::FootstepGraph | inlinevirtual |
getGoal(int leg) | jsk_footstep_planner::FootstepGraph | inlinevirtual |
getGoalState() | jsk_footstep_planner::Graph< FootstepState > | inlinevirtual |
getPerceptionDuration() | jsk_footstep_planner::FootstepGraph | inlinevirtual |
getPointIndicesCollidingSphere(const Eigen::Affine3f &c) | jsk_footstep_planner::FootstepGraph | virtual |
getRobotCoords(StatePtr current_state, StatePtr previous_state) const | jsk_footstep_planner::FootstepGraph | virtual |
getStartState() | jsk_footstep_planner::Graph< FootstepState > | inlinevirtual |
getTransitionLimit() | jsk_footstep_planner::FootstepGraph | inlinevirtual |
global_transition_limit_ | jsk_footstep_planner::FootstepGraph | protected |
goal_state_ | jsk_footstep_planner::Graph< FootstepState > | protected |
Graph() | jsk_footstep_planner::Graph< FootstepState > | inline |
grid_search_ | jsk_footstep_planner::FootstepGraph | protected |
heuristic_path_ | jsk_footstep_planner::FootstepGraph | protected |
infoString() const | jsk_footstep_planner::FootstepGraph | virtual |
isColliding(StatePtr current_state, StatePtr previous_state) | jsk_footstep_planner::FootstepGraph | virtual |
isCollidingBox(const Eigen::Affine3f &c, pcl::PointIndices::Ptr candidates) const | jsk_footstep_planner::FootstepGraph | virtual |
isGoal(StatePtr state) | jsk_footstep_planner::FootstepGraph | virtual |
Graph< FootstepState >::isGoal(StatePtr state)=0 | jsk_footstep_planner::Graph< FootstepState > | pure virtual |
isSuccessable(StatePtr current_state, StatePtr previous_state) | jsk_footstep_planner::FootstepGraph | virtual |
lazy_projection_ | jsk_footstep_planner::FootstepGraph | protected |
lazyProjection() const | jsk_footstep_planner::FootstepGraph | inlinevirtual |
left_goal_state_ | jsk_footstep_planner::FootstepGraph | protected |
local_movement_ | jsk_footstep_planner::FootstepGraph | protected |
localMoveFootstepState(FootstepState::Ptr in) | jsk_footstep_planner::FootstepGraph | virtual |
localMovement() const | jsk_footstep_planner::FootstepGraph | inlinevirtual |
max_successor_distance_ | jsk_footstep_planner::FootstepGraph | protected |
max_successor_rotation_ | jsk_footstep_planner::FootstepGraph | protected |
maxSuccessorDistance() | jsk_footstep_planner::FootstepGraph | inlinevirtual |
maxSuccessorRotation() | jsk_footstep_planner::FootstepGraph | inlinevirtual |
nodes_ | jsk_footstep_planner::Graph< FootstepState > | protected |
numNodes() | jsk_footstep_planner::Graph< FootstepState > | inlinevirtual |
obstacle_model_ | jsk_footstep_planner::FootstepGraph | protected |
obstacle_tree_model_ | jsk_footstep_planner::FootstepGraph | protected |
parameters_ | jsk_footstep_planner::FootstepGraph | protected |
path_cost_func_ | jsk_footstep_planner::FootstepGraph | private |
path_cost_original(StatePtr from, StatePtr to, double prev_cost) | jsk_footstep_planner::FootstepGraph | inline |
pathCost(StatePtr from, StatePtr to, double prev_cost) | jsk_footstep_planner::FootstepGraph | inlinevirtual |
PathCostFunction typedef | jsk_footstep_planner::FootstepGraph | |
perception_duration_ | jsk_footstep_planner::FootstepGraph | protected |
pointcloud_model_ | jsk_footstep_planner::FootstepGraph | protected |
pointcloud_model_2d_ | jsk_footstep_planner::FootstepGraph | protected |
projectFootstep(FootstepState::Ptr in) | jsk_footstep_planner::FootstepGraph | virtual |
projectFootstep(FootstepState::Ptr in, unsigned int &state) | jsk_footstep_planner::FootstepGraph | virtual |
projectGoal() | jsk_footstep_planner::FootstepGraph | virtual |
projectStart() | jsk_footstep_planner::FootstepGraph | virtual |
Ptr typedef | jsk_footstep_planner::FootstepGraph | |
pub_progress_ | jsk_footstep_planner::FootstepGraph | protected |
publish_progress_ | jsk_footstep_planner::FootstepGraph | protected |
resolution_ | jsk_footstep_planner::FootstepGraph | protected |
right_goal_state_ | jsk_footstep_planner::FootstepGraph | protected |
setBasicSuccessors(std::vector< Eigen::Affine3f > left_to_right_successors) | jsk_footstep_planner::FootstepGraph | virtual |
setCollisionBBoxOffset(const Eigen::Affine3f &offset) | jsk_footstep_planner::FootstepGraph | inlinevirtual |
setCollisionBBoxSize(const Eigen::Vector3f &size) | jsk_footstep_planner::FootstepGraph | inlinevirtual |
setGlobalTransitionLimit(TransitionLimit::Ptr limit) | jsk_footstep_planner::FootstepGraph | inlinevirtual |
setGoalState(FootstepState::Ptr left, FootstepState::Ptr right) | jsk_footstep_planner::FootstepGraph | inlinevirtual |
Graph< FootstepState >::setGoalState(StatePtr goal) | jsk_footstep_planner::Graph< FootstepState > | inlinevirtual |
setHeuristicPathLine(jsk_recognition_utils::PolyLine &path_line) | jsk_footstep_planner::FootstepGraph | inline |
setLeftGoalState(FootstepState::Ptr goal) | jsk_footstep_planner::FootstepGraph | inlinevirtual |
setObstacleModel(pcl::PointCloud< pcl::PointXYZ >::Ptr model) | jsk_footstep_planner::FootstepGraph | inlinevirtual |
setParameters(FootstepParameters &p) | jsk_footstep_planner::FootstepGraph | inlinevirtual |
setPathCostFunction(PathCostFunction p) | jsk_footstep_planner::FootstepGraph | inlinevirtual |
setPointCloudModel(pcl::PointCloud< pcl::PointNormal >::Ptr model) | jsk_footstep_planner::FootstepGraph | inlinevirtual |
setProgressPublisher(ros::NodeHandle &nh, std::string topic) | jsk_footstep_planner::FootstepGraph | inlinevirtual |
setRightGoalState(FootstepState::Ptr goal) | jsk_footstep_planner::FootstepGraph | inlinevirtual |
setStartState(StatePtr start) | jsk_footstep_planner::Graph< FootstepState > | inlinevirtual |
setSuccessorFunction(SuccessorFunction s) | jsk_footstep_planner::FootstepGraph | inlinevirtual |
setTransitionLimit(TransitionLimit::Ptr limit) | jsk_footstep_planner::FootstepGraph | inlinevirtual |
start_state_ | jsk_footstep_planner::Graph< FootstepState > | protected |
StatePtr typedef | jsk_footstep_planner::Graph< FootstepState > | |
StateT typedef | jsk_footstep_planner::Graph< FootstepState > | |
successor_func_ | jsk_footstep_planner::FootstepGraph | private |
SuccessorFunction typedef | jsk_footstep_planner::FootstepGraph | |
successors(StatePtr target_state) | jsk_footstep_planner::FootstepGraph | inlinevirtual |
successors_from_left_to_right_ | jsk_footstep_planner::FootstepGraph | protected |
successors_from_right_to_left_ | jsk_footstep_planner::FootstepGraph | protected |
successors_original(StatePtr target_state, std::vector< FootstepGraph::StatePtr > &ret) | jsk_footstep_planner::FootstepGraph | |
transition_limit_ | jsk_footstep_planner::FootstepGraph | protected |
tree_model_ | jsk_footstep_planner::FootstepGraph | protected |
tree_model_2d_ | jsk_footstep_planner::FootstepGraph | protected |
use_obstacle_model_ | jsk_footstep_planner::FootstepGraph | protected |
use_pointcloud_model_ | jsk_footstep_planner::FootstepGraph | protected |
useObstacleModel() const | jsk_footstep_planner::FootstepGraph | inlinevirtual |
usePointCloudModel() const | jsk_footstep_planner::FootstepGraph | inlinevirtual |
zero_state_ | jsk_footstep_planner::FootstepGraph | protected |