, including all inherited members.
addNode(StatePtr state) | jsk_footstep_planner::Graph< FootstepState > | [inline, virtual] |
FootstepGraph(const Eigen::Vector3f &resolution, const bool use_pointcloud_model=false, const bool lazy_projection=true, const bool local_movement=false) | jsk_footstep_planner::FootstepGraph | [inline] |
getGoal(int leg) | jsk_footstep_planner::FootstepGraph | [inline, virtual] |
getGoalState() | jsk_footstep_planner::Graph< FootstepState > | [inline, virtual] |
getStartState() | jsk_footstep_planner::Graph< FootstepState > | [inline, virtual] |
getTransitionLimit() | jsk_footstep_planner::FootstepGraph | [inline, virtual] |
goal_state_ | jsk_footstep_planner::Graph< FootstepState > | [protected] |
Graph() | jsk_footstep_planner::Graph< FootstepState > | [inline] |
grid_search_ | jsk_footstep_planner::FootstepGraph | [protected] |
infoString() const | jsk_footstep_planner::FootstepGraph | [virtual] |
isGoal(StatePtr 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_move_theta_ | jsk_footstep_planner::FootstepGraph | [protected] |
local_move_theta_num_ | jsk_footstep_planner::FootstepGraph | [protected] |
local_move_x_ | jsk_footstep_planner::FootstepGraph | [protected] |
local_move_x_num_ | jsk_footstep_planner::FootstepGraph | [protected] |
local_move_y_ | jsk_footstep_planner::FootstepGraph | [protected] |
local_move_y_num_ | 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] |
pathCost(StatePtr from, StatePtr to, double prev_cost) | jsk_footstep_planner::Graph< FootstepState > | [inline, virtual] |
plane_estimation_max_iterations_ | jsk_footstep_planner::FootstepGraph | [protected] |
plane_estimation_min_inliers_ | jsk_footstep_planner::FootstepGraph | [protected] |
plane_estimation_outlier_threshold_ | jsk_footstep_planner::FootstepGraph | [protected] |
pointcloud_model_ | jsk_footstep_planner::FootstepGraph | [protected] |
pointcloud_model_2d_ | jsk_footstep_planner::FootstepGraph | [protected] |
pos_goal_thr_ | 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] |
rot_goal_thr_ | jsk_footstep_planner::FootstepGraph | [protected] |
setBasicSuccessors(std::vector< Eigen::Affine3f > left_to_right_successors) | jsk_footstep_planner::FootstepGraph | [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] |
setLeftGoalState(FootstepState::Ptr goal) | jsk_footstep_planner::FootstepGraph | [inline, virtual] |
setLocalThetaMovement(double x) | jsk_footstep_planner::FootstepGraph | [inline, virtual] |
setLocalThetaMovementNum(size_t n) | jsk_footstep_planner::FootstepGraph | [inline, virtual] |
setLocalXMovement(double x) | jsk_footstep_planner::FootstepGraph | [inline, virtual] |
setLocalXMovementNum(size_t n) | jsk_footstep_planner::FootstepGraph | [inline, virtual] |
setLocalYMovement(double x) | jsk_footstep_planner::FootstepGraph | [inline, virtual] |
setLocalYMovementNum(size_t n) | jsk_footstep_planner::FootstepGraph | [inline, virtual] |
setPlaneEstimationMaxIterations(int n) | jsk_footstep_planner::FootstepGraph | [inline, virtual] |
setPlaneEstimationMinInliers(int n) | jsk_footstep_planner::FootstepGraph | [inline, virtual] |
setPlaneEstimationOutlierThreshold(double d) | jsk_footstep_planner::FootstepGraph | [inline, virtual] |
setPointCloudModel(pcl::PointCloud< pcl::PointNormal >::Ptr model) | jsk_footstep_planner::FootstepGraph | [inline, virtual] |
setPositionGoalThreshold(double x) | 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] |
setRotationGoalThreshold(double x) | jsk_footstep_planner::FootstepGraph | [inline, virtual] |
setStartState(StatePtr start) | jsk_footstep_planner::Graph< FootstepState > | [inline, virtual] |
setSupportCheckVertexNeighborThreshold(double d) | jsk_footstep_planner::FootstepGraph | [inline, virtual] |
setSupportCheckXSampling(int n) | jsk_footstep_planner::FootstepGraph | [inline, virtual] |
setSupportCheckYSampling(int n) | 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 typedef | jsk_footstep_planner::Graph< FootstepState > | |
StateT typedef | jsk_footstep_planner::Graph< FootstepState > | |
successors(StatePtr target_state) | jsk_footstep_planner::FootstepGraph | [virtual] |
successors_from_left_to_right_ | jsk_footstep_planner::FootstepGraph | [protected] |
successors_from_right_to_left_ | jsk_footstep_planner::FootstepGraph | [protected] |
support_check_vertex_neighbor_threshold_ | jsk_footstep_planner::FootstepGraph | [protected] |
support_check_x_sampling_ | jsk_footstep_planner::FootstepGraph | [protected] |
support_check_y_sampling_ | jsk_footstep_planner::FootstepGraph | [protected] |
transition_limit_ | jsk_footstep_planner::FootstepGraph | [protected] |
tree_model_ | jsk_footstep_planner::FootstepGraph | [protected] |
tree_model_2d_ | jsk_footstep_planner::FootstepGraph | [protected] |
use_pointcloud_model_ | jsk_footstep_planner::FootstepGraph | [protected] |
usePointCloudModel() const | jsk_footstep_planner::FootstepGraph | [inline, virtual] |