moveit2
The MoveIt Motion Planning Framework for ROS 2.
Loading...
Searching...
No Matches
Functions
test_motion_plan_request_features_with_move_group.cpp File Reference
#include <memory>
#include <gtest/gtest.h>
#include <warehouse_ros/message_collection.h>
#include <moveit/move_group_interface/move_group_interface.hpp>
#include <moveit_msgs/msg/motion_plan_request.hpp>
#include <moveit/trajectory_cache/features/features_interface.hpp>
#include <moveit/trajectory_cache/features/motion_plan_request_features.hpp>
#include "../fixtures/move_group_fixture.hpp"
Include dependency graph for test_motion_plan_request_features_with_move_group.cpp:

Go to the source code of this file.

Functions

int main (int argc, char **argv)
 

Detailed Description

Author
methylDragon

Sanity tests for the moveit_msgs::msg::MotionPlanRequest feature extractors.

See also
motion_plan_request_features.hpp

WARNING: These tests currently do not cover the implementation details, they are just the first sanity check for ensuring the most basic roundtrip functionality works.

For example, some features might not have any resulting changes to the metadata or query due to the nature of what is contained in the MotionPlanRequest passed to them.

Definition in file test_motion_plan_request_features_with_move_group.cpp.

Function Documentation

◆ main()

int main ( int  argc,
char **  argv 
)