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;
72 virtual void onInitialize();
73 virtual void update(
float wall_dt,
float ros_dt);
77 void updateQueueSize();
79 void updateTreeDepth();
80 void updateOctreeRenderMode();
81 void updateOctreeColorMode();
83 void updateMaxHeight();
84 void updateMinHeight();
88 virtual void onEnable();
89 virtual void onDisable();
94 virtual void incomingMessageCallback(
const octomap_msgs::OctomapConstPtr& msg) = 0;
100 virtual bool updateFromTF();
102 typedef std::vector<rviz::PointCloud::Point>
VPoint;
134 template <
typename OcTreeType>
137 void incomingMessageCallback(
const octomap_msgs::OctomapConstPtr& msg);
138 void setVoxelColor(
rviz::PointCloud::Point& newPoint,
typename OcTreeType::NodeType& node,
double minZ,
double maxZ);
141 bool checkType(std::string type_id);
146 #endif //RVIZ_OCCUPANCY_GRID_DISPLAY_H
rviz::IntProperty * tree_depth_property_
std::vector< rviz::PointCloud * > cloud_
rviz::RosTopicProperty * octomap_topic_property_
rviz::EnumProperty * octree_render_property_
std::vector< rviz::PointCloud::Point > VPoint
std::vector< double > box_size_
rviz::FloatProperty * min_height_property_
rviz::IntProperty * queue_size_property_
rviz::FloatProperty * alpha_property_
void update(const std::string &key, const XmlRpc::XmlRpcValue &v)
boost::shared_ptr< message_filters::Subscriber< octomap_msgs::Octomap > > sub_
uint32_t messages_received_
rviz::FloatProperty * max_height_property_
bool new_points_received_
rviz::EnumProperty * octree_coloring_property_
std::vector< VPoint > VVPoint