Public Member Functions | Static Public Attributes | Private Member Functions | Private Attributes | List of all members
moveit_warehouse::PlanningSceneWorldStorage Class Reference

#include <planning_scene_world_storage.h>

Inheritance diagram for moveit_warehouse::PlanningSceneWorldStorage:
Inheritance graph
[legend]

Public Member Functions

void addPlanningSceneWorld (const moveit_msgs::PlanningSceneWorld &msg, const std::string &name)
 
void getKnownPlanningSceneWorlds (const std::string &regex, std::vector< std::string > &names) const
 
void getKnownPlanningSceneWorlds (std::vector< std::string > &names) const
 
bool getPlanningSceneWorld (PlanningSceneWorldWithMetadata &msg_m, const std::string &name) const
 Get the constraints named name. Return false on failure. More...
 
bool hasPlanningSceneWorld (const std::string &name) const
 
 PlanningSceneWorldStorage (warehouse_ros::DatabaseConnection::Ptr conn)
 
void removePlanningSceneWorld (const std::string &name)
 
void renamePlanningSceneWorld (const std::string &old_name, const std::string &new_name)
 
void reset ()
 
- Public Member Functions inherited from moveit_warehouse::MoveItMessageStorage
 MoveItMessageStorage (warehouse_ros::DatabaseConnection::Ptr conn)
 Takes a warehouse_ros DatabaseConnection. The DatabaseConnection is expected to have already been initialized. More...
 
virtual ~MoveItMessageStorage ()
 

Static Public Attributes

static const std::string DATABASE_NAME = "moveit_planning_scene_worlds"
 
static const std::string PLANNING_SCENE_WORLD_ID_NAME = "world_id"
 

Private Member Functions

void createCollections ()
 

Private Attributes

PlanningSceneWorldCollection planning_scene_world_collection_
 

Additional Inherited Members

- Protected Member Functions inherited from moveit_warehouse::MoveItMessageStorage
void filterNames (const std::string &regex, std::vector< std::string > &names) const
 Keep only the names that match regex. More...
 
- Protected Attributes inherited from moveit_warehouse::MoveItMessageStorage
warehouse_ros::DatabaseConnection::Ptr conn_
 

Detailed Description

Definition at line 79 of file planning_scene_world_storage.h.

Constructor & Destructor Documentation

◆ PlanningSceneWorldStorage()

moveit_warehouse::PlanningSceneWorldStorage::PlanningSceneWorldStorage ( warehouse_ros::DatabaseConnection::Ptr  conn)

Definition at line 47 of file planning_scene_world_storage.cpp.

Member Function Documentation

◆ addPlanningSceneWorld()

void moveit_warehouse::PlanningSceneWorldStorage::addPlanningSceneWorld ( const moveit_msgs::PlanningSceneWorld &  msg,
const std::string &  name 
)

Definition at line 66 of file planning_scene_world_storage.cpp.

◆ createCollections()

void moveit_warehouse::PlanningSceneWorldStorage::createCollections ( )
private

Definition at line 53 of file planning_scene_world_storage.cpp.

◆ getKnownPlanningSceneWorlds() [1/2]

void moveit_warehouse::PlanningSceneWorldStorage::getKnownPlanningSceneWorlds ( const std::string &  regex,
std::vector< std::string > &  names 
) const

Definition at line 89 of file planning_scene_world_storage.cpp.

◆ getKnownPlanningSceneWorlds() [2/2]

void moveit_warehouse::PlanningSceneWorldStorage::getKnownPlanningSceneWorlds ( std::vector< std::string > &  names) const

Definition at line 96 of file planning_scene_world_storage.cpp.

◆ getPlanningSceneWorld()

bool moveit_warehouse::PlanningSceneWorldStorage::getPlanningSceneWorld ( PlanningSceneWorldWithMetadata msg_m,
const std::string &  name 
) const

Get the constraints named name. Return false on failure.

Definition at line 107 of file planning_scene_world_storage.cpp.

◆ hasPlanningSceneWorld()

bool moveit_warehouse::PlanningSceneWorldStorage::hasPlanningSceneWorld ( const std::string &  name) const

Definition at line 81 of file planning_scene_world_storage.cpp.

◆ removePlanningSceneWorld()

void moveit_warehouse::PlanningSceneWorldStorage::removePlanningSceneWorld ( const std::string &  name)

Definition at line 133 of file planning_scene_world_storage.cpp.

◆ renamePlanningSceneWorld()

void moveit_warehouse::PlanningSceneWorldStorage::renamePlanningSceneWorld ( const std::string &  old_name,
const std::string &  new_name 
)

Definition at line 122 of file planning_scene_world_storage.cpp.

◆ reset()

void moveit_warehouse::PlanningSceneWorldStorage::reset ( )

Definition at line 59 of file planning_scene_world_storage.cpp.

Member Data Documentation

◆ DATABASE_NAME

const std::string moveit_warehouse::PlanningSceneWorldStorage::DATABASE_NAME = "moveit_planning_scene_worlds"
static

Definition at line 82 of file planning_scene_world_storage.h.

◆ planning_scene_world_collection_

PlanningSceneWorldCollection moveit_warehouse::PlanningSceneWorldStorage::planning_scene_world_collection_
private

Definition at line 104 of file planning_scene_world_storage.h.

◆ PLANNING_SCENE_WORLD_ID_NAME

const std::string moveit_warehouse::PlanningSceneWorldStorage::PLANNING_SCENE_WORLD_ID_NAME = "world_id"
static

Definition at line 83 of file planning_scene_world_storage.h.


The documentation for this class was generated from the following files:


warehouse
Author(s): Ioan Sucan
autogenerated on Thu Apr 18 2024 02:25:06