Class LockTopicHandle
Defined in File topic_handle.hpp
Inheritance Relationships
Base Type
public twist_mux::TopicHandle_< std_msgs::msg::Bool >
(Template Class TopicHandle_)
Class Documentation
-
class LockTopicHandle : public twist_mux::TopicHandle_<std_msgs::msg::Bool>
Public Types
-
typedef base_type::priority_type priority_type
Public Functions
-
inline LockTopicHandle(const std::string &name, const std::string &topic, const rclcpp::Duration &timeout, priority_type priority, TwistMux *mux)
-
inline bool isLocked() const
isLocked
- Returns:
true if has expired or locked (i.e. bool message data is true)
-
typedef base_type::priority_type priority_type