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

Go to the source code of this file.

Functions

int main ()
 

Variables

ros::Publisher chatter ("chatter", &str_msg)
 
char debug [] = "debug statements"
 
char errors [] = "errors"
 
char fatal [] = "fatalities"
 
char hello [13] = "hello world!"
 
char info [] = "infos"
 
ros::NodeHandle nh
 
std_msgs::String str_msg
 
char warn [] = "warnings"
 

Function Documentation

◆ main()

int main ( void  )

Definition at line 23 of file Logging.cpp.

Variable Documentation

◆ chatter

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

◆ debug

char debug[] = "debug statements"

Definition at line 17 of file Logging.cpp.

◆ errors

char errors[] = "errors"

Definition at line 20 of file Logging.cpp.

◆ fatal

char fatal[] = "fatalities"

Definition at line 21 of file Logging.cpp.

◆ hello

char hello[13] = "hello world!"

Definition at line 15 of file Logging.cpp.

◆ info

char info[] = "infos"

Definition at line 18 of file Logging.cpp.

◆ nh

Definition at line 10 of file Logging.cpp.

◆ str_msg

std_msgs::String str_msg

Definition at line 12 of file Logging.cpp.

◆ warn

char warn[] = "warnings"

Definition at line 19 of file Logging.cpp.



rosserial_mbed
Author(s): Gary Servin
autogenerated on Mon Feb 28 2022 23:35:26