Actionlib server for footstep planning. More...
#include <footstep_planner.h>
Actionlib server for footstep planning.
Definition at line 72 of file footstep_planner.h.
typedef FootstepPlannerConfig jsk_footstep_planner::FootstepPlanner::Config |
Definition at line 76 of file footstep_planner.h.
typedef boost::shared_ptr<FootstepPlanner> jsk_footstep_planner::FootstepPlanner::Ptr |
Definition at line 75 of file footstep_planner.h.
Definition at line 45 of file footstep_planner.cpp.
void jsk_footstep_planner::FootstepPlanner::buildGraph | ( | ) | [protected, virtual] |
Definition at line 976 of file footstep_planner.cpp.
bool jsk_footstep_planner::FootstepPlanner::collisionBoundingBoxInfoService | ( | jsk_footstep_planner::CollisionBoundingBoxInfo::Request & | req, |
jsk_footstep_planner::CollisionBoundingBoxInfo::Response & | res | ||
) | [protected, virtual] |
Definition at line 235 of file footstep_planner.cpp.
void jsk_footstep_planner::FootstepPlanner::configCallback | ( | Config & | config, |
uint32_t | level | ||
) | [protected, virtual] |
Definition at line 886 of file footstep_planner.cpp.
double jsk_footstep_planner::FootstepPlanner::followPathLineHeuristic | ( | SolverNode< FootstepState, FootstepGraph >::Ptr | node, |
FootstepGraph::Ptr | graph | ||
) | [protected, virtual] |
Definition at line 778 of file footstep_planner.cpp.
void jsk_footstep_planner::FootstepPlanner::obstacleCallback | ( | const sensor_msgs::PointCloud2::ConstPtr & | msg | ) | [protected, virtual] |
Definition at line 110 of file footstep_planner.cpp.
void jsk_footstep_planner::FootstepPlanner::planCB | ( | const jsk_footstep_msgs::PlanFootstepsGoal::ConstPtr & | goal | ) | [protected, virtual] |
Definition at line 410 of file footstep_planner.cpp.
void jsk_footstep_planner::FootstepPlanner::pointcloudCallback | ( | const sensor_msgs::PointCloud2::ConstPtr & | msg | ) | [protected, virtual] |
Definition at line 122 of file footstep_planner.cpp.
void jsk_footstep_planner::FootstepPlanner::profile | ( | FootstepAStarSolver< FootstepGraph > & | solver, |
FootstepGraph::Ptr | graph | ||
) | [protected, virtual] |
Definition at line 732 of file footstep_planner.cpp.
bool jsk_footstep_planner::FootstepPlanner::projectFootPrint | ( | const Eigen::Affine3f & | center_pose, |
const Eigen::Affine3f & | left_pose_trans, | ||
const Eigen::Affine3f & | right_pose_trans, | ||
geometry_msgs::Pose & | pose | ||
) | [protected, virtual] |
Definition at line 135 of file footstep_planner.cpp.
bool jsk_footstep_planner::FootstepPlanner::projectFootPrintService | ( | jsk_interactive_marker::SnapFootPrint::Request & | req, |
jsk_interactive_marker::SnapFootPrint::Response & | res | ||
) | [protected, virtual] |
Definition at line 315 of file footstep_planner.cpp.
bool jsk_footstep_planner::FootstepPlanner::projectFootPrintWithLocalSearchService | ( | jsk_interactive_marker::SnapFootPrint::Request & | req, |
jsk_interactive_marker::SnapFootPrint::Response & | res | ||
) | [protected, virtual] |
Definition at line 175 of file footstep_planner.cpp.
bool jsk_footstep_planner::FootstepPlanner::projectFootstepService | ( | jsk_footstep_planner::ProjectFootstep::Request & | req, |
jsk_footstep_planner::ProjectFootstep::Response & | res | ||
) | [protected, virtual] |
Definition at line 247 of file footstep_planner.cpp.
void jsk_footstep_planner::FootstepPlanner::publishPointCloud | ( | const pcl::PointCloud< pcl::PointNormal > & | cloud, |
ros::Publisher & | pub, | ||
const std_msgs::Header & | header | ||
) | [protected, virtual] |
Definition at line 721 of file footstep_planner.cpp.
void jsk_footstep_planner::FootstepPlanner::publishText | ( | ros::Publisher & | pub, |
const std::string & | text, | ||
PlanningStatus | status | ||
) | [protected, virtual] |
Definition at line 369 of file footstep_planner.cpp.
bool jsk_footstep_planner::FootstepPlanner::readSuccessors | ( | ros::NodeHandle & | nh | ) | [protected, virtual] |
format is successors:
Definition at line 795 of file footstep_planner.cpp.
void jsk_footstep_planner::FootstepPlanner::setHeuristicPathLine | ( | jsk_recognition_utils::PolyLine & | path_line | ) | [virtual] |
Definition at line 996 of file footstep_planner.cpp.
bool jsk_footstep_planner::FootstepPlanner::setHeuristicPathService | ( | jsk_footstep_planner::SetHeuristicPath::Request & | req, |
jsk_footstep_planner::SetHeuristicPath::Response & | res | ||
) | [protected, virtual] |
Definition at line 348 of file footstep_planner.cpp.
double jsk_footstep_planner::FootstepPlanner::stepCostHeuristic | ( | SolverNode< FootstepState, FootstepGraph >::Ptr | node, |
FootstepGraph::Ptr | graph | ||
) | [protected, virtual] |
Definition at line 753 of file footstep_planner.cpp.
double jsk_footstep_planner::FootstepPlanner::straightHeuristic | ( | SolverNode< FootstepState, FootstepGraph >::Ptr | node, |
FootstepGraph::Ptr | graph | ||
) | [protected, virtual] |
Definition at line 766 of file footstep_planner.cpp.
double jsk_footstep_planner::FootstepPlanner::straightRotationHeuristic | ( | SolverNode< FootstepState, FootstepGraph >::Ptr | node, |
FootstepGraph::Ptr | graph | ||
) | [protected, virtual] |
Definition at line 772 of file footstep_planner.cpp.
double jsk_footstep_planner::FootstepPlanner::zeroHeuristic | ( | SolverNode< FootstepState, FootstepGraph >::Ptr | node, |
FootstepGraph::Ptr | graph | ||
) | [protected, virtual] |
Definition at line 760 of file footstep_planner.cpp.
actionlib::SimpleActionServer<jsk_footstep_msgs::PlanFootstepsAction> jsk_footstep_planner::FootstepPlanner::as_ [protected] |
Definition at line 136 of file footstep_planner.h.
int jsk_footstep_planner::FootstepPlanner::close_list_theta_num_ [protected] |
Definition at line 176 of file footstep_planner.h.
int jsk_footstep_planner::FootstepPlanner::close_list_x_num_ [protected] |
Definition at line 174 of file footstep_planner.h.
int jsk_footstep_planner::FootstepPlanner::close_list_y_num_ [protected] |
Definition at line 175 of file footstep_planner.h.
Eigen::Affine3f jsk_footstep_planner::FootstepPlanner::collision_bbox_offset_ [protected] |
Definition at line 154 of file footstep_planner.h.
Eigen::Vector3f jsk_footstep_planner::FootstepPlanner::collision_bbox_size_ [protected] |
Definition at line 153 of file footstep_planner.h.
double jsk_footstep_planner::FootstepPlanner::cost_weight_ [protected] |
Definition at line 181 of file footstep_planner.h.
double jsk_footstep_planner::FootstepPlanner::footstep_size_x_ [protected] |
Definition at line 172 of file footstep_planner.h.
double jsk_footstep_planner::FootstepPlanner::footstep_size_y_ [protected] |
Definition at line 173 of file footstep_planner.h.
Definition at line 151 of file footstep_planner.h.
Definition at line 178 of file footstep_planner.h.
double jsk_footstep_planner::FootstepPlanner::heuristic_first_rotation_weight_ [protected] |
Definition at line 179 of file footstep_planner.h.
double jsk_footstep_planner::FootstepPlanner::heuristic_second_rotation_weight_ [protected] |
Definition at line 180 of file footstep_planner.h.
double jsk_footstep_planner::FootstepPlanner::heuristic_weight_ [protected] |
Definition at line 182 of file footstep_planner.h.
Eigen::Vector3f jsk_footstep_planner::FootstepPlanner::inv_lleg_footstep_offset_ [protected] |
Definition at line 155 of file footstep_planner.h.
Eigen::Vector3f jsk_footstep_planner::FootstepPlanner::inv_rleg_footstep_offset_ [protected] |
Definition at line 156 of file footstep_planner.h.
Definition at line 157 of file footstep_planner.h.
Definition at line 135 of file footstep_planner.h.
pcl::PointCloud<pcl::PointXYZ>::Ptr jsk_footstep_planner::FootstepPlanner::obstacle_model_ [protected] |
Definition at line 150 of file footstep_planner.h.
Definition at line 183 of file footstep_planner.h.
Definition at line 159 of file footstep_planner.h.
double jsk_footstep_planner::FootstepPlanner::planning_timeout_ [protected] |
Definition at line 184 of file footstep_planner.h.
pcl::PointCloud<pcl::PointNormal>::Ptr jsk_footstep_planner::FootstepPlanner::pointcloud_model_ [protected] |
Definition at line 149 of file footstep_planner.h.
Definition at line 183 of file footstep_planner.h.
int jsk_footstep_planner::FootstepPlanner::profile_period_ [protected] |
Definition at line 177 of file footstep_planner.h.
bool jsk_footstep_planner::FootstepPlanner::project_goal_state_ [protected] |
Definition at line 164 of file footstep_planner.h.
bool jsk_footstep_planner::FootstepPlanner::project_start_state_ [protected] |
Definition at line 163 of file footstep_planner.h.
Definition at line 139 of file footstep_planner.h.
Definition at line 140 of file footstep_planner.h.
Definition at line 141 of file footstep_planner.h.
double jsk_footstep_planner::FootstepPlanner::resolution_theta_ [protected] |
Definition at line 171 of file footstep_planner.h.
double jsk_footstep_planner::FootstepPlanner::resolution_x_ [protected] |
Definition at line 169 of file footstep_planner.h.
double jsk_footstep_planner::FootstepPlanner::resolution_y_ [protected] |
Definition at line 170 of file footstep_planner.h.
jsk_footstep_msgs::PlanFootstepsResult jsk_footstep_planner::FootstepPlanner::result_ [protected] |
Definition at line 137 of file footstep_planner.h.
bool jsk_footstep_planner::FootstepPlanner::rich_profiling_ [protected] |
Definition at line 162 of file footstep_planner.h.
boost::shared_ptr<dynamic_reconfigure::Server<Config> > jsk_footstep_planner::FootstepPlanner::srv_ [protected] |
Definition at line 138 of file footstep_planner.h.
ros::ServiceServer jsk_footstep_planner::FootstepPlanner::srv_collision_bounding_box_info_ [protected] |
Definition at line 146 of file footstep_planner.h.
Definition at line 144 of file footstep_planner.h.
ros::ServiceServer jsk_footstep_planner::FootstepPlanner::srv_project_footprint_with_local_search_ [protected] |
Definition at line 145 of file footstep_planner.h.
Definition at line 147 of file footstep_planner.h.
Definition at line 148 of file footstep_planner.h.
Definition at line 143 of file footstep_planner.h.
Definition at line 142 of file footstep_planner.h.
std::vector<Eigen::Affine3f> jsk_footstep_planner::FootstepPlanner::successors_ [protected] |
Definition at line 152 of file footstep_planner.h.
bool jsk_footstep_planner::FootstepPlanner::use_lazy_perception_ [protected] |
Definition at line 166 of file footstep_planner.h.
bool jsk_footstep_planner::FootstepPlanner::use_local_movement_ [protected] |
Definition at line 167 of file footstep_planner.h.
bool jsk_footstep_planner::FootstepPlanner::use_obstacle_model_ [protected] |
Definition at line 168 of file footstep_planner.h.
bool jsk_footstep_planner::FootstepPlanner::use_pointcloud_model_ [protected] |
Definition at line 165 of file footstep_planner.h.