Namespaces | Classes | Typedefs | Enumerations | Functions | Variables
moveit::task_constructor Namespace Reference

Namespaces

 cost
 
 hasDeserialize > std
 
 Interface
 
 Property
 
 PropertyTypeRegistry
 
 solvers
 
 stages
 
 utils
 

Classes

class  Alternatives
 
class  ComputeBase
 
class  Connecting
 
class  ContainerBase
 
class  CostTerm
 
class  Fallbacks
 
class  FallbacksPrivateCommon
 
struct  FallbacksPrivateConnect
 
struct  FallbacksPrivateGenerator
 
struct  FallbacksPrivatePropagator
 
class  Generator
 
struct  hasDeserialize
 
struct  hasSerialize
 
class  InitStageException
 
class  Interface
 
class  InterfaceState
 
class  Introspection
 
struct  is_container
 
struct  is_container_helper
 
class  LambdaCostTerm
 
class  Merger
 
class  MonitoringGenerator
 
class  ParallelContainerBase
 
struct  PendingPairsPrinter
 
class  PreemptStageException
 
class  PropagatingBackward
 
class  PropagatingEitherWay
 
class  PropagatingForward
 
class  Property
 
class  PropertyMap
 
class  PropertySerializer
 
class  PropertySerializerBase
 
class  PropertyTypeRegistry
 
class  SerialContainer
 
class  SolutionBase
 
class  SolutionSequence
 
class  Stage
 
class  SubTrajectory
 
class  Task
 
struct  TmpSolutionContext
 
class  TrajectoryCostTerm
 
class  WrappedSolution
 
class  WrapperBase
 

Typedefs

typedef utils::Flags< InterfaceFlagInterfaceFlags
 
typedef std::pair< const InterfaceState &, const InterfaceState & > InterfaceStatePair
 
typedef std::function< void(visualization_msgs::Marker &, const std::string &)> MarkerCallback
 
typedef moveit_task_constructor_msgs::TrajectoryExecutionInfo TrajectoryExecutionInfo
 

Enumerations

enum  InterfaceFlag
 

