#include <ros/ros.h>
#include <actionlib/server/simple_action_server.h>
#include <sensor_msgs/PointCloud2.h>
#include <jsk_rviz_plugins/OverlayText.h>
#include <jsk_footstep_msgs/FootstepArray.h>
#include <jsk_footstep_msgs/PlanFootstepsAction.h>
#include <jsk_footstep_planner/CollisionBoundingBoxInfo.h>
#include <pcl/kdtree/kdtree_flann.h>
#include "jsk_footstep_planner/grid_perception.h"
Go to the source code of this file.
Classes | |
class | jsk_footstep_planner::GridPathPlanner |
Actionlib server for footstep planning. More... | |
Namespaces | |
namespace | jsk_footstep_planner |
Enumerations | |
enum | jsk_footstep_planner::GridPlanningStatus { jsk_footstep_planner::NONE, jsk_footstep_planner::OK, jsk_footstep_planner::WARNING, jsk_footstep_planner::ERROR } |