rosbag2_performance_benchmarking
C++ API
Class Hierarchy
File Hierarchy
Full C++ API
Namespaces
Namespace config_utils
Namespace msg_utils
Namespace msg_utils::helpers
Namespace rclcpp
Namespace result_utils
Classes and Structs
Struct BagConfig
Struct ProducerConfig
Struct PublisherGroupConfig
Class ByteProducer
Template Class MessageQueue
Template Class MessageProducer
Class ProducerBase
Class ThreadPool
Class WriterBenchmark
Functions
Function config_utils::bag_config_from_node_parameters
Function config_utils::get_number_of_threads_from_node_parameters
Function config_utils::load_qos_configuration
Function config_utils::publisher_groups_from_node_parameters
Function config_utils::wait_for_subscriptions_from_node_parameters
Template Function msg_utils::create
Function msg_utils::helpers::generate_data(rosbag2_performance_benchmarking_msgs::msg::ByteArray&, size_t)
Function msg_utils::helpers::generate_data(sensor_msgs::msg::Image&, size_t)
Function msg_utils::helpers::generate_data(sensor_msgs::msg::PointCloud2&, size_t)
Function result_utils::get_message_count_from_metadata
Function result_utils::write_benchmark_results(const std::vector<PublisherGroupConfig>&, const BagConfig&, const std::string&, float, float, const std::vector<double>&)
Function result_utils::write_benchmark_results(rclcpp::Node&)
Variables
Variable config_utils::DEFAULT_MESSAGE_TYPE
Defines
Define IF_KEY_MATCH_TYPE_CREATE_BENCHMARKING_MSG_PRODUCER_ELSE
Define IF_KEY_MATCH_TYPE_CREATE_MSG_PRODUCER_ELSE
Define IF_KEY_MATCH_TYPE_CREATE_SENSOR_MSG_PRODUCER_ELSE
Typedefs
Typedef ByteMessageQueue
Directories
Directory include
Directory msg_utils
Directory rosbag2_performance_benchmarking
Files
File bag_config.hpp
File byte_producer.hpp
File config_utils.hpp
File helpers.hpp
File message_producer.hpp
File message_producer_factory.hpp
File message_queue.hpp
File producer_config.hpp
File publisher_group_config.hpp
File result_utils.hpp
File thread_pool.hpp
File writer_benchmark.hpp
Standard Documents
CHANGELOG
Changelog for package rosbag2_performance_benchmarking
0.29.0 (2024-09-03)
0.28.0 (2024-06-17)
0.27.0 (2024-04-30)
0.26.1 (2024-04-17)
0.26.0 (2024-04-16)
0.25.0 (2024-03-27)
0.24.0 (2023-07-11)
0.23.0 (2023-04-28)
0.22.0 (2023-04-18)
0.21.0 (2023-04-12)
0.20.0 (2023-02-14)
0.19.0 (2023-01-13)
0.18.0 (2022-11-15)
0.17.0 (2022-07-30)
0.16.0 (2022-05-11)
0.15.1 (2022-04-06)
0.15.0 (2022-04-05)
0.14.1 (2022-03-29)
0.14.0 (2022-03-29)
0.13.0 (2022-01-13)
0.12.0 (2021-12-17)
0.11.0 (2021-11-08)
0.10.1 (2021-10-22)
0.10.0 (2021-10-19)
0.9.0 (2021-05-17)
0.8.0 (2021-04-19)
0.7.0 (2021-03-18)
0.6.0 (2021-02-01)
0.5.0 (2020-12-02)
0.4.0 (2020-11-19)
0.3.2 (2020-06-03)
0.3.1 (2020-06-01)
0.3.0 (2020-05-26)
0.2.8 (2020-05-18)
0.2.7 (2020-05-12)
0.2.6 (2020-05-07)
0.2.5 (2020-04-30)
0.2.4 (2019-11-18 17:51)
0.2.3 (2019-11-18 13:55)
0.2.2 (2019-11-13)
0.2.1 (2019-10-23)
0.2.0 (2019-09-26)
0.1.2 (2019-05-20)
0.1.1 (2019-05-09)
0.1.0 (2019-05-08)
0.0.5 (2018-12-27)
0.0.4 (2018-12-19)
0.0.3 (2018-12-14)
0.0.2 (2018-12-12)
0.0.1 (2018-12-11)
PACKAGE
README
Rosbag2 writer benchmarking
How it works
Building
General knowledge: I/O benchmarking
Index
rosbag2_performance_benchmarking
C++ API
Function msg_utils::helpers::generate_data(sensor_msgs::msg::Image&, size_t)
View page source
Function msg_utils::helpers::generate_data(sensor_msgs::msg::Image&, size_t)
Defined in
File helpers.hpp
Function Documentation
void
msg_utils
::
helpers
::
generate_data
(
sensor_msgs
::
msg
::
Image
&
msg
,
size_t
size
)