Class PointTool

Inheritance Relationships

Base Type

  • public rviz_common::Tool

Class Documentation

class PointTool : public rviz_common::Tool

The Point Tool allows the user to click on a point which gets published as a PointStamped message.

Public Functions

PointTool()
void onInitialize() override
void activate() override
void deactivate() override
int processMouseEvent(rviz_common::ViewportMouseEvent &event) override

Public Slots

void updateTopic()
void updateAutoDeactivate()

Protected Functions

void publishPosition(const Ogre::Vector3 &position) const
void setStatusForPosition(const Ogre::Vector3 &position)

Protected Attributes

QCursor std_cursor_
QCursor hit_cursor_
rclcpp::Publisher<geometry_msgs::msg::PointStamped>::SharedPtr publisher_
rclcpp::Clock::SharedPtr clock_
rviz_common::properties::StringProperty *topic_property_
rviz_common::properties::BoolProperty *auto_deactivate_property_
rviz_common::properties::QosProfileProperty *qos_profile_property_
rclcpp::QoS qos_profile_