#include <ros/ros.h>
#include <geometry_msgs/PoseStamped.h>
#include <geometry_msgs/PoseWithCovarianceStamped.h>
#include <footstep_planner/FootstepPlanner.h>
#include <footstep_planner/State.h>
#include <bipedRobin_msgs/InitialStepsService.h>
#include <bipedRobin_msgs/SetModeService.h>
#include <std_msgs/String.h>
#include <std_srvs/Empty.h>
Go to the source code of this file.
Classes | |
class | footstep_planner::FootstepPlannerNodeNew |
Wrapper class for FootstepPlanner, providing callbacks for the node functionality. More... | |
Namespaces | |
namespace | footstep_planner |