Functions | Variables
HelloROS.cpp File Reference
#include <ros.h>
#include <std_msgs/String.h>
#include <stdio.h>
Include dependency graph for HelloROS.cpp:

Go to the source code of this file.

Functions

int main ()
 

Variables

ros::Publisher chatter ("chatter",&str_msg)
 
char hello [13] = "Hello ROS!"
 
ros::NodeHandle nh
 
char * rosSrvrIp = "192.168.15.121"
 
std_msgs::String str_msg
 

Function Documentation

int main ( )

Definition at line 18 of file HelloROS.cpp.

Variable Documentation

ros::Publisher chatter("chatter",&str_msg)
char hello[13] = "Hello ROS!"

Definition at line 16 of file HelloROS.cpp.

Definition at line 10 of file HelloROS.cpp.

char* rosSrvrIp = "192.168.15.121"

Definition at line 15 of file HelloROS.cpp.

std_msgs::String str_msg

Definition at line 12 of file HelloROS.cpp.



rosserial_embeddedlinux
Author(s): Paul Bouchier
autogenerated on Mon Jun 10 2019 14:53:23