17#ifndef NAVMAP_RVIZ_PLUGIN__NAVMAP_GOAL_TOOL_HPP_
18#define NAVMAP_RVIZ_PLUGIN__NAVMAP_GOAL_TOOL_HPP_
22#include "geometry_msgs/msg/pose_stamped.hpp"
23#include "rclcpp/rclcpp.hpp"
26#include "rviz_default_plugins/visibility_control.hpp"
34class QosProfileProperty;
52 void onPoseSet(
double x,
double y,
double z,
double theta)
override;
58 rclcpp::Publisher<geometry_msgs::msg::PoseStamped>::SharedPtr publisher_;
59 rclcpp::Clock::SharedPtr clock_;
61 rviz_common::properties::StringProperty * topic_property_;
62 rviz_common::properties::QosProfileProperty * qos_profile_property_;
64 rclcpp::QoS qos_profile_;
Definition navmap_goal_tool.hpp:39
Definition navmap_goal_tool.hpp:32
Definition navmap_goal_tool.hpp:29