30 #ifndef COSTMAP_CSPACE_COSTMAP_3D_LAYER_PLAIN_H 31 #define COSTMAP_CSPACE_COSTMAP_3D_LAYER_PLAIN_H 35 #include <costmap_cspace_msgs/CSpace3D.h> 36 #include <costmap_cspace_msgs/CSpace3DUpdate.h> 37 #include <geometry_msgs/PolygonStamped.h> 38 #include <nav_msgs/OccupancyGrid.h> 48 using Ptr = std::shared_ptr<Costmap3dLayerPlain>;
53 footprint.
v.resize(3);
54 for (
auto& p : footprint.
v)
63 static_cast<double>(config[
"linear_expand"]),
64 static_cast<double>(config[
"linear_spread"]));
70 const nav_msgs::OccupancyGrid::ConstPtr& msg,
76 for (
size_t i = 1; i < map->info.angle; ++i)
84 #endif // COSTMAP_CSPACE_COSTMAP_3D_LAYER_PLAIN_H
static void copyCells(CSpace3DMsg &to, const int &to_x, const int &to_y, const int &to_yaw, const CSpace3DMsg &from, const int &from_x, const int &from_y, const int &from_yaw, const int ©_cell_num)
void generateCSpace(CSpace3DMsg::Ptr map, const nav_msgs::OccupancyGrid::ConstPtr &msg, const UpdatedRegion ®ion) final
std::shared_ptr< CSpace3DMsg > Ptr
void loadConfig(XmlRpc::XmlRpcValue config)
std::shared_ptr< Costmap3dLayerBase > Ptr