File tree Expand file tree Collapse file tree 1 file changed +3
-3
lines changed
rosbag2_transport/src/rosbag2_transport Expand file tree Collapse file tree 1 file changed +3
-3
lines changed Original file line number Diff line number Diff line change @@ -29,7 +29,7 @@ get_storage_options_from_node_params(std::shared_ptr<rclcpp::Node> node)
2929
3030 storage_options.storage_config_uri = node->declare_parameter <std::string>(" config_uri" , " " );
3131
32- auto desc_mbs = param_utils::int_parameter_description (
32+ auto desc_mbs = param_utils::int_param_description (
3333 " Max bagfile size (bytes)" ,
3434 1 ,
3535 std::numeric_limits<int64_t >::max ());
@@ -39,7 +39,7 @@ get_storage_options_from_node_params(std::shared_ptr<rclcpp::Node> node)
3939 desc_mbs);
4040 storage_options.max_bagfile_size = static_cast <uint64_t >(max_bagfile_size_);
4141
42- auto desc_mbd = param_utils::int_parameter_description (
42+ auto desc_mbd = param_utils::int_param_description (
4343 " Max bagfile duration (nanoseconds)" ,
4444 1 ,
4545 std::numeric_limits<int64_t >::max ());
@@ -49,7 +49,7 @@ get_storage_options_from_node_params(std::shared_ptr<rclcpp::Node> node)
4949 desc_mbd);
5050 storage_options.max_bagfile_duration = static_cast <uint64_t >(max_bagfile_duration_);
5151
52- auto desc_mcs = param_utils::int_parameter_description (
52+ auto desc_mcs = param_utils::int_param_description (
5353 " Max chache size (messages)" ,
5454 1 ,
5555 std::numeric_limits<int64_t >::max ());
You can’t perform that action at this time.
0 commit comments