#include <ros/ros.h>
#include <warehouse_ros/database_loader.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.
|
template<typename S , typename Fn > |
ros::ServiceServer | createServiceServer (moveit_warehouse::RobotStateStorage &rs, ros::NodeHandle &node, const std::string &name, const Fn &fn) |
|
bool | deleteState (moveit_msgs::DeleteRobotStateFromWarehouse::Request &request, moveit_msgs::DeleteRobotStateFromWarehouse::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 &, moveit_warehouse::RobotStateStorage &rs) |
|
bool | storeState (moveit_msgs::SaveRobotStateToWarehouse::Request &request, moveit_msgs::SaveRobotStateToWarehouse::Response &response, moveit_warehouse::RobotStateStorage &rs) |
|
◆ createServiceServer()
template<typename S , typename Fn >
◆ deleteState()
bool deleteState |
( |
moveit_msgs::DeleteRobotStateFromWarehouse::Request & |
request, |
|
|
moveit_msgs::DeleteRobotStateFromWarehouse::Response & |
, |
|
|
moveit_warehouse::RobotStateStorage & |
rs |
|
) |
| |
◆ getState()
bool getState |
( |
moveit_msgs::GetRobotStateFromWarehouse::Request & |
request, |
|
|
moveit_msgs::GetRobotStateFromWarehouse::Response & |
response, |
|
|
moveit_warehouse::RobotStateStorage & |
rs |
|
) |
| |
◆ hasState()
bool hasState |
( |
moveit_msgs::CheckIfRobotStateExistsInWarehouse::Request & |
request, |
|
|
moveit_msgs::CheckIfRobotStateExistsInWarehouse::Response & |
response, |
|
|
moveit_warehouse::RobotStateStorage & |
rs |
|
) |
| |
◆ listStates()
bool listStates |
( |
moveit_msgs::ListRobotStatesInWarehouse::Request & |
request, |
|
|
moveit_msgs::ListRobotStatesInWarehouse::Response & |
response, |
|
|
moveit_warehouse::RobotStateStorage & |
rs |
|
) |
| |
◆ main()
int main |
( |
int |
argc, |
|
|
char ** |
argv |
|
) |
| |
◆ renameState()
bool renameState |
( |
moveit_msgs::RenameRobotStateInWarehouse::Request & |
request, |
|
|
moveit_msgs::RenameRobotStateInWarehouse::Response & |
, |
|
|
moveit_warehouse::RobotStateStorage & |
rs |
|
) |
| |
◆ storeState()
bool storeState |
( |
moveit_msgs::SaveRobotStateToWarehouse::Request & |
request, |
|
|
moveit_msgs::SaveRobotStateToWarehouse::Response & |
response, |
|
|
moveit_warehouse::RobotStateStorage & |
rs |
|
) |
| |
◆ ROBOT_DESCRIPTION
const std::string ROBOT_DESCRIPTION = "robot_description" |
|
static |