#include "ros/ros.h"#include "ros/time.h"#include "std_msgs/Header.h"#include "std_msgs/Float32.h"#include "diagnostic_msgs/DiagnosticStatus.h"#include "diagnostic_msgs/DiagnosticArray.h"#include "diagnostic_msgs/KeyValue.h"#include "sensor_msgs/BatteryState.h"#include <ros/package.h>#include <vector>#include <cmath>#include <stdio.h>#include <stdlib.h>#include <fstream>#include <unistd.h>#include <boost/thread.hpp>#include <boost/lexical_cast.hpp>
Go to the source code of this file.
Functions | |
| float | getBatteryEstimate (double A, double K, double C, float voltage, double cutoffVoltage) |
| std::string | getLocalHostname () |
| int | main (int argc, char **argv) |
| int | sendMail (std::string outboundList, std::string sender) |
| void | voltageCallback (const sensor_msgs::BatteryState::ConstPtr &msg) |
Variables | |
| double | alpha |
| float | voltage |
| float getBatteryEstimate | ( | double | A, |
| double | K, | ||
| double | C, | ||
| float | voltage, | ||
| double | cutoffVoltage | ||
| ) |
Definition at line 46 of file battery_diagnostics.cpp.
Definition at line 34 of file battery_diagnostics.cpp.
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 83 of file battery_diagnostics.cpp.
| int sendMail | ( | std::string | outboundList, |
| std::string | sender | ||
| ) |
Definition at line 59 of file battery_diagnostics.cpp.
| void voltageCallback | ( | const sensor_msgs::BatteryState::ConstPtr & | msg | ) |
Definition at line 30 of file battery_diagnostics.cpp.
| double alpha |
Definition at line 28 of file battery_diagnostics.cpp.
| float voltage |
Definition at line 27 of file battery_diagnostics.cpp.