| 
|   | RosRobot (const dart::common::Uri &urdf, const dart::common::Uri &srdf, const std::string name, const bool addDefaultExecutors, const dart::common::ResourceRetrieverPtr &retriever=std::make_shared< aikido::io::CatkinResourceRetriever >(), const ::ros::NodeHandle &node=::ros::NodeHandle(), const std::string modeControllerName="") | 
|   | Construct a new RosRobot object.  More...
  | 
|   | 
|   | RosRobot (dart::dynamics::ReferentialSkeletonPtr refSkeleton, Robot *rootRobot, dart::collision::CollisionDetectorPtr collisionDetector, std::shared_ptr< dart::collision::BodyNodeCollisionFilter > collisionFilter, const std::string name, const ::ros::NodeHandle &node=::ros::NodeHandle(), const std::string modeControllerName="") | 
|   | Construct a new RosRobot as subrobot.  More...
  | 
|   | 
| virtual  | ~RosRobot ()=default | 
|   | Destructor.  More...
  | 
|   | 
| void  | step (const std::chrono::system_clock::time_point &timepoint) override | 
|   | Steps the ros robot (and underlying executors and subrobots) through time.  More...
  | 
|   | 
| RobotPtr  | registerSubRobot (dart::dynamics::ReferentialSkeletonPtr refSkeleton, const std::string &name, const std::string &modeControllerName="") | 
|   | Registers a subset of the joints of the skeleton as a new RosRobot.  More...
  | 
|   | 
| void  | deactivateExecutor () override | 
|   | Stops the controller corresponding to this executor and deactivates executor.  More...
  | 
|   | 
| int  | registerExecutor (aikido::control::ExecutorPtr executor, std::string desiredName, std::string controllerName, hardware_interface::JointCommandModes controllerMode) | 
|   | Loads the controller.  More...
  | 
|   | 
| int  | registerExecutor (aikido::control::ExecutorPtr executor, std::string desiredName, std::string controllerName) | 
|   | Loads the controller.  More...
  | 
|   | 
| bool  | activateExecutor (const int id) override | 
|   | Deactivates the current active executor.  More...
  | 
|   | 
| void  | setRosControllerClients (const std::string modeControllerName) | 
|   | Sets the ros controller clients which enable controller listing, loading, switching and mode switching.  More...
  | 
|   | 
| virtual bool  | activateExecutor (const int id) | 
|   | Deactivates the current active executor.  More...
  | 
|   | 
| virtual bool  | activateExecutor (const std::string name) | 
|   | Convenience: Activates executor using name Deactivates the current active executor.  More...
  | 
|   | 
| virtual bool  | activateExecutor (const aikido::control::ExecutorType type) | 
|   | Convenience: Deactivates the current active executor.  More...
  | 
|   | 
|   | Robot (dart::dynamics::SkeletonPtr skeleton, const std::string name="robot", bool addDefaultExecutors=true) | 
|   | Construct a new Robot object.  More...
  | 
|   | 
|   | Robot (dart::dynamics::ReferentialSkeletonPtr refSkeleton, Robot *rootRobot, dart::collision::CollisionDetectorPtr collisionDetector, std::shared_ptr< dart::collision::BodyNodeCollisionFilter > collisionFilter, const std::string name="subrobot") | 
|   | Construct a new Robot as subrobot.  More...
  | 
|   | 
| virtual  | ~Robot ()=default | 
|   | Destructor.  More...
  | 
|   | 
| virtual void  | ignoreSelfCollisionPairs (const std::vector< std::pair< std::string, std::string >> bodyNodeList) | 
|   | Manually add pairs of body nodes for which collision is ignored Note: adjacent body pairs are already ignored.  More...
  | 
|   | 
| virtual void  | enforceSelfCollisionPairs (const std::vector< std::pair< std::string, std::string >> bodyNodeList) | 
|   | Manually remove pairs of body nodes for which collision constraints are enforced.  More...
  | 
|   | 
| constraint::dart::CollisionFreePtr  | getSelfCollisionConstraint () const | 
|   | Get the self-collision constraint of the robot.  More...
  | 
