#include <ros/ros.h>#include <planning_environment_msgs/GetRobotState.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 "ros/service_traits.h"#include "std_msgs/Header.h"#include "geometry_msgs/Pose.h"#include "motion_planning_msgs/RobotState.h"#include "geometric_shapes_msgs/Shape.h"#include "geometry_msgs/PoseStamped.h"#include "geometry_msgs/Point.h"#include "geometry_msgs/Quaternion.h"#include "geometry_msgs/PointStamped.h"#include "motion_planning_msgs/Constraints.h"#include "motion_planning_msgs/ArmNavigationErrorCodes.h"#include "geometry_msgs/Vector3.h"#include <gtest/gtest.h>

Go to the source code of this file.
Functions | |
| int | main (int argc, char **argv) |
| TEST (EnvironmentServer, AllowableContactsTest) | |
| int main | ( | int | argc, | |
| char ** | argv | |||
| ) |
Definition at line 120 of file allowable_contacts_test.cpp.
| TEST | ( | EnvironmentServer | , | |
| AllowableContactsTest | ||||
| ) |
Definition at line 44 of file allowable_contacts_test.cpp.