1 #ifndef SBPL_LATTICE_PLANNER_H 2 #define SBPL_LATTICE_PLANNER_H 11 #include <geometry_msgs/PoseStamped.h> 12 #include <visualization_msgs/Marker.h> 18 #include <sbpl/headers.h> 57 virtual bool makePlan(
const geometry_msgs::PoseStamped&
start,
58 const geometry_msgs::PoseStamped& goal,
59 std::vector<geometry_msgs::PoseStamped>& plan);
64 unsigned char costMapCostToSBPLCost(
unsigned char newcost);
65 void publishStats(
int solution_cost,
int solution_size,
66 const geometry_msgs::PoseStamped& start,
67 const geometry_msgs::PoseStamped& goal);
69 unsigned char computeCircumscribedCost();
71 static void transformFootprintToEdges(
const geometry_msgs::Pose& robot_pose,
72 const std::vector<geometry_msgs::Point>& footprint,
73 std::vector<geometry_msgs::Point>& out_footprint);
75 void getFootprintList(
const std::vector<EnvNAVXYTHETALAT3Dpt_t>& sbpl_path,
const std::string& path_frame_id,
76 visualization_msgs::Marker& ma);
81 EnvironmentNAVXYTHETALAT*
env_;
EnvironmentNAVXYTHETALAT * env_
unsigned int current_env_width_
unsigned char circumscribed_cost_
std::string cost_map_topic_
ROSCONSOLE_DECL void initialize()
ros::Publisher stats_publisher_
std::string primitive_filename_
unsigned int current_env_height_
int visualizer_skip_poses_
std::string environment_type_
std::string planner_type_
ros::Publisher sbpl_plan_footprint_pub_
unsigned char lethal_obstacle_
unsigned char inscribed_inflated_obstacle_
bool publish_footprint_path_
costmap_2d::Costmap2DROS * costmap_ros_
virtual ~SBPLLatticePlanner()
std::vector< geometry_msgs::Point > footprint_
unsigned char sbpl_cost_multiplier_