20 #include <std_msgs/UInt8.h> 28 std_msgs::UInt8 fuelTankMsg;
29 fuelTankMsg.data =
static_cast<uint8_t
>(fuelLevelPercentage);
FuelTankSensor(ros::NodeHandle *nh, const char *topic, double period)
ros::NodeHandle * node_handler_
void publish(const boost::shared_ptr< M > &message) const
Publisher advertise(const std::string &topic, uint32_t queue_size, bool latch=false)
ros::Publisher publisher_