21 #ifndef FOOTSTEP_PLANNER_FOOTSTEPNAVIGATION_H_ 22 #define FOOTSTEP_PLANNER_FOOTSTEPNAVIGATION_H_ 27 #include <geometry_msgs/Pose.h> 28 #include <geometry_msgs/PoseStamped.h> 29 #include <geometry_msgs/PoseWithCovarianceStamped.h> 30 #include <humanoid_nav_msgs/ClipFootstep.h> 31 #include <humanoid_nav_msgs/ExecFootstepsAction.h> 32 #include <humanoid_nav_msgs/ExecFootstepsFeedback.h> 33 #include <humanoid_nav_msgs/PlanFootsteps.h> 34 #include <humanoid_nav_msgs/StepTargetService.h> 35 #include <nav_msgs/Path.h> 36 #include <nav_msgs/OccupancyGrid.h> 57 bool setGoal(
const geometry_msgs::PoseStampedConstPtr goal_pose);
68 const geometry_msgs::PoseStampedConstPtr& goal_pose);
75 void mapCallback(
const nav_msgs::OccupancyGridConstPtr& occupancy_map);
105 const std::string& world_frame_id,
117 const State& to, humanoid_nav_msgs::StepTarget* footstep);
133 const State& current_support_leg,
int starting_step_num,
134 std::vector<humanoid_nav_msgs::StepTarget>& footsteps);
160 const humanoid_nav_msgs::ExecFootstepsResultConstPtr& result);
167 const humanoid_nav_msgs::ExecFootstepsFeedbackConstPtr& fb);
169 bool performable(
const humanoid_nav_msgs::StepTarget& footstep);
187 float b_x,
float b_y,
float b_theta);
255 #endif // FOOTSTEP_PLANNER_FOOTSTEPNAVIGATION_H_