Class IMarkerSimple
Defined in File imarker_simple.hpp
Class Documentation
-
class IMarkerSimple
Public Functions
-
template<typename NodePtr>
inline IMarkerSimple(NodePtr node, const std::string &imarker_topic_name = "imarker", double scale = 0.2, const geometry_msgs::msg::Pose &initial_pose = getIdentityPose(), const std::string &parent_frame = "world", const rclcpp::QoS &update_pub_qos = rclcpp::QoS(1), const rclcpp::QoS &feedback_sub_qos = rclcpp::QoS(1))
-
geometry_msgs::msg::Pose &getPose()
-
void setPose(const Eigen::Isometry3d &pose)
-
void setPose(const geometry_msgs::msg::Pose &pose)
-
inline void setIMarkerCallback(IMarkerCallback callback)
-
template<typename NodePtr>