#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_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>
Go to the source code of this file.
Classes | |
| class | ParamTest |
| struct | ParamTest::Values |
Namespaces | |
| RTT | |
Functions | |
| int | main (int argc, char **argv) |
| bool | RTT::operator== (const PropertyBag &a, const PropertyBag &b) |
| 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, GetValueFromParameterServer) | |
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 619 of file param_tests.cpp.
| TEST_F | ( | ParamTest | , |
| Constants | |||
| ) |
Definition at line 359 of file param_tests.cpp.
| TEST_F | ( | ParamTest | , |
| SetAllPropertiesOnParameterServer | |||
| ) |
Definition at line 370 of file param_tests.cpp.
| TEST_F | ( | ParamTest | , |
| GetAllPropertiesFromParameterServer | |||
| ) |
Definition at line 412 of file param_tests.cpp.
| TEST_F | ( | ParamTest | , |
| SetSinglePropertyOnParameterServer | |||
| ) |
Definition at line 454 of file param_tests.cpp.
| TEST_F | ( | ParamTest | , |
| GetSinglePropertyFromParameterServer | |||
| ) |
Definition at line 514 of file param_tests.cpp.
| TEST_F | ( | ParamTest | , |
| SetValueOnParameterServer | |||
| ) |
Definition at line 574 of file param_tests.cpp.
| TEST_F | ( | ParamTest | , |
| GetValueFromParameterServer | |||
| ) |
Definition at line 596 of file param_tests.cpp.