Classes | Namespaces | Functions
param_tests.cpp File Reference
#include <utility>
#include <vector>
#include <rtt/os/startstop.h>
#include <rtt/Logger.hpp>
#include <rtt/TaskContext.hpp>
#include <rtt/deployment/ComponentLoader.hpp>
#include <rtt/plugin/PluginLoader.hpp>
#include <rtt/types/StructTypeInfo.hpp>
#include <rtt/types/SequenceTypeInfo.hpp>
#include <boost/serialization/serialization.hpp>
#include <rtt_rosparam/rosparam.h>
#include <geometry_msgs/typekit/Vector3.h>
#include <ros/init.h>
#include <ros/names.h>
#include <ros/param.h>
#include <ros/this_node.h>
#include <gtest/gtest.h>
Include dependency graph for param_tests.cpp:

Go to the source code of this file.

Classes

class  ParamTest
 
struct  ParamTest::Values
 

Namespaces

 boost
 
 boost::serialization
 
 RTT
 

Functions

int main (int argc, char **argv)
 
bool RTT::operator== (const PropertyBag &a, const PropertyBag &b)
 
template<class Archive >
void boost::serialization::serialize (Archive &a, std::pair< std::string, int > &pair, unsigned int)
 
 TEST_F (ParamTest, Constants)
 
 TEST_F (ParamTest, SetAllPropertiesOnParameterServer)
 
 TEST_F (ParamTest, GetAllPropertiesFromParameterServer)
 
 TEST_F (ParamTest, SetSinglePropertyOnParameterServer)
 
 TEST_F (ParamTest, GetSinglePropertyFromParameterServer)
 
 TEST_F (ParamTest, SetValueOnParameterServer)
 
 TEST_F (ParamTest, AddRosParamDataSources)
 
 TEST_F (ParamTest, GetValueFromParameterServer)
 

Function Documentation

int main ( int  argc,
char **  argv 
)

Definition at line 827 of file param_tests.cpp.

TEST_F ( ParamTest  ,
Constants   
)

Definition at line 520 of file param_tests.cpp.

TEST_F ( ParamTest  ,
SetAllPropertiesOnParameterServer   
)

Definition at line 531 of file param_tests.cpp.

TEST_F ( ParamTest  ,
GetAllPropertiesFromParameterServer   
)

Definition at line 573 of file param_tests.cpp.

TEST_F ( ParamTest  ,
SetSinglePropertyOnParameterServer   
)

Definition at line 615 of file param_tests.cpp.

TEST_F ( ParamTest  ,
GetSinglePropertyFromParameterServer   
)

Definition at line 675 of file param_tests.cpp.

TEST_F ( ParamTest  ,
SetValueOnParameterServer   
)

Definition at line 735 of file param_tests.cpp.

TEST_F ( ParamTest  ,
AddRosParamDataSources   
)

Definition at line 759 of file param_tests.cpp.

TEST_F ( ParamTest  ,
GetValueFromParameterServer   
)

Definition at line 802 of file param_tests.cpp.



rtt_rosparam_tests
Author(s): Johannes Meyer
autogenerated on Mon May 10 2021 02:45:40