$search

VEXProServoSubscribe.cpp File Reference

#include <ros.h>
#include <std_msgs/Int32.h>
#include <iostream>
#include <qeservo.h>
Include dependency graph for VEXProServoSubscribe.cpp:

Go to the source code of this file.

Functions

int main ()
void messageCb (const std_msgs::Int32 &servo1_msg)

Variables

ros::NodeHandle nh
char * rosSrvrIp = "192.168.15.149"
CQEServo & servo = CQEServo::GetRef()
ros::Subscriber< std_msgs::Int32 > sub ("servo1", messageCb)

Function Documentation

int main (  ) 

Definition at line 27 of file VEXProServoSubscribe.cpp.

void messageCb ( const std_msgs::Int32 &  servo1_msg  ) 

Definition at line 20 of file VEXProServoSubscribe.cpp.


Variable Documentation

Definition at line 16 of file VEXProServoSubscribe.cpp.

char* rosSrvrIp = "192.168.15.149"

Definition at line 18 of file VEXProServoSubscribe.cpp.

CQEServo& servo = CQEServo::GetRef()

Definition at line 17 of file VEXProServoSubscribe.cpp.

ros::Subscriber<std_msgs::Int32> sub("servo1", messageCb)
 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