File tree Expand file tree Collapse file tree 1 file changed +12
-12
lines changed
rclcpp/src/rclcpp/node_interfaces Expand file tree Collapse file tree 1 file changed +12
-12
lines changed Original file line number Diff line number Diff line change @@ -68,19 +68,19 @@ NodeParameters::NodeParameters(
68
68
// Get paths to yaml files containing initial parameter values
69
69
std::vector<std::string> yaml_paths;
70
70
71
- auto get_yaml_paths = [&yaml_paths, &options] (const rcl_arguments_t * args) {
72
- int num_yaml_files = rcl_arguments_get_param_files_count (args);
73
- if (num_yaml_files > 0 ) {
74
- char ** param_files;
75
- rcl_ret_t ret = rcl_arguments_get_param_files (args, options->allocator , ¶m_files);
76
- if (RCL_RET_OK != ret) {
77
- rclcpp::exceptions::throw_from_rcl_error (ret);
78
- }
79
- for (int i = 0 ; i < num_yaml_files; ++i) {
80
- yaml_paths.emplace_back (param_files[i]);
71
+ auto get_yaml_paths = [&yaml_paths, &options](const rcl_arguments_t * args) {
72
+ int num_yaml_files = rcl_arguments_get_param_files_count (args);
73
+ if (num_yaml_files > 0 ) {
74
+ char ** param_files;
75
+ rcl_ret_t ret = rcl_arguments_get_param_files (args, options->allocator , ¶m_files);
76
+ if (RCL_RET_OK != ret) {
77
+ rclcpp::exceptions::throw_from_rcl_error (ret);
78
+ }
79
+ for (int i = 0 ; i < num_yaml_files; ++i) {
80
+ yaml_paths.emplace_back (param_files[i]);
81
+ }
81
82
}
82
- }
83
- };
83
+ };
84
84
85
85
// global before local so that local overwrites global
86
86
if (options->use_global_arguments ) {
You can’t perform that action at this time.
0 commit comments