Go to the documentation of this file.
37 #include <nav_2d_msgs/NavGridOfDoubles.h>
38 #include <nav_2d_msgs/NavGridOfDoublesUpdate.h>
99 min_value_ = std::numeric_limits<double>::max();
123 bool extremes_changed =
false;
124 if (bounds == full_bounds)
143 extremes_changed =
true;
148 extremes_changed =
true;
154 if (extremes_changed)
156 updated_bounds.
merge(full_bounds);
162 updated_bounds.
merge(bounds);
167 if (denominator == 0)
void newDataCallback(const nav_core2::UIntBounds &bounds)
Several reusable pieces for displaying polygons.
bool setValue(const QVariant &new_value) override
NavGridInfo getInfo() const
void updateInfo(const NavGridInfo &new_info) override
void setInfo(const NavGridInfo &new_info) override
void mapUpdated(const nav_core2::UIntBounds &updated_bounds)
Custom signal emitted when new map data is received.
Displays a nav_grid (of unspecified type) along the XY plane.
nav_grid::VectorNavGrid< double > double_data_
rviz::FloatProperty * min_property_
#define PLUGINLIB_EXPORT_CLASS(class_type, base_class_type)
nav_grid::VectorNavGrid< unsigned char > panel_data_
virtual float getFloat() const
nav_grid_pub_sub::NavGridOfDoublesSubscriber sub_
Displays a nav_grid of doubles along the XY plane.
NavGridOfDoublesDisplay()
rviz::FloatProperty * ignore_property_
void onUnsubscribe() override
Actual unsubscription logic, called by unsubscribe.
void init(ros::NodeHandle &nh, NewDataCallback callback, const std::string &topic="map", bool nav_grid=true, bool subscribe_to_updates=true)
void onSubscribe(const std::string &topic) override
Actual subscription logic, called by subscribe.
nav_core2::UIntBounds getFullUIntBounds(const nav_grid::NavGridInfo &info)
virtual void setReadOnly(bool read_only)
void resetExtremeValues()
IgnoreType getIgnoreType() const
void setValue(const unsigned int x, const unsigned int y, const T &value) override
void merge(const GenericBounds< unsigned int > &other)
ros::NodeHandle update_nh_
rviz::FloatProperty * max_property_