#include <ros/ros.h>#include <tf/tf.h>#include <iostream>#include <iomanip>#include <cmath>#include <vector>#include <sstream>#include <map>#include <stdexcept>#include <list>#include <boost/thread/mutex.hpp>#include "tf/transform_datatypes.h"#include "tf/exceptions.h"#include "LinearMath/btTransform.h"#include <boost/signals.hpp>#include <string>#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 "std_msgs/Header.h"#include "geometry_msgs/Vector3.h"#include <gtest/gtest.h>#include <boost/thread.hpp>#include "ros/service_traits.h"#include "motion_planning_msgs/RobotState.h"#include "geometry_msgs/PoseStamped.h"#include "motion_planning_msgs/ArmNavigationErrorCodes.h"#include "geometric_shapes_msgs/Shape.h"#include "motion_planning_msgs/Constraints.h"#include "motion_planning_msgs/AllowedContactSpecification.h"#include "motion_planning_msgs/OrderedCollisionOperations.h"#include "motion_planning_msgs/LinkPadding.h"#include "trajectory_msgs/JointTrajectory.h"#include "geometry_msgs/Pose.h"#include <planning_environment_msgs/GetRobotState.h>#include <actionlib/client/simple_action_client.h>#include "actionlib_msgs/GoalID.h"#include "motion_planning_msgs/MotionPlanRequest.h"#include "actionlib_msgs/GoalStatus.h"#include "planning_environment_msgs/ContactInformation.h"#include <collision_environment_msgs/MakeStaticCollisionMapAction.h>#include <pr2_msgs/SetPeriodicCmd.h>#include <sensor_msgs/PointCloud.h>#include <urdf/model.h>

Go to the source code of this file.
Functions | |
| int | main (int argc, char **argv) |
| void | spinThread () |
| TEST (OMPL, PathConstraintsTest) | |
| int main | ( | int | argc, | |
| char ** | argv | |||
| ) |
Definition at line 247 of file path_constraints_test.cpp.
| void spinThread | ( | ) |
Definition at line 52 of file path_constraints_test.cpp.
| TEST | ( | OMPL | , | |
| PathConstraintsTest | ||||
| ) |
Definition at line 57 of file path_constraints_test.cpp.