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

Go to the source code of this file.

Macros

#define ROSSRVR_IP   "192.168.15.149"
 

Functions

int main ()
 

Variables

ros::Publisher chatter ("chatter", &str_msg)
 
ros::ServiceClient< Test::Request, Test::Response > client ("test_srv")
 
char hello [13] = "hello world!"
 
ros::NodeHandle nh
 
std_msgs::String str_msg
 

Macro Definition Documentation

◆ ROSSRVR_IP

#define ROSSRVR_IP   "192.168.15.149"

Definition at line 22 of file ExampleServiceClient.cpp.

Function Documentation

◆ main()

int main ( )

Definition at line 31 of file ExampleServiceClient.cpp.

Variable Documentation

◆ chatter

ros::Publisher chatter("chatter", &str_msg)

◆ client

ros::ServiceClient<Test::Request, Test::Response> client("test_srv")

◆ hello

char hello[13] = "hello world!"

Definition at line 29 of file ExampleServiceClient.cpp.

◆ nh

Definition at line 20 of file ExampleServiceClient.cpp.

◆ str_msg

std_msgs::String str_msg

Definition at line 26 of file ExampleServiceClient.cpp.



rosserial_embeddedlinux
Author(s): Paul Bouchier
autogenerated on Wed Mar 2 2022 00:58:06