Skip to content

gazebo::LinearBatteryROSPlugin

Inherits from LinearBatteryPlugin

Public Functions

Name
LinearBatteryROSPlugin()
Constructor.
virtual ~LinearBatteryROSPlugin()
Destructor.
void Load(physics::ModelPtr _parent, sdf::ElementPtr _sdf)
Load module and read parameters from SDF.
virtual void Init()
Initialize Module.
virtual void Reset()
Reset Module.

Protected Functions

Name
void PublishBatteryState()
Publish battery states.

Protected Attributes

Name
boost::scoped_ptr< ros::NodeHandle > rosNode
Pointer to this ROS node's handle.
std::string robotNamespace
Namespace for this ROS node.
sensor_msgs::BatteryState batteryStateMsg
Battery state ROS message.
ros::Timer updateTimer
Connection for callbacks on update world.

Public Functions Documentation

function LinearBatteryROSPlugin

LinearBatteryROSPlugin()

Constructor.

function ~LinearBatteryROSPlugin

virtual ~LinearBatteryROSPlugin()

Destructor.

function Load

void Load(
    physics::ModelPtr _parent,
    sdf::ElementPtr _sdf
)

Load module and read parameters from SDF.

function Init

virtual void Init()

Initialize Module.

function Reset

virtual void Reset()

Reset Module.

Protected Functions Documentation

function PublishBatteryState

void PublishBatteryState()

Publish battery states.

Protected Attributes Documentation

variable rosNode

boost::scoped_ptr< ros::NodeHandle > rosNode;

Pointer to this ROS node's handle.

variable robotNamespace

std::string robotNamespace;

Namespace for this ROS node.

variable batteryStateMsg

sensor_msgs::BatteryState batteryStateMsg;

Battery state ROS message.

variable updateTimer

ros::Timer updateTimer;

Connection for callbacks on update world.


Updated on 2022-06-01 at 12:37:00 +0000


Last update: June 1, 2022
Back to top