Functions

 __attribute__ ((unused)) static void printChildrenInterfaces(const ContainerBasePrivate &container
 
visualization_msgs::Marker & createGeometryMarker (visualization_msgs::Marker &marker, const urdf::Geometry &geom, const urdf::Pose &pose, const urdf::Color &color)
 
const T & element (const urdf::Link &link)
 
const std::vector< T > & elements_vector (const urdf::Link &link)
 
constexpr InterfaceFlags END_IF_MASK ({ READS_END, WRITES_NEXT_START })
 
planning_scene::PlanningSceneConstPtr ensureUpdated (const planning_scene::PlanningScenePtr &scene)
 
const char * flowSymbol (InterfaceFlags f)
 
const char * flowSymbol< END_IF_MASK > (InterfaceFlags f)
 
const char * flowSymbol< START_IF_MASK > (InterfaceFlags f)
 
boost::any fromName (const PropertyMap &other, const std::string &other_name)
 
void generateCollisionMarkers (const moveit::core::RobotState &robot_state, const MarkerCallback &callback, const std::vector< const moveit::core::LinkModel * > &link_models)
 
void generateCollisionMarkers (const moveit::core::RobotState &robot_state, const MarkerCallback &callback, const std::vector< std::string > &link_names={})
 
void generateMarkers (const moveit::core::RobotState &robot_state, const MarkerCallback &callback, const std::vector< std::string > &link_names={})
 
void generateMarkersForObjects (const planning_scene::PlanningSceneConstPtr &scene, const MarkerCallback &callback, const std::vector< std::string > &object_names={})
 
void generateMarkersForScene (const planning_scene::PlanningSceneConstPtr &scene, const MarkerCallback &callback)
 
void generateVisualMarkers (const moveit::core::RobotState &robot_state, const MarkerCallback &callback, const std::vector< const moveit::core::LinkModel * > &link_models)
 
void generateVisualMarkers (const moveit::core::RobotState &robot_state, const MarkerCallback &callback, const std::vector< std::string > &link_names={})
 
size_t getIndex (const T &container, typename T::const_iterator search)
 
constexpr InterfaceFlags invert (InterfaceFlags f)
 
std::vector< std::string > linkNames (const std::vector< const moveit::core::LinkModel * > &link_models)
 
const urdf::ColormaterialColor (const urdf::ModelInterface &model, const std::string &material_name)
 
const std::string & materialName (const T &element)
 
const std::string & materialName (const urdf::Collision &)
 
const std::string & materialName (const urdf::Visual &element)
 
moveit::core::JointModelGroupmerge (const std::vector< const moveit::core::JointModelGroup * > &groups)
 
robot_trajectory::RobotTrajectoryPtr merge (const std::vector< robot_trajectory::RobotTrajectoryConstPtr > &sub_trajectories, const moveit::core::RobotState &base_state, moveit::core::JointModelGroup *&merged_group, const trajectory_processing::TimeParameterization &time_parameterization)
 
 MOVEIT_CLASS_FORWARD (ContainerBase)
 
 MOVEIT_CLASS_FORWARD (CostTerm)
 
 MOVEIT_CLASS_FORWARD (Interface)
 
 MOVEIT_CLASS_FORWARD (InterfaceState)
 
 MOVEIT_CLASS_FORWARD (Introspection)
 
 MOVEIT_CLASS_FORWARD (Property)
 
 MOVEIT_CLASS_FORWARD (SolutionBase)
 
 MOVEIT_CLASS_FORWARD (SolutionSequence)
 
 MOVEIT_CLASS_FORWARD (Stage)
 
 MOVEIT_CLASS_FORWARD (SubTrajectory)
 
 MOVEIT_CLASS_FORWARD (Task)
 
std::ostream & operator<< (std::ostream &os, const ContainerBase &stage)
 
std::ostream & operator<< (std::ostream &os, const InitStageException &e)
 
std::ostream & operator<< (std::ostream &os, const Interface &interface)
 
std::ostream & operator<< (std::ostream &os, const InterfaceState::Priority &prio)
 
std::ostream & operator<< (std::ostream &os, const PendingPairsPrinter &printer)
 
std::ostream & operator<< (std::ostream &os, const Stage &stage)
 
std::ostream & operator<< (std::ostream &os, const StagePrivate &stage)
 
std::ostream & operator<< (std::ostream &os, const Task &task)
 
std::ostream & operator<< (std::ostream &os, Interface::Direction dir)
 
constexpr Interface::Direction opposite ()
 
constexpr Interface::Direction opposite< Interface::BACKWARD > ()
 
constexpr Interface::Direction opposite< Interface::FORWARD > ()
 
template void PropagatingEitherWay::send< Interface::BACKWARD > (const InterfaceState &start, InterfaceState &&end, SubTrajectory &&trajectory)
 
template void PropagatingEitherWay::send< Interface::FORWARD > (const InterfaceState &start, InterfaceState &&end, SubTrajectory &&trajectory)
 
void PropertyMap::set< boost::any > (const std::string &name, const boost::any &value)
 
constexpr InterfaceFlags START_IF_MASK ({ READS_START, WRITES_PREV_END })
 
const InterfaceStatestate (const SolutionBase &solution)
 
const InterfaceStatestate< Interface::BACKWARD > (const SolutionBase &solution)
 
const InterfaceStatestate< Interface::FORWARD > (const SolutionBase &solution)
 
const InterfaceState::Solutionstrajectories (const InterfaceState &state)
 
const InterfaceState::Solutionstrajectories< Interface::BACKWARD > (const InterfaceState &state)
 
const InterfaceState::Solutionstrajectories< Interface::FORWARD > (const InterfaceState &state)
 

Variables

 CONNECT
 
bool const Stagecreator
 
 GENERATE
 
const std::string LOGNAME
 
bool const Stage std::ostream & os
 
 PROPAGATE_BACKWARDS
 
 PROPAGATE_FORWARDS
 
 READS_END
 
 READS_START
 
static PropertyTypeRegistry REGISTRY_SINGLETON
 
bool success
 
constexpr InterfaceFlags UNKNOWN
 
 WRITES_NEXT_START
 
 WRITES_PREV_END
 


visualization
Author(s): Robert Haschke
autogenerated on Thu Feb 27 2025 03:39:51