This is the complete list of members for moveit::core::RobotModelBuilder, including all inherited members.
| addChain(const std::string §ion, const std::string &type, const std::vector< geometry_msgs::Pose > &joint_origins={}, urdf::Vector3 joint_axis=urdf::Vector3(1.0, 0.0, 0.0)) | moveit::core::RobotModelBuilder | |
| addCollisionBox(const std::string &link_name, const std::vector< double > &dims, geometry_msgs::Pose origin) | moveit::core::RobotModelBuilder | |
| addCollisionMesh(const std::string &link_name, const std::string &filename, geometry_msgs::Pose origin) | moveit::core::RobotModelBuilder | |
| addCollisionSphere(const std::string &link_name, double dims, geometry_msgs::Pose origin) | moveit::core::RobotModelBuilder | |
| addEndEffector(const std::string &name, const std::string &parent_link, const std::string &parent_group="", const std::string &component_group="") | moveit::core::RobotModelBuilder | |
| addGroup(const std::vector< std::string > &links, const std::vector< std::string > &joints, const std::string &name) | moveit::core::RobotModelBuilder | |
| addGroupChain(const std::string &base_link, const std::string &tip_link, const std::string &name="") | moveit::core::RobotModelBuilder | |
| addInertial(const std::string &link_name, double mass, geometry_msgs::Pose origin, double ixx, double ixy, double ixz, double iyy, double iyz, double izz) | moveit::core::RobotModelBuilder | |
| addJointProperty(const std::string &joint_name, const std::string &property_name, const std::string &value) | moveit::core::RobotModelBuilder | |
| addLinkCollision(const std::string &link_name, const urdf::CollisionSharedPtr &coll, geometry_msgs::Pose origin) | moveit::core::RobotModelBuilder | private |
| addLinkVisual(const std::string &link_name, const urdf::VisualSharedPtr &vis, geometry_msgs::Pose origin) | moveit::core::RobotModelBuilder | private |
| addVirtualJoint(const std::string &parent_frame, const std::string &child_link, const std::string &type, const std::string &name="") | moveit::core::RobotModelBuilder | |
| addVisualBox(const std::string &link_name, const std::vector< double > &size, geometry_msgs::Pose origin) | moveit::core::RobotModelBuilder | |
| build() | moveit::core::RobotModelBuilder | |
| is_valid_ | moveit::core::RobotModelBuilder | private |
| isValid() | moveit::core::RobotModelBuilder | |
| RobotModelBuilder(const std::string &name, const std::string &base_link_name) | moveit::core::RobotModelBuilder | |
| srdf_writer_ | moveit::core::RobotModelBuilder | private |
| urdf_model_ | moveit::core::RobotModelBuilder | private |