File tree Expand file tree Collapse file tree 1 file changed +1
-7
lines changed
rviz_default_plugins/include/rviz_default_plugins/displays/pointcloud Expand file tree Collapse file tree 1 file changed +1
-7
lines changed Original file line number Diff line number Diff line change @@ -110,15 +110,9 @@ class PointCloud2TransportDisplay : public rviz_common::_RosTopicDisplay
110
110
}
111
111
112
112
try {
113
- auto required_interfaces = std::make_shared<rclcpp::node_interfaces::NodeInterfaces<
114
- rclcpp::node_interfaces::NodeBaseInterface,
115
- rclcpp::node_interfaces::NodeParametersInterface,
116
- rclcpp::node_interfaces::NodeTopicsInterface,
117
- rclcpp::node_interfaces::NodeLoggingInterface>>(*rviz_ros_node_.lock ()->get_raw_node ());
118
-
119
113
subscription_ = std::make_shared<point_cloud_transport::SubscriberFilter>();
120
114
subscription_->subscribe (
121
- required_interfaces ,
115
+ *rviz_ros_node_. lock ()-> get_raw_node () ,
122
116
getPointCloud2BaseTopicFromTopic (topic_property_->getTopicStd ()),
123
117
getPointCloud2TransportFromTopic (topic_property_->getTopicStd ()),
124
118
qos_profile);
You can’t perform that action at this time.
0 commit comments