jsk_footstep_planner::FootstepGraph Member List
This is the complete list of members for jsk_footstep_planner::FootstepGraph, including all inherited members.
addNode(StatePtr state)jsk_footstep_planner::Graph< FootstepState > [inline, virtual]
clearPerceptionDuration()jsk_footstep_planner::FootstepGraph [inline, virtual]
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 [inline, virtual]
getGoal(int leg)jsk_footstep_planner::FootstepGraph [inline, virtual]
getGoalState()jsk_footstep_planner::Graph< FootstepState > [inline, virtual]
getPerceptionDuration()jsk_footstep_planner::FootstepGraph [inline, virtual]
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 > [inline, virtual]
getTransitionLimit()jsk_footstep_planner::FootstepGraph [inline, virtual]
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]
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 [inline, virtual]
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 [inline, virtual]
max_successor_distance_jsk_footstep_planner::FootstepGraph [protected]
max_successor_rotation_jsk_footstep_planner::FootstepGraph [protected]
maxSuccessorDistance()jsk_footstep_planner::FootstepGraph [inline, virtual]
maxSuccessorRotation()jsk_footstep_planner::FootstepGraph [inline, virtual]
nodes_jsk_footstep_planner::Graph< FootstepState > [protected]
numNodes()jsk_footstep_planner::Graph< FootstepState > [inline, virtual]
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 [inline, virtual]
PathCostFunction typedefjsk_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 typedefjsk_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 [inline, virtual]
setCollisionBBoxSize(const Eigen::Vector3f &size)jsk_footstep_planner::FootstepGraph [inline, virtual]
setGlobalTransitionLimit(TransitionLimit::Ptr limit)jsk_footstep_planner::FootstepGraph [inline, virtual]
setGoalState(FootstepState::Ptr left, FootstepState::Ptr right)jsk_footstep_planner::FootstepGraph [inline, virtual]
Graph< FootstepState >::setGoalState(StatePtr goal)jsk_footstep_planner::Graph< FootstepState > [inline, virtual]
setHeuristicPathLine(jsk_recognition_utils::PolyLine &path_line)jsk_footstep_planner::FootstepGraph [inline]
setLeftGoalState(FootstepState::Ptr goal)jsk_footstep_planner::FootstepGraph [inline, virtual]
setObstacleModel(pcl::PointCloud< pcl::PointXYZ >::Ptr model)jsk_footstep_planner::FootstepGraph [inline, virtual]
setParameters(FootstepParameters &p)jsk_footstep_planner::FootstepGraph [inline, virtual]
setPathCostFunction(PathCostFunction p)jsk_footstep_planner::FootstepGraph [inline, virtual]
setPointCloudModel(pcl::PointCloud< pcl::PointNormal >::Ptr model)jsk_footstep_planner::FootstepGraph [inline, virtual]
setProgressPublisher(ros::NodeHandle &nh, std::string topic)jsk_footstep_planner::FootstepGraph [inline, virtual]
setRightGoalState(FootstepState::Ptr goal)jsk_footstep_planner::FootstepGraph [inline, virtual]
setStartState(StatePtr start)jsk_footstep_planner::Graph< FootstepState > [inline, virtual]
setSuccessorFunction(SuccessorFunction s)jsk_footstep_planner::FootstepGraph [inline, virtual]
setTransitionLimit(TransitionLimit::Ptr limit)jsk_footstep_planner::FootstepGraph [inline, virtual]
start_state_jsk_footstep_planner::Graph< FootstepState > [protected]
StatePtr typedefjsk_footstep_planner::Graph< FootstepState >
StateT typedefjsk_footstep_planner::Graph< FootstepState >
successor_func_jsk_footstep_planner::FootstepGraph [private]
SuccessorFunction typedefjsk_footstep_planner::FootstepGraph
successors(StatePtr target_state)jsk_footstep_planner::FootstepGraph [inline, virtual]
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 [inline, virtual]
usePointCloudModel() const jsk_footstep_planner::FootstepGraph [inline, virtual]
zero_state_jsk_footstep_planner::FootstepGraph [protected]


jsk_footstep_planner
Author(s): Ryohei Ueda
autogenerated on Fri Apr 19 2019 03:45:28