Class RobotStateStorage
Defined in File state_storage.h
Inheritance Relationships
Base Type
public moveit_warehouse::MoveItMessageStorage
(Class MoveItMessageStorage)
Class Documentation
-
class RobotStateStorage : public moveit_warehouse::MoveItMessageStorage
Public Functions
-
RobotStateStorage(warehouse_ros::DatabaseConnection::Ptr conn)
-
void addRobotState(const moveit_msgs::msg::RobotState &msg, const std::string &name, const std::string &robot = "")
-
bool hasRobotState(const std::string &name, const std::string &robot = "") const
-
void getKnownRobotStates(std::vector<std::string> &names, const std::string &robot = "") const
-
void getKnownRobotStates(const std::string ®ex, std::vector<std::string> &names, const std::string &robot = "") const
-
bool getRobotState(RobotStateWithMetadata &msg_m, const std::string &name, const std::string &robot = "") const
Get the constraints named name. Return false on failure.
-
void renameRobotState(const std::string &old_name, const std::string &new_name, const std::string &robot = "")
-
void removeRobotState(const std::string &name, const std::string &robot = "")
-
void reset()
-
RobotStateStorage(warehouse_ros::DatabaseConnection::Ptr conn)