Class TopicEndpointInfo
Defined in File node_graph_interface.hpp
Class Documentation
-
class TopicEndpointInfo
Struct that contains topic endpoint information like the associated node name, node namespace, topic type, endpoint type, endpoint GID, and its QoS.
Public Functions
-
inline explicit TopicEndpointInfo(const rcl_topic_endpoint_info_t &info)
Construct a TopicEndpointInfo from a rcl_topic_endpoint_info_t.
-
std::string &node_name()
Get a mutable reference to the node name.
-
const std::string &node_name() const
Get a const reference to the node name.
-
std::string &node_namespace()
Get a mutable reference to the node namespace.
-
const std::string &node_namespace() const
Get a const reference to the node namespace.
-
std::string &topic_type()
Get a mutable reference to the topic type string.
-
const std::string &topic_type() const
Get a const reference to the topic type string.
-
rclcpp::EndpointType &endpoint_type()
Get a mutable reference to the topic endpoint type.
-
const rclcpp::EndpointType &endpoint_type() const
Get a const reference to the topic endpoint type.
-
std::array<uint8_t, RMW_GID_STORAGE_SIZE> &endpoint_gid()
Get a mutable reference to the GID of the topic endpoint.
-
const std::array<uint8_t, RMW_GID_STORAGE_SIZE> &endpoint_gid() const
Get a const reference to the GID of the topic endpoint.
-
const rclcpp::QoS &qos_profile() const
Get a const reference to the QoS profile of the topic endpoint.
-
rosidl_type_hash_t &topic_type_hash()
Get a mutable reference to the type hash of the topic endpoint.
-
const rosidl_type_hash_t &topic_type_hash() const
Get a const reference to the type hash of the topic endpoint.
-
inline explicit TopicEndpointInfo(const rcl_topic_endpoint_info_t &info)