File tree Expand file tree Collapse file tree 1 file changed +3
-3
lines changed
rclcpp/src/rclcpp/node_interfaces Expand file tree Collapse file tree 1 file changed +3
-3
lines changed Original file line number Diff line number Diff line change @@ -579,7 +579,7 @@ NodeParameters::declare_parameter(
579
579
bool ignore_override)
580
580
{
581
581
std::lock_guard<std::recursive_mutex> lock (mutex_);
582
- // ParameterMutationRecursionGuard guard(parameter_modification_enabled_);
582
+ ParameterMutationRecursionGuard guard (parameter_modification_enabled_);
583
583
584
584
return declare_parameter_helper (
585
585
name,
@@ -604,7 +604,7 @@ NodeParameters::declare_parameter(
604
604
bool ignore_override)
605
605
{
606
606
std::lock_guard<std::recursive_mutex> lock (mutex_);
607
- // ParameterMutationRecursionGuard guard(parameter_modification_enabled_);
607
+ ParameterMutationRecursionGuard guard (parameter_modification_enabled_);
608
608
609
609
if (rclcpp::PARAMETER_NOT_SET == type) {
610
610
throw std::invalid_argument{
@@ -696,7 +696,7 @@ NodeParameters::set_parameters_atomically(const std::vector<rclcpp::Parameter> &
696
696
{
697
697
std::lock_guard<std::recursive_mutex> lock (mutex_);
698
698
699
- // ParameterMutationRecursionGuard guard(parameter_modification_enabled_);
699
+ ParameterMutationRecursionGuard guard (parameter_modification_enabled_);
700
700
701
701
rcl_interfaces::msg::SetParametersResult result;
702
702
You can’t perform that action at this time.
0 commit comments