Go to the documentation of this file.
33 #ifndef RVIZ_OCCUPANCY_GRID_DISPLAY_H
34 #define RVIZ_OCCUPANCY_GRID_DISPLAY_H
39 #include <boost/shared_ptr.hpp>
40 #include <boost/thread/mutex.hpp>
44 #include <octomap_msgs/Octomap.h>
55 class RosTopicProperty;
73 virtual void update(
float wall_dt,
float ros_dt);
102 typedef std::vector<rviz::PointCloud::Point>
VPoint;
134 template <
typename OcTreeType>
146 #endif //RVIZ_OCCUPANCY_GRID_DISPLAY_H
std::vector< VPoint > VVPoint
rviz::EnumProperty * octree_coloring_property_
rviz::FloatProperty * min_height_property_
virtual void update(float wall_dt, float ros_dt)
void incomingMessageCallback(const octomap_msgs::OctomapConstPtr &msg)
virtual bool updateFromTF()
bool checkType(std::string type_id)
rviz::EnumProperty * octree_render_property_
virtual void onInitialize()
rviz::IntProperty * queue_size_property_
virtual ~OccupancyGridDisplay()
void updateOctreeColorMode()
std::vector< rviz::PointCloud * > cloud_
bool new_points_received_
void updateOctreeRenderMode()
virtual void incomingMessageCallback(const octomap_msgs::OctomapConstPtr &msg)=0
rviz::FloatProperty * alpha_property_
rviz::IntProperty * tree_depth_property_
rviz::FloatProperty * max_height_property_
void setColor(double z_pos, double min_z, double max_z, double color_factor, rviz::PointCloud::Point &point)
std::vector< rviz::PointCloud::Point > VPoint
std::vector< double > box_size_
void setVoxelColor(rviz::PointCloud::Point &newPoint, typename OcTreeType::NodeType &node, double minZ, double maxZ)
boost::shared_ptr< message_filters::Subscriber< octomap_msgs::Octomap > > sub_
rviz::RosTopicProperty * octomap_topic_property_
uint32_t messages_received_