generated_messages.cpp File Reference

#include <gtest/gtest.h>
#include "test_roscpp_serialization/helpers.h"
#include "test_roscpp_serialization/ArrayOfFixedLength.h"
#include <string>
#include <vector>
#include <ostream>
#include "ros/serialization.h"
#include "ros/builtin_message_traits.h"
#include "ros/message_operations.h"
#include "ros/message.h"
#include "ros/time.h"
#include "test_roscpp_serialization/FixedLength.h"
#include "test_roscpp_serialization/VariableLength.h"
#include "std_msgs/Header.h"
#include "std_msgs/UInt8.h"
#include "test_roscpp_serialization/CustomHeader.h"
#include "rosgraph_msgs/Log.h"
Include dependency graph for generated_messages.cpp:
This graph shows which files directly or indirectly include this file:

Go to the source code of this file.

Namespaces

namespace  test_roscpp_serialization

Defines

#define ALLOCATOR_CONSTRUCTOR_COMPILATION_TEST(Type, Allocator)
#define SERIALIZATION_COMPILATION_TEST(Type)

Functions

 ALLOCATOR_CONSTRUCTOR_COMPILATION_TEST (MyVariableLengthStringArray, Allocator< void >)
 ALLOCATOR_CONSTRUCTOR_COMPILATION_TEST (MyFixedLengthStringArray, Allocator< void >)
 ALLOCATOR_CONSTRUCTOR_COMPILATION_TEST (MyVariableLengthArrayOfExternal, Allocator< void >)
 ALLOCATOR_CONSTRUCTOR_COMPILATION_TEST (MyFixedLengthArrayOfExternal, Allocator< void >)
 ALLOCATOR_CONSTRUCTOR_COMPILATION_TEST (MyWithMemberNamedHeaderThatIsNotAHeader, Allocator< void >)
 ALLOCATOR_CONSTRUCTOR_COMPILATION_TEST (MyWithDuration, Allocator< void >)
 ALLOCATOR_CONSTRUCTOR_COMPILATION_TEST (MyWithTime, Allocator< void >)
 ALLOCATOR_CONSTRUCTOR_COMPILATION_TEST (MyEmbeddedExternal, Allocator< void >)
 ALLOCATOR_CONSTRUCTOR_COMPILATION_TEST (MyWithHeader, Allocator< void >)
 ALLOCATOR_CONSTRUCTOR_COMPILATION_TEST (MyVariableLength, Allocator< void >)
 ALLOCATOR_CONSTRUCTOR_COMPILATION_TEST (MyFixedLength, Allocator< void >)
 ALLOCATOR_CONSTRUCTOR_COMPILATION_TEST (MyEmbeddedVariableLength, Allocator< void >)
 ALLOCATOR_CONSTRUCTOR_COMPILATION_TEST (MyEmbeddedFixedLength, Allocator< void >)
 ALLOCATOR_CONSTRUCTOR_COMPILATION_TEST (MyArrayOfVariableLength, Allocator< void >)
 ALLOCATOR_CONSTRUCTOR_COMPILATION_TEST (MyArrayOfFixedLength, Allocator< void >)
 ALLOCATOR_CONSTRUCTOR_COMPILATION_TEST (VariableLengthStringArray, std::allocator< void >)
 ALLOCATOR_CONSTRUCTOR_COMPILATION_TEST (FixedLengthStringArray, std::allocator< void >)
 ALLOCATOR_CONSTRUCTOR_COMPILATION_TEST (VariableLengthArrayOfExternal, std::allocator< void >)
 ALLOCATOR_CONSTRUCTOR_COMPILATION_TEST (FixedLengthArrayOfExternal, std::allocator< void >)
 ALLOCATOR_CONSTRUCTOR_COMPILATION_TEST (WithMemberNamedHeaderThatIsNotAHeader, std::allocator< void >)
 ALLOCATOR_CONSTRUCTOR_COMPILATION_TEST (WithDuration, std::allocator< void >)
 ALLOCATOR_CONSTRUCTOR_COMPILATION_TEST (WithTime, std::allocator< void >)
 ALLOCATOR_CONSTRUCTOR_COMPILATION_TEST (EmbeddedExternal, std::allocator< void >)
 ALLOCATOR_CONSTRUCTOR_COMPILATION_TEST (WithHeader, std::allocator< void >)
 ALLOCATOR_CONSTRUCTOR_COMPILATION_TEST (VariableLength, std::allocator< void >)
 ALLOCATOR_CONSTRUCTOR_COMPILATION_TEST (FixedLength, std::allocator< void >)
 ALLOCATOR_CONSTRUCTOR_COMPILATION_TEST (EmbeddedVariableLength, std::allocator< void >)
 ALLOCATOR_CONSTRUCTOR_COMPILATION_TEST (EmbeddedFixedLength, std::allocator< void >)
 ALLOCATOR_CONSTRUCTOR_COMPILATION_TEST (ArrayOfVariableLength, std::allocator< void >)
 ALLOCATOR_CONSTRUCTOR_COMPILATION_TEST (ArrayOfFixedLength, std::allocator< void >)
