Class OccupancyGridDisplay

Inheritance Relationships

Base Type

  • public rviz_common::MessageFilterDisplay< octomap_msgs::msg::Octomap >

Derived Type

Class Documentation

class octomap_rviz_plugins::OccupancyGridDisplay : public rviz_common::MessageFilterDisplay<octomap_msgs::msg::Octomap>

Subclassed by octomap_rviz_plugins::TemplatedOccupancyGridDisplay< OcTreeType >

Public Functions

OccupancyGridDisplay()
void onInitialize() override
void update(float wall_dt, float ros_dt) override
void reset() override

Protected Types

using VPoint = std::vector<rviz_rendering::PointCloud::Point>
using VVPoint = std::vector<VPoint>

Protected Functions

void unsubscribe() override
void setColor(double z_pos, double min_z, double max_z, double color_factor, rviz_rendering::PointCloud::Point &point)
void clear()
virtual bool updateFromTF()

Protected Attributes

std::mutex mutex_
VVPoint new_points_
VVPoint point_buf_
bool new_points_received_ = {false}
std::vector<std::shared_ptr<rviz_rendering::PointCloud>> cloud_
std::vector<double> box_size_
std_msgs::msg::Header header_
rviz_common::properties::EnumProperty *octree_render_property_
rviz_common::properties::EnumProperty *octree_coloring_property_
rviz_common::properties::IntProperty *tree_depth_property_
rviz_common::properties::FloatProperty *alpha_property_
rviz_common::properties::FloatProperty *max_height_property_
rviz_common::properties::FloatProperty *min_height_property_
double color_factor_ = {0.8}