|   | 
| constraint::TestablePtr  | combineCollisionConstraint (const constraint::dart::CollisionFreePtr &collisionFree) const | 
|   | Given a collision constraint, returns it combined with the self-collision constraint of the entire robot.  More...
  | 
|   | 
| constraint::TestablePtr  | getWorldCollisionConstraint (const std::vector< std::string > bodyNames=std::vector< std::string >()) const | 
|   | Get the collision constraint between this (sub)robot and selected bodies within its World, combined with its self-collision constraint.  More...
  | 
|   | 
| virtual RobotPtr  | registerSubRobot (dart::dynamics::ReferentialSkeletonPtr refSkeleton, const std::string &name) | 
|   | Registers a subset of the joints of the skeleton as a new robot.  More...
  | 
|   | 
| RobotPtr  | getSubRobotByName (const std::string &name) const | 
|   | Get existing subrobot pointer.  More...
  | 
|   | 
| Eigen::VectorXd  | getNamedConfiguration (const std::string &name) const | 
|   | Returns a named configuration, or size-0 vector if not found.  More...
  | 
|   | 
| void  | setNamedConfigurations (std::unordered_map< std::string, const Eigen::VectorXd > namedConfigurations) | 
|   | Sets the list of named configurations.  More...
  | 
|   | 
| trajectory::TrajectoryPtr  | planToConfiguration (const Eigen::VectorXd &goalConf, const constraint::TestablePtr &testableConstraint, const std::shared_ptr< planner::ConfigurationToConfigurationPlanner > &planner=nullptr, const std::shared_ptr< aikido::planner::TrajectoryPostProcessor > trajPostProcessor=nullptr) const | 
|   | Plan the robot to a specific configuration.  More...
  | 
|   | 
| trajectory::TrajectoryPtr  | planToConfiguration (const Eigen::VectorXd &goalConf, const std::shared_ptr< planner::ConfigurationToConfigurationPlanner > &planner=nullptr, const std::shared_ptr< aikido::planner::TrajectoryPostProcessor > trajPostProcessor=nullptr) const | 
|   | Default to selfCollisionConstraint.  More...
  | 
|   | 
| trajectory::TrajectoryPtr  | planToOffset (const std::string bodyNodeName, const Eigen::Vector3d &offset, const constraint::TestablePtr &testableConstraint, const std::shared_ptr< planner::dart::ConfigurationToEndEffectorOffsetPlanner > &planner=nullptr, const std::shared_ptr< aikido::planner::TrajectoryPostProcessor > trajPostProcessor=nullptr) const | 
|   | Plan a specific body node of the robot to a position offset.  More...
  | 
|   | 
| trajectory::TrajectoryPtr  | planToOffset (const std::string bodyNodeName, const Eigen::Vector3d &offset, const std::shared_ptr< planner::dart::ConfigurationToEndEffectorOffsetPlanner > &planner=nullptr, const std::shared_ptr< aikido::planner::TrajectoryPostProcessor > trajPostProcessor=nullptr) const | 
|   | Default to selfCollisionConstraint.  More...
  | 
