Struct BridgeConfig

Struct Documentation

struct BridgeConfig

Public Members

std::string ros_type_name

The ROS message type (eg std_msgs/msg/String)

std::string ros_topic_name

The ROS topic name to bridge.

std::string gz_type_name

The Gazebo message type (eg ignition.msgs.String) Used with topic bridges.

std::string gz_topic_name

The Gazebo topic name to bridge.

BridgeDirection direction = kDefaultDirection

Connectivity of the bridge.

size_t subscriber_queue_size = kDefaultSubscriberQueue

Depth of the subscriber queue.

size_t publisher_queue_size = kDefaultPublisherQueue

Depth of the publisher queue.

bool is_lazy = kDefaultLazy

Flag to change the “laziness” of the bridge.