#include <ros.h>
#include <std_msgs/Int32.h>
#include <stdio.h>
#include <unistd.h>
#include "qegpioint.h"
Go to the source code of this file.
Defines | |
#define | BIAS 300 |
#define | USPI 150 |
Functions | |
void | callback (unsigned int io, struct timeval *ptv, void *userdata) |
unsigned long | diff (struct timeval *ptv0, struct timeval *ptv1) |
int | main () |
Variables | |
ros::NodeHandle | nh |
std_msgs::Int32 | range |
char * | rosSrvrIp = "192.168.11.9" |
ros::Publisher | sonar1 ("sonar1",&range) |
#define BIAS 300 |
Definition at line 24 of file VEXProRangePublish.cpp.
#define USPI 150 |
Definition at line 23 of file VEXProRangePublish.cpp.
void callback | ( | unsigned int | io, |
struct timeval * | ptv, | ||
void * | userdata | ||
) |
Definition at line 36 of file VEXProRangePublish.cpp.
unsigned long diff | ( | struct timeval * | ptv0, |
struct timeval * | ptv1 | ||
) |
Definition at line 26 of file VEXProRangePublish.cpp.
int main | ( | ) |
Definition at line 61 of file VEXProRangePublish.cpp.
Definition at line 17 of file VEXProRangePublish.cpp.
std_msgs::Int32 range |
Definition at line 18 of file VEXProRangePublish.cpp.
char* rosSrvrIp = "192.168.11.9" |
Definition at line 21 of file VEXProRangePublish.cpp.
ros::Publisher sonar1("sonar1",&range) |