#include <ros/ros.h>
#include <costmap_2d/costmap_2d.h>
#include <geometry_msgs/PoseStamped.h>
#include <geometry_msgs/PoseArray.h>
#include <geometry_msgs/Pose.h>
#include <geometry_msgs/Point.h>
#include <nav_msgs/Path.h>
#include <tf/transform_datatypes.h>
#include <vector>
#include <nav_core/base_global_planner.h>
#include <nav_msgs/GetPlan.h>
#include <dynamic_reconfigure/server.h>
#include <pipeline_planner/PipelinePlannerConfig.h>
#include <pipeline_planner/RobotPosition.h>
#include <pipeline_planner/SegmentInfo.h>
#include <std_msgs/UInt32.h>
#include <std_msgs/Float32.h>
#include <std_msgs/Bool.h>
#include <pipeline_planner/GetReadStatus.h>
#include <pipeline_planner/GetRobotStatus.h>
#include <pipeline_planner/GetCheckpoints.h>
#include <pipeline_planner/GetNumofCheckpoints.h>
#include <pipeline_planner/InquireSegments.h>
#include <pipeline_planner/ReceiveCheckpoints.h>
#include <pipeline_planner/SetARadius.h>
#include <pipeline_planner/SetARightshift.h>
#include <navfn/navfn_ros.h>
#include <move_base_msgs/MoveBaseAction.h>
#include <boost/thread.hpp>
Go to the source code of this file.