|   | 
| trajectory::TrajectoryPtr  | planToPoseOffset (const std::string bodyNodeName, const Eigen::Vector3d &offset, const Eigen::Vector3d &rotation, const constraint::TestablePtr &testableConstraint, const std::shared_ptr< planner::dart::ConfigurationToEndEffectorPosePlanner > &planner=nullptr, const std::shared_ptr< aikido::planner::TrajectoryPostProcessor > trajPostProcessor=nullptr) const | 
|   | Plan a specific body node of the robot to a pose offset (i.e.  More...
  | 
|   | 
| trajectory::TrajectoryPtr  | planToPoseOffset (const std::string bodyNodeName, const Eigen::Vector3d &offset, const Eigen::Vector3d &rotation, const std::shared_ptr< planner::dart::ConfigurationToEndEffectorPosePlanner > &planner=nullptr, const std::shared_ptr< aikido::planner::TrajectoryPostProcessor > trajPostProcessor=nullptr) const | 
|   | Default to selfCollisionConstraint.  More...
  | 
|   | 
| trajectory::TrajectoryPtr  | planToTSR (const std::string bodyNodeName, const constraint::dart::TSRPtr &tsr, const constraint::TestablePtr &testableConstraint, const util::PlanToTSRParameters ¶ms=util::PlanToTSRParameters(), const std::shared_ptr< planner::ConfigurationToConfigurationPlanner > &planner=nullptr, const std::shared_ptr< aikido::planner::TrajectoryPostProcessor > trajPostProcessor=nullptr, const distance::ConstConfigurationRankerPtr &ranker=nullptr) const | 
|   | Plan a specific body node of the robot to a sample configuraiton within a Task Space Region.  More...
  | 
|   | 
| trajectory::TrajectoryPtr  | planToTSR (const std::string bodyNodeName, const constraint::dart::TSRPtr &tsr, const util::PlanToTSRParameters ¶ms=util::PlanToTSRParameters(), const std::shared_ptr< planner::ConfigurationToConfigurationPlanner > &planner=nullptr, const std::shared_ptr< aikido::planner::TrajectoryPostProcessor > trajPostProcessor=nullptr, const distance::ConstConfigurationRankerPtr &ranker=nullptr) const | 
|   | Default to selfCollisionConstraint.  More...
  | 
|   | 
| virtual void  | clearExecutors () | 
|   | Deactivates the active executor.  More...
  | 
|   | 
| virtual aikido::control::ExecutorPtr  | getActiveExecutor () | 
|   | Retrieves the active executor.  More...
  | 
|   | 
| virtual int  | registerExecutor (aikido::control::ExecutorPtr executor, std::string desiredName="") | 
|   | Add an executor to the inactive executors list.  More...
  | 
|   | 
| virtual bool  | activateExecutor (const std::string name) | 
|   | Convenience: Activates executor using name Deactivates the current active executor.  More...
  | 
|   | 
| virtual bool  | activateExecutor (const aikido::control::ExecutorType type) | 
|   | Convenience: Deactivates the current active executor.  More...
  | 
|   | 
| template<aikido::control::ExecutorType T>  | 
| std::future< int >  | executeJointCommand (const std::vector< double > &command, const std::chrono::duration< double > &timeout) | 
|   | Convenience: executes given joint command on the robot.  More...
  | 
|   | 
| std::future< void >  | executeTrajectory (const trajectory::TrajectoryPtr &trajectory) | 
|   | Convenience: executes given trajectory on the robot.  More...
  | 
|   | 
| virtual void  | cancelAllCommands (bool includeSubrobots=true, bool includeParents=false, const std::vector< std::string > excludeSubrobots=std::vector< std::string >()) | 
|   | Cancels all running commands on this robot.  More...
  | 
|   | 
| std::string  | getName () const | 
|   | 
| dart::dynamics::MetaSkeletonPtr  | getMetaSkeletonClone () const | 
|   | 
| dart::dynamics::MetaSkeletonPtr  | getMetaSkeleton () | 
|   | 
| const dart::dynamics::MetaSkeletonPtr  | getMetaSkeleton () const | 
|   | 
| Eigen::VectorXd  | getCurrentConfiguration () const | 
|   | 
| common::UniqueRNGPtr  | cloneRNG () const | 
|   | 
| void  | setRNG (common::UniqueRNGPtr rng) | 
|   | 
| aikido::planner::WorldPtr  | getWorld () const | 
|   | 
| void  | setWorld (aikido::planner::WorldPtr world) | 
|   | 
| void  | setDefaultPostProcessor (const std::shared_ptr< aikido::planner::TrajectoryPostProcessor > trajPostProcessor) | 
|   | 
| std::shared_ptr< aikido::planner::TrajectoryPostProcessor >  | getDefaultPostProcessor () const | 
|   | 
| void  | setEnablePostProcessing (bool enable=true) | 
|   | 
| dart::dynamics::ConstSkeletonPtr  | getRootSkeleton () const | 
|   | 
| dart::dynamics::SkeletonPtr  | getRootSkeleton () | 
|   | 
| util::VectorFieldPlannerParameters  | getVFParams () const | 
|   | 
| void  | setVFParams (util::VectorFieldPlannerParameters params) | 
|   | 
Robot interface augmented with ROS components.