We read every piece of feedback, and take your input very seriously.
To see all available qualifiers, see our documentation.
1 parent 7ccf1b9 commit 5a83d6bCopy full SHA for 5a83d6b
mainpage.dox
@@ -28,8 +28,8 @@ Here's a simple example of using a Subscriber with a Cache:
28
void myCallback(const robot_msgs::Pose::ConstPtr& pose)
29
{}
30
31
-ros::NodeHandle nh;
32
-message_filters::Subscriber<robot_msgs::Pose> sub(nh, "pose_topic", 1);
+rclcpp::Node::SharedPtr node = std::make_shared<rclcpp::Node>("test_node");
+message_filters::Subscriber<robot_msgs::Pose> sub(nh, "pose_topic");
33
message_filters::Cache<robot_msgs::Pose> cache(sub, 10);
34
cache.registerCallback(myCallback);
35
\endverbatim
0 commit comments