#include <descend_retreat_place.h>
Protected Member Functions | |
virtual void | testPlace (const object_manipulation_msgs::PlaceGoal &place_goal, const geometry_msgs::PoseStamped &place_location, PlaceExecutionInfo &execution_info) |
Tests both descent and retreat using interpolated IK. | |
Static Protected Attributes | |
static float | EPS = 1.0e-6 |
Numerical error margin when checking if trajectories are long enough. |
Definition at line 160 of file descend_retreat_place.h.
void object_manipulator::StandardPlaceTester::testPlace | ( | const object_manipulation_msgs::PlaceGoal & | place_goal, |
const geometry_msgs::PoseStamped & | place_location, | ||
PlaceExecutionInfo & | execution_info | ||
) | [protected, virtual] |
Tests both descent and retreat using interpolated IK.
Implements object_manipulator::PlaceTester.
Definition at line 94 of file descend_retreat_place.cpp.
float object_manipulator::StandardPlaceTester::EPS = 1.0e-6 [static, protected] |
Numerical error margin when checking if trajectories are long enough.
One thousandth of a mm.
Definition at line 169 of file descend_retreat_place.h.