int main (int argc, char **argv)
 test_roscpp_serialization::ROS_DECLARE_MESSAGE_WITH_ALLOCATOR (VariableLengthStringArray, MyVariableLengthStringArray, Allocator)
 test_roscpp_serialization::ROS_DECLARE_MESSAGE_WITH_ALLOCATOR (FixedLengthStringArray, MyFixedLengthStringArray, Allocator)
 test_roscpp_serialization::ROS_DECLARE_MESSAGE_WITH_ALLOCATOR (VariableLengthArrayOfExternal, MyVariableLengthArrayOfExternal, Allocator)
 test_roscpp_serialization::ROS_DECLARE_MESSAGE_WITH_ALLOCATOR (FixedLengthArrayOfExternal, MyFixedLengthArrayOfExternal, Allocator)
 test_roscpp_serialization::ROS_DECLARE_MESSAGE_WITH_ALLOCATOR (WithMemberNamedHeaderThatIsNotAHeader, MyWithMemberNamedHeaderThatIsNotAHeader, Allocator)
 test_roscpp_serialization::ROS_DECLARE_MESSAGE_WITH_ALLOCATOR (WithDuration, MyWithDuration, Allocator)
 test_roscpp_serialization::ROS_DECLARE_MESSAGE_WITH_ALLOCATOR (WithTime, MyWithTime, Allocator)
 test_roscpp_serialization::ROS_DECLARE_MESSAGE_WITH_ALLOCATOR (EmbeddedExternal, MyEmbeddedExternal, Allocator)
 test_roscpp_serialization::ROS_DECLARE_MESSAGE_WITH_ALLOCATOR (WithHeader, MyWithHeader, Allocator)
 test_roscpp_serialization::ROS_DECLARE_MESSAGE_WITH_ALLOCATOR (VariableLength, MyVariableLength, Allocator)
 test_roscpp_serialization::ROS_DECLARE_MESSAGE_WITH_ALLOCATOR (FixedLength, MyFixedLength, Allocator)
 test_roscpp_serialization::ROS_DECLARE_MESSAGE_WITH_ALLOCATOR (EmbeddedVariableLength, MyEmbeddedVariableLength, Allocator)
 test_roscpp_serialization::ROS_DECLARE_MESSAGE_WITH_ALLOCATOR (EmbeddedFixedLength, MyEmbeddedFixedLength, Allocator)
 test_roscpp_serialization::ROS_DECLARE_MESSAGE_WITH_ALLOCATOR (ArrayOfVariableLength, MyArrayOfVariableLength, Allocator)
 test_roscpp_serialization::ROS_DECLARE_MESSAGE_WITH_ALLOCATOR (ArrayOfFixedLength, MyArrayOfFixedLength, Allocator)
 SERIALIZATION_COMPILATION_TEST (MyVariableLengthStringArray)
 SERIALIZATION_COMPILATION_TEST (MyFixedLengthStringArray)
 SERIALIZATION_COMPILATION_TEST (MyVariableLengthArrayOfExternal)
 SERIALIZATION_COMPILATION_TEST (MyFixedLengthArrayOfExternal)
 SERIALIZATION_COMPILATION_TEST (MyWithMemberNamedHeaderThatIsNotAHeader)
 SERIALIZATION_COMPILATION_TEST (MyWithDuration)
 SERIALIZATION_COMPILATION_TEST (MyWithTime)
 SERIALIZATION_COMPILATION_TEST (MyEmbeddedExternal)
 SERIALIZATION_COMPILATION_TEST (MyWithHeader)
 SERIALIZATION_COMPILATION_TEST (MyVariableLength)
 SERIALIZATION_COMPILATION_TEST (MyFixedLength)
 SERIALIZATION_COMPILATION_TEST (MyEmbeddedVariableLength)
 SERIALIZATION_COMPILATION_TEST (MyEmbeddedFixedLength)
 SERIALIZATION_COMPILATION_TEST (MyArrayOfVariableLength)
 SERIALIZATION_COMPILATION_TEST (MyArrayOfFixedLength)
 SERIALIZATION_COMPILATION_TEST (VariableLengthStringArray)
 SERIALIZATION_COMPILATION_TEST (FixedLengthStringArray)
 SERIALIZATION_COMPILATION_TEST (VariableLengthArrayOfExternal)
 SERIALIZATION_COMPILATION_TEST (FixedLengthArrayOfExternal)
 SERIALIZATION_COMPILATION_TEST (WithMemberNamedHeaderThatIsNotAHeader)
 SERIALIZATION_COMPILATION_TEST (WithDuration)
 SERIALIZATION_COMPILATION_TEST (WithTime)
 SERIALIZATION_COMPILATION_TEST (EmbeddedExternal)
 SERIALIZATION_COMPILATION_TEST (WithHeader)
 SERIALIZATION_COMPILATION_TEST (VariableLength)
 SERIALIZATION_COMPILATION_TEST (FixedLength)
 SERIALIZATION_COMPILATION_TEST (EmbeddedVariableLength)
 SERIALIZATION_COMPILATION_TEST (EmbeddedFixedLength)
 SERIALIZATION_COMPILATION_TEST (ArrayOfVariableLength)
 SERIALIZATION_COMPILATION_TEST (ArrayOfFixedLength)
 TEST (Generated, constants)
 TEST (Generated, serializationOStreamOperator)
 TEST (GeneratedMessages, traitsWithCustomAllocator)
 TEST (GeneratedMessages, traitsWithStandardMessages)

