Struct Acceleration2DParams

Inheritance Relationships

Base Type

Struct Documentation

struct Acceleration2DParams : public fuse_models::parameters::ParameterBase

Defines the set of parameters required by the Acceleration2D class.

Public Functions

inline virtual void loadFromROS(fuse_core::node_interfaces::NodeInterfaces<fuse_core::node_interfaces::Base, fuse_core::node_interfaces::Logging, fuse_core::node_interfaces::Parameters> interfaces, const std::string &ns)

Method for loading parameter values from ROS.

Parameters:
  • interfaces[in] - The node interfaces with which to load parameters

  • ns[in] - The parameter namespace to use

Public Members

bool disable_checks = {false}
int queue_size = {10}
rclcpp::Duration tf_timeout = {0, 0}

The maximum time to wait for a transform to become available

rclcpp::Duration throttle_period = {0, 0}

The throttle period duration in seconds.

bool throttle_use_wall_time = {false}

Whether to throttle using ros::WallTime or not.

std::string topic = {}
std::string target_frame = {}
std::vector<size_t> indices
fuse_core::Loss::SharedPtr loss