Template Class PolygonBase

Inheritance Relationships

Base Type

  • public rviz_common::MessageFilterDisplay< T >

Derived Types

Class Documentation

template<typename T>
class PolygonBase : public rviz_common::MessageFilterDisplay<T>

Subclassed by polygon_rviz_plugins::PolygonsBase< polygon_msgs::msg::Polygon2DCollection >, polygon_rviz_plugins::PolygonsBase< polygon_msgs::msg::ComplexPolygon2DCollection >, polygon_rviz_plugins::PolygonsBase< T >

Public Functions

inline PolygonBase()
inline virtual ~PolygonBase()
inline void reset() override

Protected Functions

template<typename RECEIVER_TYPE>
inline void connectProperties(RECEIVER_TYPE receiver, const char *changed_slot)
inline void resetOutlines()
inline void resetFillers()
inline void setPolygons(rviz_common::DisplayContext *context, Ogre::SceneManager *scene_manager, Ogre::SceneNode *scene_node, std::vector<polygon_msgs::msg::Polygon2D> &outlines, std::vector<polygon_msgs::msg::ComplexPolygon2D> &fillers, const std::string &frame_id, const rclcpp::Time &time)
inline void setFillColors(std::vector<std_msgs::msg::ColorRGBA> &filler_colors)
inline void updateProperties()
inline std_msgs::msg::ColorRGBA getFillerColor() const
inline void updateVisibility()
inline void updateOutlineVisibility()
inline void setFillerPropertyVisibility(bool visible)

Protected Attributes

std::vector<PolygonOutline*> outline_objects_
std::vector<polygon_msgs::msg::Polygon2D> saved_outlines_
std::vector<PolygonFill*> filler_objects_
std::vector<polygon_msgs::msg::ComplexPolygon2D> saved_fillers_
std::vector<std_msgs::msg::ColorRGBA> filler_colors_
PolygonMaterial polygon_material_
PolygonDisplayModeProperty *mode_property_
rviz_common::properties::FloatProperty *zoffset_property_
rviz_common::properties::ColorProperty *outline_color_property_
rviz_common::properties::ColorProperty *filler_color_property_
rviz_common::properties::FloatProperty *filler_alpha_property_