Class Node
Defined in File node.hpp
Inheritance Relationships
Base Type
public rclcpp::Node
Class Documentation
-
class Node : public rclcpp::Node
Public Functions
-
explicit Node(const rclcpp::NodeOptions &options)
Protected Functions
-
void update_params(const rosgraph_monitor::Params ¶ms)
-
void publish_diagnostics()
-
void publish_rosgraph(rosgraph_monitor_msgs::msg::Graph rosgraph_msg)
-
QueryParamsReturnType query_params(const std::string &node_name, std::function<void(const rcl_interfaces::msg::ListParametersResult&)> callback)
Protected Attributes
-
rosgraph_monitor::ParamListener param_listener_
-
rosgraph_monitor::Params params_
-
RosGraphMonitor graph_monitor_
-
rclcpp::Subscription<rosgraph_monitor_msgs::msg::TopicStatistics>::SharedPtr sub_topic_statistics_
-
rclcpp::Publisher<diagnostic_msgs::msg::DiagnosticArray>::SharedPtr pub_diagnostics_
-
rclcpp::Publisher<rosgraph_monitor_msgs::msg::Graph>::SharedPtr pub_rosgraph_
-
rclcpp::TimerBase::SharedPtr timer_publish_report_
-
explicit Node(const rclcpp::NodeOptions &options)