$search

subscription_callback_types.cpp File Reference

#include <gtest/gtest.h>
#include "ros/ros.h"
#include "std_msgs/String.h"
#include <vector>
Include dependency graph for subscription_callback_types.cpp:

Go to the source code of this file.

Classes

struct  A

Functions

void chatterCallback (const std_msgs::String::ConstPtr &msg)
void chatterCallback2 (const std_msgs::String &msg)
void chatterCallback3 (std_msgs::String::ConstPtr msg)
void chatterCallback4 (const ros::MessageEvent< std_msgs::String const > &event)
void chatterCallback5 (std_msgs::String msg)
void chatterCallback6 (const std_msgs::String::Ptr &msg)
void chatterCallback7 (std_msgs::String::Ptr msg)
void chatterCallback8 (const ros::MessageEvent< std_msgs::String > &event)
int main (int argc, char **argv)
 TEST (SubscriptionCallbackTypes, compile)

Function Documentation

void chatterCallback ( const std_msgs::String::ConstPtr &  msg  ) 

Author: Josh Faust This tutorial demonstrates simple receipt of messages over the ROS system.

Definition at line 47 of file subscription_callback_types.cpp.

void chatterCallback2 ( const std_msgs::String &  msg  ) 

Definition at line 52 of file subscription_callback_types.cpp.

void chatterCallback3 ( std_msgs::String::ConstPtr  msg  ) 

Definition at line 57 of file subscription_callback_types.cpp.

void chatterCallback4 ( const ros::MessageEvent< std_msgs::String const > &  event  ) 

Definition at line 62 of file subscription_callback_types.cpp.

void chatterCallback5 ( std_msgs::String  msg  ) 

Definition at line 67 of file subscription_callback_types.cpp.

void chatterCallback6 ( const std_msgs::String::Ptr &  msg  ) 

Definition at line 72 of file subscription_callback_types.cpp.

void chatterCallback7 ( std_msgs::String::Ptr  msg  ) 

Definition at line 77 of file subscription_callback_types.cpp.

void chatterCallback8 ( const ros::MessageEvent< std_msgs::String > &  event  ) 

Definition at line 82 of file subscription_callback_types.cpp.

int main ( int  argc,
char **  argv 
)

Definition at line 181 of file subscription_callback_types.cpp.

TEST ( SubscriptionCallbackTypes  ,
compile   
)

Definition at line 146 of file subscription_callback_types.cpp.

 All Classes Namespaces Files Functions Variables Typedefs Enumerations Friends Defines


test_roscpp
Author(s): Morgan Quigley mquigley@cs.stanford.edu, Ken Conley kwc@willowgarage.com
autogenerated on Sat Mar 2 13:24:59 2013