, including all inherited members.
addNewPlanningRequest(const moveit_msgs::MotionPlanRequest &planning_query, const std::string &scene_name, const std::string &query_name) | moveit_warehouse::PlanningSceneStorage | [private] |
addPlanningQuery(const moveit_msgs::MotionPlanRequest &planning_query, const std::string &scene_name, const std::string &query_name="") | moveit_warehouse::PlanningSceneStorage | |
addPlanningResult(const moveit_msgs::MotionPlanRequest &planning_query, const moveit_msgs::RobotTrajectory &result, const std::string &scene_name) | moveit_warehouse::PlanningSceneStorage | |
addPlanningScene(const moveit_msgs::PlanningScene &scene) | moveit_warehouse::PlanningSceneStorage | |
createCollections() | moveit_warehouse::PlanningSceneStorage | [private] |
DATABASE_NAME | moveit_warehouse::PlanningSceneStorage | [static] |
db_host_ | moveit_warehouse::MoveItMessageStorage | [protected] |
db_port_ | moveit_warehouse::MoveItMessageStorage | [protected] |
drop(const std::string &db) | moveit_warehouse::MoveItMessageStorage | [protected] |
filterNames(const std::string ®ex, std::vector< std::string > &names) const | moveit_warehouse::MoveItMessageStorage | [protected] |
getDatabaseHost() const | moveit_warehouse::MoveItMessageStorage | [inline] |
getDatabasePort() const | moveit_warehouse::MoveItMessageStorage | [inline] |
getMotionPlanRequestName(const moveit_msgs::MotionPlanRequest &planning_query, const std::string &scene_name) const | moveit_warehouse::PlanningSceneStorage | [private] |
getPlanningQueries(std::vector< MotionPlanRequestWithMetadata > &planning_queries, const std::string &scene_name) const | moveit_warehouse::PlanningSceneStorage | |
getPlanningQueries(std::vector< MotionPlanRequestWithMetadata > &planning_queries, std::vector< std::string > &query_names, const std::string &scene_name) const | moveit_warehouse::PlanningSceneStorage | |
getPlanningQueriesNames(std::vector< std::string > &query_names, const std::string &scene_name) const | moveit_warehouse::PlanningSceneStorage | |
getPlanningQueriesNames(const std::string ®ex, std::vector< std::string > &query_names, const std::string &scene_name) const | moveit_warehouse::PlanningSceneStorage | |
getPlanningQuery(MotionPlanRequestWithMetadata &query_m, const std::string &scene_name, const std::string &query_name) | moveit_warehouse::PlanningSceneStorage | |
getPlanningResults(std::vector< RobotTrajectoryWithMetadata > &planning_results, const std::string &scene_name, const moveit_msgs::MotionPlanRequest &planning_query) const | moveit_warehouse::PlanningSceneStorage | |
getPlanningResults(std::vector< RobotTrajectoryWithMetadata > &planning_results, const std::string &scene_name, const std::string &query_name) const | moveit_warehouse::PlanningSceneStorage | |
getPlanningScene(PlanningSceneWithMetadata &scene_m, const std::string &scene_name) const | moveit_warehouse::PlanningSceneStorage | |
getPlanningSceneNames(std::vector< std::string > &names) const | moveit_warehouse::PlanningSceneStorage | |
getPlanningSceneNames(const std::string ®ex, std::vector< std::string > &names) const | moveit_warehouse::PlanningSceneStorage | |
getPlanningSceneWorld(moveit_msgs::PlanningSceneWorld &world, const std::string &scene_name) const | moveit_warehouse::PlanningSceneStorage | |
hasPlanningQuery(const std::string &scene_name, const std::string &query_name) const | moveit_warehouse::PlanningSceneStorage | |
hasPlanningScene(const std::string &name) const | moveit_warehouse::PlanningSceneStorage | |
motion_plan_request_collection_ | moveit_warehouse::PlanningSceneStorage | [private] |
MOTION_PLAN_REQUEST_ID_NAME | moveit_warehouse::PlanningSceneStorage | [static] |
MoveItMessageStorage(const std::string &host="", const unsigned int port=0, double wait_seconds=5.0) | moveit_warehouse::MoveItMessageStorage | |
planning_scene_collection_ | moveit_warehouse::PlanningSceneStorage | [private] |
PLANNING_SCENE_ID_NAME | moveit_warehouse::PlanningSceneStorage | [static] |
PlanningSceneStorage(const std::string &host="", const unsigned int port=0, double wait_seconds=5.0) | moveit_warehouse::PlanningSceneStorage | |
removePlanningQueries(const std::string &scene_name) | moveit_warehouse::PlanningSceneStorage | |
removePlanningQuery(const std::string &scene_name, const std::string &query_name) | moveit_warehouse::PlanningSceneStorage | |
removePlanningResults(const std::string &scene_name) | moveit_warehouse::PlanningSceneStorage | |
removePlanningResults(const std::string &scene_name, const std::string &query_name) | moveit_warehouse::PlanningSceneStorage | |
removePlanningScene(const std::string &scene_name) | moveit_warehouse::PlanningSceneStorage | |
renamePlanningQuery(const std::string &scene_name, const std::string &old_query_name, const std::string &new_query_name) | moveit_warehouse::PlanningSceneStorage | |
renamePlanningScene(const std::string &old_scene_name, const std::string &new_scene_name) | moveit_warehouse::PlanningSceneStorage | |
reset() | moveit_warehouse::PlanningSceneStorage | |
robot_trajectory_collection_ | moveit_warehouse::PlanningSceneStorage | [private] |
timeout_ | moveit_warehouse::MoveItMessageStorage | [protected] |
~MoveItMessageStorage() | moveit_warehouse::MoveItMessageStorage | [virtual] |