Skip to content

Commit 5a83d6b

Browse files
committedAug 15, 2018
Update docs to remove nodehandle reference.
1 parent 7ccf1b9 commit 5a83d6b

File tree

1 file changed

+2
-2
lines changed

1 file changed

+2
-2
lines changed
 

‎mainpage.dox

+2-2
Original file line numberDiff line numberDiff line change
@@ -28,8 +28,8 @@ Here's a simple example of using a Subscriber with a Cache:
2828
void myCallback(const robot_msgs::Pose::ConstPtr& pose)
2929
{}
3030

31-
ros::NodeHandle nh;
32-
message_filters::Subscriber<robot_msgs::Pose> sub(nh, "pose_topic", 1);
31+
rclcpp::Node::SharedPtr node = std::make_shared<rclcpp::Node>("test_node");
32+
message_filters::Subscriber<robot_msgs::Pose> sub(nh, "pose_topic");
3333
message_filters::Cache<robot_msgs::Pose> cache(sub, 10);
3434
cache.registerCallback(myCallback);
3535
\endverbatim

0 commit comments

Comments
 (0)