#include <ros.h>
#include <std_msgs/Int32.h>
#include <stdio.h>
#include "qemotoruser.h"
Go to the source code of this file.
Functions | |
int | main () |
void | messageCb (const std_msgs::Int32 &motor13_msg) |
Variables | |
CQEMotorUser & | motor = CQEMotorUser::GetRef() |
ros::NodeHandle | nh |
char * | rosSrvrIp = "192.168.11.9" |
ros::Subscriber< std_msgs::Int32 > | sub ("motor13", messageCb) |
int main | ( | ) |
Definition at line 33 of file VEXProMotor13Subscribe.cpp.
void messageCb | ( | const std_msgs::Int32 & | motor13_msg | ) |
Definition at line 25 of file VEXProMotor13Subscribe.cpp.
CQEMotorUser& motor = CQEMotorUser::GetRef() |
Definition at line 22 of file VEXProMotor13Subscribe.cpp.
Definition at line 21 of file VEXProMotor13Subscribe.cpp.
char* rosSrvrIp = "192.168.11.9" |
Definition at line 23 of file VEXProMotor13Subscribe.cpp.
ros::Subscriber<std_msgs::Int32> sub("motor13", messageCb) |