File tree Expand file tree Collapse file tree 1 file changed +2
-2
lines changed
nav2_ros_common/include/nav2_ros_common Expand file tree Collapse file tree 1 file changed +2
-2
lines changed Original file line number Diff line number Diff line change @@ -313,7 +313,7 @@ class LifecycleNode : public rclcpp_lifecycle::LifecycleNode
313
313
if (bond_heartbeat_period > 0.0 ) {
314
314
RCLCPP_INFO (get_logger (), " Creating bond (%s) to lifecycle manager." , this ->get_name ());
315
315
316
- bond_ = std::make_unique <bond::Bond>(
316
+ bond_ = std::make_shared <bond::Bond>(
317
317
std::string (" bond" ),
318
318
this ->get_name (),
319
319
shared_from_this ());
@@ -392,7 +392,7 @@ class LifecycleNode : public rclcpp_lifecycle::LifecycleNode
392
392
393
393
// Connection to tell that server is still up
394
394
std::unique_ptr<rclcpp::PreShutdownCallbackHandle> rcl_preshutdown_cb_handle_{nullptr };
395
- std::unique_ptr <bond::Bond> bond_{nullptr };
395
+ std::shared_ptr <bond::Bond> bond_{nullptr };
396
396
double bond_heartbeat_period{0.1 };
397
397
rclcpp::TimerBase::SharedPtr autostart_timer_;
398
398
You can’t perform that action at this time.
0 commit comments