#include <ros/ros.h>
#include <gtest/gtest.h>
#include <play_motion_builder_msgs/BuildMotionAction.h>
#include <play_motion_builder_msgs/RunMotionAction.h>
#include <play_motion_builder_msgs/EditMotion.h>
#include <play_motion_builder_msgs/StoreMotion.h>
#include <play_motion_builder_msgs/ChangeJoints.h>
#include <actionlib/client/simple_action_client.h>
#include <sensor_msgs/JointState.h>
#include <unordered_map>
#include <mutex>
#include <fstream>
Go to the source code of this file.
|
bool | pal::compare_files (const std::string &filename1, const std::string &filename2) |
|
int | main (int argc, char **argv) |
|
template<typename InputIterator1 , typename InputIterator2 > |
bool | pal::range_equal (InputIterator1 first1, InputIterator1 last1, InputIterator2 first2, InputIterator2 last2) |
|
| pal::TEST (MotionBuilderTest, actionNotStartedTest) |
|
| pal::TEST (MotionBuilderTest, buildNewMotion) |
|
| pal::TEST (MotionBuilderTest, editExistingMotion) |
|
◆ main()
int main |
( |
int |
argc, |
|
|
char ** |
argv |
|
) |
| |