#include <ros/ros.h>
#include <moveit/warehouse/state_storage.h>
#include <moveit_msgs/SaveRobotStateToWarehouse.h>
#include <moveit_msgs/ListRobotStatesInWarehouse.h>
#include <moveit_msgs/GetRobotStateFromWarehouse.h>
#include <moveit_msgs/CheckIfRobotStateExistsInWarehouse.h>
#include <moveit_msgs/DeleteRobotStateFromWarehouse.h>
#include <moveit_msgs/RenameRobotStateInWarehouse.h>
Go to the source code of this file.
|
bool | deleteState (moveit_msgs::DeleteRobotStateFromWarehouse::Request &request, moveit_msgs::DeleteRobotStateFromWarehouse::Response &response, moveit_warehouse::RobotStateStorage *rs) |
|
bool | getState (moveit_msgs::GetRobotStateFromWarehouse::Request &request, moveit_msgs::GetRobotStateFromWarehouse::Response &response, moveit_warehouse::RobotStateStorage *rs) |
|
bool | hasState (moveit_msgs::CheckIfRobotStateExistsInWarehouse::Request &request, moveit_msgs::CheckIfRobotStateExistsInWarehouse::Response &response, moveit_warehouse::RobotStateStorage *rs) |
|
bool | listStates (moveit_msgs::ListRobotStatesInWarehouse::Request &request, moveit_msgs::ListRobotStatesInWarehouse::Response &response, moveit_warehouse::RobotStateStorage *rs) |
|
int | main (int argc, char **argv) |
|
bool | renameState (moveit_msgs::RenameRobotStateInWarehouse::Request &request, moveit_msgs::RenameRobotStateInWarehouse::Response &response, moveit_warehouse::RobotStateStorage *rs) |
|
bool | storeState (moveit_msgs::SaveRobotStateToWarehouse::Request &request, moveit_msgs::SaveRobotStateToWarehouse::Response &response, moveit_warehouse::RobotStateStorage *rs) |
|
bool deleteState |
( |
moveit_msgs::DeleteRobotStateFromWarehouse::Request & |
request, |
|
|
moveit_msgs::DeleteRobotStateFromWarehouse::Response & |
response, |
|
|
moveit_warehouse::RobotStateStorage * |
rs |
|
) |
| |
bool getState |
( |
moveit_msgs::GetRobotStateFromWarehouse::Request & |
request, |
|
|
moveit_msgs::GetRobotStateFromWarehouse::Response & |
response, |
|
|
moveit_warehouse::RobotStateStorage * |
rs |
|
) |
| |
bool hasState |
( |
moveit_msgs::CheckIfRobotStateExistsInWarehouse::Request & |
request, |
|
|
moveit_msgs::CheckIfRobotStateExistsInWarehouse::Response & |
response, |
|
|
moveit_warehouse::RobotStateStorage * |
rs |
|
) |
| |
bool listStates |
( |
moveit_msgs::ListRobotStatesInWarehouse::Request & |
request, |
|
|
moveit_msgs::ListRobotStatesInWarehouse::Response & |
response, |
|
|
moveit_warehouse::RobotStateStorage * |
rs |
|
) |
| |
int main |
( |
int |
argc, |
|
|
char ** |
argv |
|
) |
| |
bool renameState |
( |
moveit_msgs::RenameRobotStateInWarehouse::Request & |
request, |
|
|
moveit_msgs::RenameRobotStateInWarehouse::Response & |
response, |
|
|
moveit_warehouse::RobotStateStorage * |
rs |
|
) |
| |
bool storeState |
( |
moveit_msgs::SaveRobotStateToWarehouse::Request & |
request, |
|
|
moveit_msgs::SaveRobotStateToWarehouse::Response & |
response, |
|
|
moveit_warehouse::RobotStateStorage * |
rs |
|
) |
| |
const std::string ROBOT_DESCRIPTION = "robot_description" |
|
static |