$search

VEXProRangeMotorLoop.cpp File Reference

#include <ros.h>
#include <std_msgs/Int32.h>
#include <stdio.h>
#include <unistd.h>
#include <qegpioint.h>
#include <qemotoruser.h>
Include dependency graph for VEXProRangeMotorLoop.cpp:

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 ()
void motorCb (const std_msgs::Int32 &motor13_msg)

Variables

CQEGpioInt & gpio = CQEGpioInt::GetRef()
CQEMotorUser & motor = CQEMotorUser::GetRef()
ros::Subscriber< std_msgs::Int32 > motorSub ("motor13", motorCb)
ros::NodeHandle nh
std_msgs::Int32 range
char * rosSrvrIp = "192.168.11.9"
ros::Publisher sonar1 ("sonar1",&range)

Define Documentation

#define BIAS   300

Definition at line 35 of file VEXProRangeMotorLoop.cpp.

#define USPI   150

Definition at line 34 of file VEXProRangeMotorLoop.cpp.


Function Documentation

void callback ( unsigned int  io,
struct timeval *  ptv,
void *  userdata 
)

Definition at line 64 of file VEXProRangeMotorLoop.cpp.

unsigned long diff ( struct timeval *  ptv0,
struct timeval *  ptv1 
)

Definition at line 50 of file VEXProRangeMotorLoop.cpp.

int main (  ) 

Definition at line 86 of file VEXProRangeMotorLoop.cpp.

void motorCb ( const std_msgs::Int32 &  motor13_msg  ) 

Definition at line 40 of file VEXProRangeMotorLoop.cpp.


Variable Documentation

CQEGpioInt& gpio = CQEGpioInt::GetRef()

Definition at line 30 of file VEXProRangeMotorLoop.cpp.

CQEMotorUser& motor = CQEMotorUser::GetRef()

Definition at line 29 of file VEXProRangeMotorLoop.cpp.

ros::Subscriber<std_msgs::Int32> motorSub("motor13", motorCb)

Definition at line 26 of file VEXProRangeMotorLoop.cpp.

std_msgs::Int32 range

Definition at line 27 of file VEXProRangeMotorLoop.cpp.

char* rosSrvrIp = "192.168.11.9"

Definition at line 32 of file VEXProRangeMotorLoop.cpp.

ros::Publisher sonar1("sonar1",&range)
 All Classes Namespaces Files Functions Variables Typedefs Enumerations Friends Defines


rosserial_embeddedlinux
Author(s): Paul Bouchier
autogenerated on Sat Mar 2 13:26:17 2013