| AddObject(const std::string &name, const KDL::Frame &transform=KDL::Frame(), const std::string &parent="", shapes::ShapeConstPtr shape=shapes::ShapeConstPtr(nullptr), const KDL::RigidBodyInertia &inertia=KDL::RigidBodyInertia::Zero(), const Eigen::Vector4d &color=Eigen::Vector4d(0.5, 0.5, 0.5, 1.0), const bool update_collision_scene=true) | exotica::Scene | |
| AddObject(const std::string &name, const KDL::Frame &transform=KDL::Frame(), const std::string &parent="", const std::string &shape_resource_path="", const Eigen::Vector3d &scale=Eigen::Vector3d::Ones(), const KDL::RigidBodyInertia &inertia=KDL::RigidBodyInertia::Zero(), const Eigen::Vector4d &color=Eigen::Vector4d(0.5, 0.5, 0.5, 1.0), const bool update_collision_scene=true) | exotica::Scene | |
| AddObjectToEnvironment(const std::string &name, const KDL::Frame &transform=KDL::Frame(), shapes::ShapeConstPtr shape=nullptr, const Eigen::Vector4d &color=Eigen::Vector4d(0.5, 0.5, 0.5, 1.0), const bool update_collision_scene=true) | exotica::Scene | |
| AddTrajectory(const std::string &link, const std::string &traj) | exotica::Scene | |
| AddTrajectory(const std::string &link, std::shared_ptr< Trajectory > traj) | exotica::Scene | |
| AddTrajectoryFromFile(const std::string &link, const std::string &traj) | exotica::Scene | |
| AlwaysUpdatesCollisionScene() const | exotica::Scene | inline |
| attached_objects_ | exotica::Scene | private |
| AttachObject(const std::string &name, const std::string &parent) | exotica::Scene | |
| AttachObjectLocal(const std::string &name, const std::string &parent, const KDL::Frame &pose) | exotica::Scene | |
| AttachObjectLocal(const std::string &name, const std::string &parent, const Eigen::VectorXd &pose) | exotica::Scene | |
| CleanScene() | exotica::Scene | |
| collision_scene_ | exotica::Scene | private |
| controlled_joint_to_collision_link_map_ | exotica::Scene | private |
| custom_links_ | exotica::Scene | private |
| debug_ | exotica::Object | |
| DetachObject(const std::string &name) | exotica::Scene | |
| dynamics_solver_ | exotica::Scene | private |
| force_collision_ | exotica::Scene | private |
| get_has_quaternion_floating_base() const | exotica::Scene | |
| get_num_controls() const | exotica::Scene | |
| get_num_positions() const | exotica::Scene | |
| get_num_state() const | exotica::Scene | |
| get_num_state_derivative() const | exotica::Scene | |
| get_num_velocities() const | exotica::Scene | |
| get_world_links_to_exclude_from_collision_scene() const | exotica::Scene | inline |
| GetAllTemplates() const override | exotica::Instantiable< SceneInitializer > | inline |
| exotica::InstantiableBase::GetAllTemplates() const =0 | exotica::InstantiableBase | pure virtual |
| GetCollisionScene() const | exotica::Scene | |
| GetControlledJointNames() | exotica::Scene | |
| GetControlledJointToCollisionLinkMap() const | exotica::Scene | inline |
| GetControlledLinkNames() | exotica::Scene | |
| GetControlledState() | exotica::Scene | |
| GetDynamicsSolver() const | exotica::Scene | |
| GetInitializerTemplate() override | exotica::Instantiable< SceneInitializer > | inlinevirtual |
| GetKinematicTree() | exotica::Scene | |
| GetModelJointNames() | exotica::Scene | |
| GetModelLinkNames() | exotica::Scene | |
| GetModelLinkToCollisionElementMap() const | exotica::Scene | inline |
| GetModelLinkToCollisionLinkMap() const | exotica::Scene | inline |
| GetModelState() | exotica::Scene | |
| GetModelStateMap() | exotica::Scene | |
| GetName() const | exotica::Scene | |
| GetObjectName() | exotica::Object | inline |
| GetParameters() const | exotica::Instantiable< SceneInitializer > | inline |
| GetPlanningSceneMsg() | exotica::Scene | |
| GetRootFrameName() | exotica::Scene | |
| GetRootJointName() | exotica::Scene | |
| GetScene() | exotica::Scene | |
| GetTrajectory(const std::string &link) | exotica::Scene | |
| GetTreeMap() | exotica::Scene | |
| has_quaternion_floating_base_ | exotica::Scene | private |
| HasAttachedObject(const std::string &name) | exotica::Scene | |
| InstantiableBase()=default | exotica::InstantiableBase | |
| Instantiate(const SceneInitializer &init) | exotica::Scene | virtual |
| InstantiateBase(const Initializer &) | exotica::InstantiableBase | inlinevirtual |
| InstantiateInternal(const Initializer &init) override | exotica::Instantiable< SceneInitializer > | inlinevirtual |
| InstantiateObject(const Initializer &init) | exotica::Object | inline |
| kinematic_request_ | exotica::Scene | private |
| kinematic_request_callback_ | exotica::Scene | private |
| kinematic_solution_ | exotica::Scene | private |
| kinematica_ | exotica::Scene | private |
| LoadScene(const std::string &scene, const Eigen::Isometry3d &offset=Eigen::Isometry3d::Identity(), bool update_collision_scene=true) | exotica::Scene | |
| LoadScene(const std::string &scene, const KDL::Frame &offset=KDL::Frame(), bool update_collision_scene=true) | exotica::Scene | |
| LoadSceneFile(const std::string &file_name, const Eigen::Isometry3d &offset=Eigen::Isometry3d::Identity(), bool update_collision_scene=true) | exotica::Scene | |
| LoadSceneFile(const std::string &file_name, const KDL::Frame &offset=KDL::Frame(), bool update_collision_scene=true) | exotica::Scene | |
| LoadSceneFromStringStream(std::istream &in, const Eigen::Isometry3d &offset, bool update_collision_scene) | exotica::Scene | private |
| model_link_to_collision_element_map_ | exotica::Scene | private |
| model_link_to_collision_link_map_ | exotica::Scene | private |
| ns_ | exotica::Object | |
| num_controls_ | exotica::Scene | private |
| num_positions_ | exotica::Scene | private |
| num_state_ | exotica::Scene | private |
| num_state_derivative_ | exotica::Scene | private |
| num_velocities_ | exotica::Scene | private |
| Object() | exotica::Object | inline |
| object_name_ | exotica::Object | |
| operator=(const Uncopyable &) | exotica::Uncopyable | private |
| parameters_ | exotica::Instantiable< SceneInitializer > | protected |
| Print(const std::string &prepend) const | exotica::Object | inlinevirtual |
| proxy_pub_ | exotica::Scene | private |
| ProxyToMarker(const std::vector< CollisionProxy > &proxies, const std::string &frame) | exotica::Scene | |
| ps_ | exotica::Scene | private |
| ps_pub_ | exotica::Scene | private |
| PublishProxies(const std::vector< CollisionProxy > &proxies) | exotica::Scene | |
| PublishScene() | exotica::Scene | |
| RemoveObject(const std::string &name) | exotica::Scene | |
| RemoveTrajectory(const std::string &link) | exotica::Scene | |
| request_needs_updating_ | exotica::Scene | private |
| RequestKinematics(KinematicsRequest &request, std::function< void(std::shared_ptr< KinematicResponse >)> callback) | exotica::Scene | |
| robot_links_to_exclude_from_collision_scene_ | exotica::Scene | private |
| Scene(const std::string &name) | exotica::Scene | |
| Scene() | exotica::Scene | |
| SetModelState(Eigen::VectorXdRefConst x, double t=0, bool update_traj=true) | exotica::Scene | |
| SetModelState(const std::map< std::string, double > &x, double t=0, bool update_traj=true) | exotica::Scene | |
| trajectory_generators_ | exotica::Scene | private |
| type() const | exotica::Object | inlinevirtual |
| Uncopyable()=default | exotica::Uncopyable | private |
| Uncopyable(const Uncopyable &) | exotica::Uncopyable | private |
| Update(Eigen::VectorXdRefConst x, double t=0) | exotica::Scene | |
| UpdateCollisionObjects() | exotica::Scene | |
| UpdateInternalFrames(bool update_request=true) | exotica::Scene | private |
| UpdateMoveItPlanningScene() | exotica::Scene | private |
| UpdatePlanningScene(const moveit_msgs::PlanningScene &scene) | exotica::Scene | |
| UpdatePlanningSceneWorld(const moveit_msgs::PlanningSceneWorldConstPtr &world) | exotica::Scene | |
| UpdateSceneFrames() | exotica::Scene | |
| UpdateTrajectoryGenerators(double t=0) | exotica::Scene | |
| world_links_to_exclude_from_collision_scene_ | exotica::Scene | private |
| ~InstantiableBase()=default | exotica::InstantiableBase | virtual |
| ~Object() | exotica::Object | inlinevirtual |
| ~Scene() | exotica::Scene | virtual |
| ~Uncopyable()=default | exotica::Uncopyable | private |