#include "ros/ros.h"
#include <stdio.h>
#include <stdlib.h>
#include <string.h>
#include <errno.h>
#include <math.h>
#include <sstream>
#include <serial.h>
#include "std_msgs/String.h"
#include "std_msgs/MultiArrayLayout.h"
#include "std_msgs/MultiArrayDimension.h"
#include "std_msgs/Int32MultiArray.h"
#include "std_msgs/Int32.h"
#include "std_msgs/Float32.h"
#include "std_msgs/Bool.h"
#include "mrp2_display/gpio.h"
Go to the source code of this file.
Functions | |
void | analog_read () |
void | batteryVoltCallback (const std_msgs::Float32::ConstPtr &volt) |
void | beep (void) |
void | bumpersCallback (const std_msgs::Int32MultiArray::ConstPtr &bumpers) |
void | estopBtnCallback (const std_msgs::Bool::ConstPtr &stat) |
void | estopCallback (const std_msgs::Bool::ConstPtr &stat) |
bool | gpio (mrp2_display::gpio::Request &req, mrp2_display::gpio::Response &res) |
int | main (int argc, char **argv) |
Variables | |
ros::Subscriber | battery_volt_sub |
ros::Subscriber | bumpers_sub |
ros::Subscriber | estop_btn_sub |
ros::Subscriber | estop_sub |
ros::Publisher | inputs_pub |
bool | last_estop = false |
bool | last_estop_btn = false |
bool | last_fl = false |
bool | last_fr = false |
bool | last_rl = false |
bool | last_rr = false |
double | last_volt = 0.0 |
void analog_read | ( | ) |
Definition at line 51 of file display.cpp.
void batteryVoltCallback | ( | const std_msgs::Float32::ConstPtr & | volt | ) |
Definition at line 124 of file display.cpp.
void beep | ( | void | ) |
Definition at line 45 of file display.cpp.
void bumpersCallback | ( | const std_msgs::Int32MultiArray::ConstPtr & | bumpers | ) |
Definition at line 135 of file display.cpp.
void estopBtnCallback | ( | const std_msgs::Bool::ConstPtr & | stat | ) |
Definition at line 99 of file display.cpp.
void estopCallback | ( | const std_msgs::Bool::ConstPtr & | stat | ) |
Definition at line 108 of file display.cpp.
bool gpio | ( | mrp2_display::gpio::Request & | req, |
mrp2_display::gpio::Response & | res | ||
) |
Definition at line 36 of file display.cpp.
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 183 of file display.cpp.
Definition at line 20 of file display.cpp.
Definition at line 19 of file display.cpp.
Definition at line 21 of file display.cpp.
Definition at line 22 of file display.cpp.
Definition at line 24 of file display.cpp.
bool last_estop = false |
Definition at line 33 of file display.cpp.
bool last_estop_btn = false |
Definition at line 32 of file display.cpp.
bool last_fl = false |
Definition at line 28 of file display.cpp.
bool last_fr = false |
Definition at line 27 of file display.cpp.
bool last_rl = false |
Definition at line 30 of file display.cpp.
bool last_rr = false |
Definition at line 29 of file display.cpp.
double last_volt = 0.0 |
Definition at line 26 of file display.cpp.