#include <converters.hpp>
Public Member Functions | |
BatteryInfoRosToUavcan (ros::NodeHandle &ros_node, UavcanNode &uavcan_node, const char *ros_topic) | |
Private Member Functions | |
void | ros_callback (IN_ROS_MSG_PTR in_ros_msg) override |
Definition at line 280 of file converters.hpp.
|
inline |
Definition at line 286 of file converters.hpp.
|
overrideprivatevirtual |
< Required by PX4
< STATUS_FLAG_IN_USE
< Set to zero if not applicable
< Some fields can be set to NAN if their values are unknown.
< Unused by PX4
< Some fields can be set to NAN if their values are unknown.
< Some fields can be set to NAN if their values are unknown.
< STATE_OF_HEALTH_UNKNOWN
< use best guess if unknown
< 0 - primary battery
Implements RosToUavcanConverter< sensor_msgs::BatteryState, uavcan::equipment::power::BatteryInfo >.
Definition at line 201 of file converters.cpp.