#include <moveit_bridge.h>
Public Member Functions | |
bool | calcPlannedPath (const std::string planning_group, open_manipulator_msgs::JointPosition msg) |
bool | calcPlannedPath (const std::string planning_group, open_manipulator_msgs::KinematicsPose msg) |
void | controlCallback (const ros::TimerEvent &) |
void | displayPlannedPathMsgCallback (const moveit_msgs::DisplayTrajectory::ConstPtr &msg) |
bool | getJointPositionMsgCallback (open_manipulator_msgs::GetJointPosition::Request &req, open_manipulator_msgs::GetJointPosition::Response &res) |
bool | getKinematicsPoseMsgCallback (open_manipulator_msgs::GetKinematicsPose::Request &req, open_manipulator_msgs::GetKinematicsPose::Response &res) |
void | initPublisher () |
void | initServer () |
void | initSubscriber () |
MoveItBridge () | |
bool | setJointPositionMsgCallback (open_manipulator_msgs::SetJointPosition::Request &req, open_manipulator_msgs::SetJointPosition::Response &res) |
bool | setKinematicsPoseMsgCallback (open_manipulator_msgs::SetKinematicsPose::Request &req, open_manipulator_msgs::SetKinematicsPose::Response &res) |
virtual | ~MoveItBridge () |
Definition at line 52 of file moveit_bridge.h.
MoveItBridge::MoveItBridge | ( | ) |
Definition at line 21 of file moveit_bridge.cpp.
|
virtual |
Definition at line 32 of file moveit_bridge.cpp.
bool MoveItBridge::calcPlannedPath | ( | const std::string | planning_group, |
open_manipulator_msgs::JointPosition | msg | ||
) |
Definition at line 143 of file moveit_bridge.cpp.
bool MoveItBridge::calcPlannedPath | ( | const std::string | planning_group, |
open_manipulator_msgs::KinematicsPose | msg | ||
) |
Definition at line 109 of file moveit_bridge.cpp.
void MoveItBridge::controlCallback | ( | const ros::TimerEvent & | ) |
void MoveItBridge::displayPlannedPathMsgCallback | ( | const moveit_msgs::DisplayTrajectory::ConstPtr & | msg | ) |
Definition at line 187 of file moveit_bridge.cpp.
bool MoveItBridge::getJointPositionMsgCallback | ( | open_manipulator_msgs::GetJointPosition::Request & | req, |
open_manipulator_msgs::GetJointPosition::Response & | res | ||
) |
Definition at line 57 of file moveit_bridge.cpp.
bool MoveItBridge::getKinematicsPoseMsgCallback | ( | open_manipulator_msgs::GetKinematicsPose::Request & | req, |
open_manipulator_msgs::GetKinematicsPose::Response & | res | ||
) |
Definition at line 76 of file moveit_bridge.cpp.
void MoveItBridge::initPublisher | ( | ) |
Definition at line 38 of file moveit_bridge.cpp.
void MoveItBridge::initServer | ( | ) |
Definition at line 49 of file moveit_bridge.cpp.
void MoveItBridge::initSubscriber | ( | ) |
Definition at line 43 of file moveit_bridge.cpp.
bool MoveItBridge::setJointPositionMsgCallback | ( | open_manipulator_msgs::SetJointPosition::Request & | req, |
open_manipulator_msgs::SetJointPosition::Response & | res | ||
) |
Definition at line 91 of file moveit_bridge.cpp.
bool MoveItBridge::setKinematicsPoseMsgCallback | ( | open_manipulator_msgs::SetKinematicsPose::Request & | req, |
open_manipulator_msgs::SetKinematicsPose::Response & | res | ||
) |
Definition at line 100 of file moveit_bridge.cpp.
|
private |
Definition at line 67 of file moveit_bridge.h.
|
private |
Definition at line 70 of file moveit_bridge.h.
|
private |
Definition at line 71 of file moveit_bridge.h.
|
private |
Definition at line 64 of file moveit_bridge.h.
|
private |
Definition at line 78 of file moveit_bridge.h.
|
private |
Definition at line 56 of file moveit_bridge.h.
|
private |
Definition at line 60 of file moveit_bridge.h.
|
private |
Definition at line 57 of file moveit_bridge.h.
|
private |
Definition at line 72 of file moveit_bridge.h.
|
private |
Definition at line 73 of file moveit_bridge.h.
|
private |
Definition at line 61 of file moveit_bridge.h.