#include <cartesian_path_service_capability.h>
Public Member Functions | |
virtual void | initialize () |
MoveGroupCartesianPathService () | |
Private Member Functions | |
bool | computeService (moveit_msgs::GetCartesianPath::Request &req, moveit_msgs::GetCartesianPath::Response &res) |
Private Attributes | |
ros::ServiceServer | cartesian_path_service_ |
bool | display_computed_paths_ |
ros::Publisher | display_path_ |
Definition at line 46 of file cartesian_path_service_capability.h.
Definition at line 46 of file cartesian_path_service_capability.cpp.
bool move_group::MoveGroupCartesianPathService::computeService | ( | moveit_msgs::GetCartesianPath::Request & | req, |
moveit_msgs::GetCartesianPath::Response & | res | ||
) | [private] |
Definition at line 72 of file cartesian_path_service_capability.cpp.
void move_group::MoveGroupCartesianPathService::initialize | ( | ) | [virtual] |
Implements move_group::MoveGroupCapability.
Definition at line 52 of file cartesian_path_service_capability.cpp.
Definition at line 58 of file cartesian_path_service_capability.h.
Definition at line 60 of file cartesian_path_service_capability.h.
Definition at line 59 of file cartesian_path_service_capability.h.