Go to the documentation of this file.
51 #ifndef TRIANGLEMESH_DISPLAY_H
52 #define TRIANGLEMESH_DISPLAY_H
61 #include <boost/circular_buffer.hpp>
72 class RosTopicProperty;
80 class TriangleMeshVisual;
143 void incomingMessage(
const mesh_msgs::TriangleMeshStamped::ConstPtr& meshMsg);
172 void processMessage(
const mesh_msgs::TriangleMeshStamped::ConstPtr& meshMsg);
187 boost::circular_buffer<boost::shared_ptr<TriangleMeshVisual> >
m_meshVisuals;
void subscribe()
Set the topics to subscribe.
rviz::FloatProperty * m_scalingFactor
Property to set the size of the normals.
rviz::RosTopicProperty * m_meshTopic
Property to handle topic for meshMsg.
rviz::FloatProperty * m_normalsAlpha
Property to set the transparency of the normals.
rviz::FloatProperty * m_facesAlpha
Property to set faces transparency.
void onInitialize()
Initialises all nessessary things to get started.
size_t m_displayID
DisplayID.
void updateTopic()
Updates the subscribed topic.
void onEnable()
Calls subscribe() if display is enabled.
tf2_ros::MessageFilter< mesh_msgs::TriangleMeshStamped > * m_tfMeshFilter
Messagefilter for meshMsg.
rviz::ColorProperty * m_normalsColor
Property to set the color of the normals.
message_filters::Cache< mesh_msgs::TriangleMeshStamped > * m_synchronizer
Synchronizer for meshMsgs.
rviz::BoolProperty * m_facesTriangleColors
Property to use the triangle colors.
void reset()
Clears whole stored data.
void updateMeshBufferSize()
Sets capacity of trianglemesh_visual.
void incomingMessage(const mesh_msgs::TriangleMeshStamped::ConstPtr &meshMsg)
Tests if messages are valid, calls processMessage().
message_filters::Subscriber< mesh_msgs::TriangleMeshStamped > m_meshSubscriber
Subscriber for meshMsg.
boost::circular_buffer< boost::shared_ptr< TriangleMeshVisual > > m_meshVisuals
Shared pointer to store the created objects of trianglemesh_visual.
rviz::EnumProperty * m_displayType
Property to select the display type.
uint32_t m_messagesReceived
Counter for the received messages.
void updateMesh()
Updates material for each mesh displayed by trianglemesh_visual.
rviz::IntProperty * m_meshBufferSize
Property to set meshBufferSize.
rviz::ColorProperty * m_wireframeColor
Property to set wireframe color.
void updateSynchronizer()
Updates the topic synchronizer.
void processMessage(const mesh_msgs::TriangleMeshStamped::ConstPtr &meshMsg)
Sets data for trianglemesh_visual and updates the mesh.
~TriangleMeshDisplay()
Destructor.
rviz::ColorProperty * m_facesColor
Property to set faces color.
static size_t displayCounter
Counter for the number of displays.
rviz::BoolProperty * m_showNormals
Property to select the normals.
rviz::FloatProperty * m_wireframeAlpha
Property to set wireframe transparency.
void onDisable()
Calls unsubscribe() and reset() if display is disabled.
void unsubscribe()
Unsubscribes all topics.
rviz::BoolProperty * m_facesVertexColors
Property to use the vertex colors.
size_t m_meshCounter
Counter for the meshes.
rviz::BoolProperty * m_showWireframe
Property to select the wireframe.
void fixedFrameChanged()
Sets the fixed frame.
TriangleMeshDisplay()
Constructor.
rviz_mesh_plugin
Author(s): Sebastian Pütz
, Henning Deeken , Marcel Mrozinski , Kristin Schmidt , Jan Philipp Vogtherr
autogenerated on Fri Feb 12 2021 04:03:57