Go to the documentation of this file.
112 ROS_INFO_STREAM(
"New height diff layer config through dynamic reconfigure.");
121 if (
config.threshold != cfg.threshold)
136 new dynamic_reconfigure::Server<mesh_layers::HeightDiffLayerConfig>(
private_nh));
#define ROS_ERROR_STREAM(args)
virtual bool writeLayer()
try to write layer to map file
virtual float threshold()
delivers the threshold above which vertices are marked lethal
lvr2::DenseVertexMap< float > height_diff
HeightDiffLayerConfig config
bool computeLethals()
mark vertices with values above the threshold as lethal
#define ROS_INFO_STREAM(args)
virtual bool initialize(const std::string &name)
initializes this layer plugin
DenseVertexMap< float > calcVertexHeightDifferences(const BaseMesh< BaseVecT > &mesh, double radius)
boost::shared_ptr< dynamic_reconfigure::Server< mesh_layers::HeightDiffLayerConfig > > reconfigure_server_ptr
ros::NodeHandle private_nh
std::shared_ptr< lvr2::AttributeMeshIOBase > mesh_io_ptr
std::shared_ptr< lvr2::HalfEdgeMesh< Vector > > mesh_ptr
virtual bool computeLayer()
calculate the values of this layer
void reconfigureCallback(mesh_layers::HeightDiffLayerConfig &cfg, uint32_t level)
callback for incoming reconfigure configs
PLUGINLIB_EXPORT_CLASS(mesh_layers::InflationLayer, mesh_map::AbstractLayer)
virtual bool readLayer()
try read layer from map file
Costmap layer which calculates the height difference to avoid steep regions.
std::set< lvr2::VertexHandle > lethal_vertices
virtual lvr2::VertexMap< float > & costs()
deliver the current costmap
dynamic_reconfigure::Server< mesh_layers::HeightDiffLayerConfig >::CallbackType config_callback
mesh_layers
Author(s): Sebastian Pütz
autogenerated on Thu Jan 25 2024 03:43:03