#include <ros.h>#include <std_msgs/String.h>#include <std_msgs/Empty.h>
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" |
| int main | ( | void | ) |
Definition at line 23 of file Logging.cpp.
| ros::Publisher chatter("chatter",&str_msg) |
| char debug[] = "debug statements" |
Definition at line 17 of file Logging.cpp.
| char errors[] = "errors" |
Definition at line 20 of file Logging.cpp.
| char fatal[] = "fatalities" |
Definition at line 21 of file Logging.cpp.
| char hello[13] = "hello world!" |
Definition at line 15 of file Logging.cpp.
| char info[] = "infos" |
Definition at line 18 of file Logging.cpp.
Definition at line 10 of file Logging.cpp.
| std_msgs::String str_msg |
Definition at line 12 of file Logging.cpp.
| char warn[] = "warnings" |
Definition at line 19 of file Logging.cpp.