Define Documentation

#define ALLOCATOR_CONSTRUCTOR_COMPILATION_TEST ( Type,
Allocator   ) 
Value:
TEST(GeneratedMessages, allocationConstructor_##Type) \
  { \
    Allocator a; \
    Type val(a); \
  }

Definition at line 219 of file generated_messages.cpp.

#define SERIALIZATION_COMPILATION_TEST ( Type   ) 
Value:
TEST(GeneratedMessages, serialization_##Type) \
  { \
    Type ser_val, deser_val; \
    serializeAndDeserialize(ser_val, deser_val); \
  }

Definition at line 180 of file generated_messages.cpp.


Function Documentation

ALLOCATOR_CONSTRUCTOR_COMPILATION_TEST ( MyVariableLengthStringArray  ,
Allocator< void >   
)
ALLOCATOR_CONSTRUCTOR_COMPILATION_TEST ( MyFixedLengthStringArray  ,
Allocator< void >   
)
ALLOCATOR_CONSTRUCTOR_COMPILATION_TEST ( MyVariableLengthArrayOfExternal  ,
Allocator< void >   
)
ALLOCATOR_CONSTRUCTOR_COMPILATION_TEST ( MyFixedLengthArrayOfExternal  ,
Allocator< void >   
)
ALLOCATOR_CONSTRUCTOR_COMPILATION_TEST ( MyWithMemberNamedHeaderThatIsNotAHeader  ,
Allocator< void >   
)
ALLOCATOR_CONSTRUCTOR_COMPILATION_TEST ( MyWithDuration  ,
Allocator< void >   
)
ALLOCATOR_CONSTRUCTOR_COMPILATION_TEST ( MyWithTime  ,
Allocator< void >   
)
ALLOCATOR_CONSTRUCTOR_COMPILATION_TEST ( MyEmbeddedExternal  ,
Allocator< void >   
)
ALLOCATOR_CONSTRUCTOR_COMPILATION_TEST ( MyWithHeader  ,
Allocator< void >   
)
ALLOCATOR_CONSTRUCTOR_COMPILATION_TEST ( MyVariableLength  ,
Allocator< void >   
)
ALLOCATOR_CONSTRUCTOR_COMPILATION_TEST ( MyFixedLength  ,
Allocator< void >   
)
ALLOCATOR_CONSTRUCTOR_COMPILATION_TEST ( MyEmbeddedVariableLength  ,
Allocator< void >   
)
ALLOCATOR_CONSTRUCTOR_COMPILATION_TEST ( MyEmbeddedFixedLength  ,
Allocator< void >   
)
ALLOCATOR_CONSTRUCTOR_COMPILATION_TEST ( MyArrayOfVariableLength  ,
Allocator< void >   
)
ALLOCATOR_CONSTRUCTOR_COMPILATION_TEST ( MyArrayOfFixedLength  ,
Allocator< void >   
)
ALLOCATOR_CONSTRUCTOR_COMPILATION_TEST ( VariableLengthStringArray  ,
std::allocator< void >   
)
ALLOCATOR_CONSTRUCTOR_COMPILATION_TEST ( FixedLengthStringArray  ,
std::allocator< void >   
)
ALLOCATOR_CONSTRUCTOR_COMPILATION_TEST ( VariableLengthArrayOfExternal  ,
std::allocator< void >   
)
ALLOCATOR_CONSTRUCTOR_COMPILATION_TEST ( FixedLengthArrayOfExternal  ,
std::allocator< void >   
)
ALLOCATOR_CONSTRUCTOR_COMPILATION_TEST ( WithMemberNamedHeaderThatIsNotAHeader  ,
std::allocator< void >   
)
ALLOCATOR_CONSTRUCTOR_COMPILATION_TEST ( WithDuration  ,
std::allocator< void >   
)
ALLOCATOR_CONSTRUCTOR_COMPILATION_TEST ( WithTime  ,
std::allocator< void >   
)
ALLOCATOR_CONSTRUCTOR_COMPILATION_TEST ( EmbeddedExternal  ,
std::allocator< void >   
)
ALLOCATOR_CONSTRUCTOR_COMPILATION_TEST ( WithHeader  ,
std::allocator< void >   
)
ALLOCATOR_CONSTRUCTOR_COMPILATION_TEST ( VariableLength  ,
std::allocator< void >   
)
ALLOCATOR_CONSTRUCTOR_COMPILATION_TEST ( FixedLength  ,
std::allocator< void >   
)
ALLOCATOR_CONSTRUCTOR_COMPILATION_TEST ( EmbeddedVariableLength  ,
std::allocator< void >   
)
ALLOCATOR_CONSTRUCTOR_COMPILATION_TEST ( EmbeddedFixedLength  ,
std::allocator< void >   
)
ALLOCATOR_CONSTRUCTOR_COMPILATION_TEST ( ArrayOfVariableLength  ,
std::allocator< void >   
)
ALLOCATOR_CONSTRUCTOR_COMPILATION_TEST ( ArrayOfFixedLength  ,
std::allocator< void >   
)
int main ( int  argc,
char **  argv 
)

Definition at line 284 of file generated_messages.cpp.

SERIALIZATION_COMPILATION_TEST ( MyVariableLengthStringArray   ) 
SERIALIZATION_COMPILATION_TEST ( MyFixedLengthStringArray   ) 
SERIALIZATION_COMPILATION_TEST ( MyVariableLengthArrayOfExternal   ) 
SERIALIZATION_COMPILATION_TEST ( MyFixedLengthArrayOfExternal   ) 
SERIALIZATION_COMPILATION_TEST ( MyWithMemberNamedHeaderThatIsNotAHeader   ) 
SERIALIZATION_COMPILATION_TEST ( MyWithDuration   ) 
SERIALIZATION_COMPILATION_TEST ( MyWithTime   ) 
SERIALIZATION_COMPILATION_TEST ( MyEmbeddedExternal   ) 
SERIALIZATION_COMPILATION_TEST ( MyWithHeader   ) 
SERIALIZATION_COMPILATION_TEST ( MyVariableLength   ) 
SERIALIZATION_COMPILATION_TEST ( MyFixedLength   ) 
SERIALIZATION_COMPILATION_TEST ( MyEmbeddedVariableLength   ) 
SERIALIZATION_COMPILATION_TEST ( MyEmbeddedFixedLength   ) 
SERIALIZATION_COMPILATION_TEST ( MyArrayOfVariableLength   ) 
SERIALIZATION_COMPILATION_TEST ( MyArrayOfFixedLength   ) 
SERIALIZATION_COMPILATION_TEST ( VariableLengthStringArray   ) 
SERIALIZATION_COMPILATION_TEST ( FixedLengthStringArray   ) 
SERIALIZATION_COMPILATION_TEST ( VariableLengthArrayOfExternal   ) 
SERIALIZATION_COMPILATION_TEST ( FixedLengthArrayOfExternal   ) 
SERIALIZATION_COMPILATION_TEST ( WithMemberNamedHeaderThatIsNotAHeader   ) 
SERIALIZATION_COMPILATION_TEST ( WithDuration   ) 
SERIALIZATION_COMPILATION_TEST ( WithTime   ) 
SERIALIZATION_COMPILATION_TEST ( EmbeddedExternal   ) 
SERIALIZATION_COMPILATION_TEST ( WithHeader   ) 
SERIALIZATION_COMPILATION_TEST ( VariableLength   ) 
SERIALIZATION_COMPILATION_TEST ( FixedLength   ) 
SERIALIZATION_COMPILATION_TEST ( EmbeddedVariableLength   ) 
SERIALIZATION_COMPILATION_TEST ( EmbeddedFixedLength   ) 
SERIALIZATION_COMPILATION_TEST ( ArrayOfVariableLength   ) 
SERIALIZATION_COMPILATION_TEST ( ArrayOfFixedLength   ) 
TEST ( Generated  ,
constants   
)

Definition at line 268 of file generated_messages.cpp.

TEST ( Generated  ,
serializationOStreamOperator   
)

Definition at line 258 of file generated_messages.cpp.

TEST ( GeneratedMessages  ,
traitsWithCustomAllocator   
)

Definition at line 129 of file generated_messages.cpp.

TEST ( GeneratedMessages  ,
traitsWithStandardMessages   
)

Definition at line 77 of file generated_messages.cpp.

 All Classes Namespaces Files Functions Variables Typedefs Enumerator Defines


test_roscpp_serialization
Author(s): Josh Faust
autogenerated on Fri Jan 11 09:10:52 2013