|
typedef boost::shared_ptr< AbstractSeq > | AbstractSeqPtr |
|
typedef boost::shared_ptr< AbstractMultiSeq > | AbstractMultiSeqPtr |
|
typedef std::vector< Collision > | CollisionArray |
|
typedef std::vector< Collision > | CollisionList |
| obsolete More...
|
|
typedef boost::shared_ptr< CollisionPair > | CollisionPairPtr |
|
typedef boost::shared_ptr< CollisionDetector > | CollisionDetectorPtr |
|
typedef std::vector< double > | DaeVectorXArray |
|
typedef boost::shared_ptr< DaeVectorXArray > | DaeVectorXArrayPtr |
|
typedef std::map< std::string, DaeVectorXArrayPtr > | DaeVectorMap |
|
typedef ref_ptr< DaeTexture > | DaeTexturePtr |
|
typedef std::map< std::string, DaeTexturePtr > | DaeTextures |
|
typedef std::vector< Vector3 > | Vector3s |
|
typedef ref_ptr< DaeTransform > | DaeTransformPtr |
|
typedef ref_ptr< DaeEffect > | DaeEffectPtr |
|
typedef std::map< std::string, DaeEffectPtr > | DaeEffects |
|
typedef ref_ptr< DaeMaterial > | DaeMaterialPtr |
|
typedef std::map< std::string, DaeMaterialPtr > | DaeMaterials |
|
typedef std::map< std::string, std::string > | DaeMaterialRef |
|
typedef ref_ptr< DaeMesh > | DaeMeshPtr |
|
typedef std::vector< DaeMeshPtr > | DaeMeshes |
|
typedef ref_ptr< DaeGeometry > | DaeGeometryPtr |
|
typedef std::map< std::string, DaeGeometryPtr > | DaeGeometries |
|
typedef ref_ptr< DaeNode > | DaeNodePtr |
|
typedef std::map< std::string, DaeNodePtr > | DaeNodes |
|
typedef std::vector< std::pair< std::string, DaeNodePtr > > | DaeNodeStack |
|
typedef ref_ptr< DaeShape > | DaeShapePtr |
|
typedef std::vector< DaeShapePtr > | DaeShapes |
|
typedef ref_ptr< DaeMassFrame > | DaeMassFramePtr |
|
typedef ref_ptr< DaeRigid > | DaeRigidPtr |
|
typedef std::map< std::string, DaeRigidPtr > | DaeRigids |
|
typedef std::map< std::string, std::string > | DaeRigidRelations |
|
typedef ref_ptr< DaeRevolute > | DaeRevolutePtr |
|
typedef std::map< std::string, DaeRevolutePtr > | DaeRevolutes |
|
typedef std::vector< DaeRevolutePtr > | DaeRevoluteChildren |
|
typedef std::vector< std::string > | DaeLinkChildren |
|
typedef std::vector< std::string > | DaeJointChildren |
|
typedef ref_ptr< DaeActuator > | DaeActuatorPtr |
|
typedef std::map< std::string, DaeActuatorPtr > | DaeActuators |
|
typedef std::map< std::string, std::string > | DaeActuatorRelations |
|
typedef ref_ptr< DaeSensor > | DaeSensorPtr |
|
typedef std::map< std::string, DaeSensorPtr > | DaeSensors |
|
typedef std::vector< DaeSensor * > | DaeResultSensors |
|
typedef boost::shared_ptr< DaeResultSensors > | DaeResultSensorsPtr |
|
typedef std::vector< std::pair< std::string, std::string > > | DaeSensorRelations |
|
typedef ref_ptr< DaeAttachActuator > | DaeAttachActuatorPtr |
|
typedef ref_ptr< DaeAttachSensor > | DaeAttachSensorPtr |
|
typedef ref_ptr< DaeLink > | DaeLinkPtr |
|
typedef std::map< std::string, DaeLinkPtr > | DaeLinks |
|
typedef ref_ptr< DaeJoint > | DaeJointPtr |
|
typedef std::map< std::string, DaeJointPtr > | DaeJoints |
|
typedef pair< string, DaeGeometryPtr > | GEOMETRY_PAIR |
|
typedef pair< string, DaeNodePtr > | NODES_PAIR |
|
typedef std::vector< std::string > | DaeOrder |
|
typedef std::map< std::string, int > | DaeStrides |
|
typedef std::map< std::string, std::string > | DaeVerticesRef |
|
typedef Eigen::Matrix2d | Matrix2 |
|
typedef Eigen::Vector2d | Vector2 |
|
typedef Eigen::Matrix3d | Matrix3 |
|
typedef Eigen::Vector3d | Vector3 |
|
typedef Eigen::Matrix4d | Matrix4 |
|
typedef Eigen::Vector4d | Vector4 |
|
typedef Eigen::VectorXd | VectorX |
|
typedef Eigen::Matrix< double, 6, 1 > | Vector6 |
|
typedef Eigen::Affine3d | Affine3 |
|
typedef Eigen::Translation3d | Translation3 |
|
typedef Eigen::AngleAxisd | AngleAxis |
|
typedef Eigen::Quaterniond | Quat |
|
typedef Eigen::Quaterniond | Quaternion |
|
typedef Eigen::Transform< double, 3, Eigen::AffineCompact > | Position |
|
typedef Eigen::Isometry3d | Isometry3 |
|
typedef boost::error_info< struct tag_error_info_message, std::string > | error_info_message |
|
typedef boost::error_info< struct tag_error_info_key, std::string > | error_info_key |
|
typedef MultiAffine3Seq::Ptr | MultiAffine3SeqPtr |
|
typedef MultiSE3Seq::Ptr | MultiSE3SeqPtr |
|
typedef MultiValueSeq::Ptr | MultiValueSeqPtr |
|
typedef MultiVector3Seq::Ptr | MultiVector3SeqPtr |
|
typedef ref_ptr< Referenced > | ReferencedPtr |
|
typedef ref_ptr< SgCamera > | SgCameraPtr |
|
typedef ref_ptr< SgPerspectiveCamera > | SgPerspectiveCameraPtr |
|
typedef ref_ptr< SgOrthographicCamera > | SgOrthographicCameraPtr |
|
typedef ref_ptr< SgMaterial > | SgMaterialPtr |
|
typedef ref_ptr< SgImage > | SgImagePtr |
|
typedef ref_ptr< SgTextureTransform > | SgTextureTransformPtr |
|
typedef ref_ptr< SgTexture > | SgTexturePtr |
|
typedef SgVectorArray< Vector3f > | SgVertexArray |
|
typedef ref_ptr< SgVertexArray > | SgVertexArrayPtr |
|
typedef SgVectorArray< Vector3f > | SgNormalArray |
|
typedef ref_ptr< SgNormalArray > | SgNormalArrayPtr |
|
typedef SgVectorArray< Vector3f > | SgColorArray |
|
typedef ref_ptr< SgColorArray > | SgColorArrayPtr |
|
typedef SgVectorArray< Vector2f, Eigen::aligned_allocator< Vector2f > > | SgTexCoordArray |
|
typedef ref_ptr< SgTexCoordArray > | SgTexCoordArrayPtr |
|
typedef std::vector< int > | SgIndexArray |
|
typedef ref_ptr< SgMeshBase > | SgMeshBasePtr |
|
typedef ref_ptr< SgMesh > | SgMeshPtr |
|
typedef ref_ptr< SgPolygonMesh > | SgPolygonMeshPtr |
|
typedef ref_ptr< SgShape > | SgShapePtr |
|
typedef ref_ptr< SgPlot > | SgPlotPtr |
|
typedef ref_ptr< SgPointSet > | SgPointSetPtr |
|
typedef ref_ptr< SgLineSet > | SgLineSetPtr |
|
typedef ref_ptr< SgFog > | SgFogPtr |
|
typedef ref_ptr< SgOutlineGroup > | SgOutlineGroupPtr |
|
typedef ref_ptr< SgObject > | SgObjectPtr |
|
typedef ref_ptr< SgNode > | SgNodePtr |
|
typedef std::vector< SgNode * > | SgNodePath |
|
typedef ref_ptr< SgGroup > | SgGroupPtr |
|
typedef ref_ptr< SgInvariantGroup > | SgInvariantGroupPtr |
|
typedef ref_ptr< SgTransform > | SgTransformPtr |
|
typedef ref_ptr< SgPosTransform > | SgPosTransformPtr |
|
typedef ref_ptr< SgScaleTransform > | SgScaleTransformPtr |
|
typedef ref_ptr< SgSwitch > | SgSwitchPtr |
|
typedef ref_ptr< SgUnpickableGroup > | SgUnpickableGroupPtr |
|
typedef ref_ptr< SgLight > | SgLightPtr |
|
typedef ref_ptr< SgDirectionalLight > | SgDirectionalLightPtr |
|
typedef ref_ptr< SgPointLight > | SgPointLightPtr |
|
typedef ref_ptr< SgSpotLight > | SgSpotLightPtr |
|
typedef ref_ptr< CrossMarker > | CrossMarkerPtr |
|
typedef ref_ptr< SphereMarker > | SphereMarkerPtr |
|
typedef ref_ptr< BoundingBoxMarker > | BoundingBoxMarkerPtr |
|
typedef boost::function< void(TaskProc *proc)> | TaskFunc |
|
typedef ref_ptr< TaskToggleState > | TaskToggleStatePtr |
|
typedef ref_ptr< TaskCommand > | TaskCommandPtr |
|
typedef ref_ptr< TaskPhaseProxy > | TaskPhaseProxyPtr |
|
typedef ref_ptr< TaskPhase > | TaskPhasePtr |
|
typedef ref_ptr< Task > | TaskPtr |
|
typedef ref_ptr< ValueNode > | ValueNodePtr |
|
typedef ref_ptr< Mapping > | MappingPtr |
|
typedef ref_ptr< Listing > | ListingPtr |
|
typedef boost::shared_ptr< Vector3Seq > | Vector3SeqPtr |
|
typedef bool | SFBool |
|
typedef int | SFInt32 |
|
typedef double | SFFloat |
|
typedef std::string | SFString |
|
typedef Eigen::Vector2d | SFVec2f |
|
typedef Eigen::Vector2f | SFVec2s |
|
typedef Eigen::Vector3d | SFVec3f |
|
typedef Eigen::Vector3f | SFVec3s |
|
typedef Eigen::Vector3f | SFColor |
|
typedef Eigen::AngleAxisd | SFRotation |
|
typedef std::vector< SFInt32 > | MFInt32 |
|
typedef std::vector< SFFloat > | MFFloat |
|
typedef std::vector< SFVec2f, Eigen::aligned_allocator< SFVec2f > > | MFVec2f |
|
typedef std::vector< SFVec2s > | MFVec2s |
|
typedef std::vector< SFVec3f > | MFVec3f |
|
typedef std::vector< SFVec3s > | MFVec3s |
|
typedef std::vector< SFRotation > | MFRotation |
|
typedef std::vector< SFTime > | MFTime |
|
typedef std::vector< SFColor > | MFColor |
|
typedef std::vector< SFString > | MFString |
|
typedef boost::intrusive_ptr< VRMLNode > | VRMLNodePtr |
|
typedef VRMLNodePtr | SFNode |
|
typedef std::vector< SFNode > | MFNode |
|
typedef boost::intrusive_ptr< VRMLUnsupportedNode > | VRMLUnsupportedNodePtr |
|
typedef boost::intrusive_ptr< VRMLViewpoint > | VRMLViewpointPtr |
|
typedef boost::intrusive_ptr< VRMLNavigationInfo > | VRMLNavigationInfoPtr |
|
typedef boost::intrusive_ptr< VRMLBackground > | VRMLBackgroundPtr |
|
typedef boost::intrusive_ptr< AbstractVRMLGroup > | AbstractVRMLGroupPtr |
|
typedef boost::intrusive_ptr< VRMLGroup > | VRMLGroupPtr |
|
typedef boost::intrusive_ptr< VRMLTransform > | VRMLTransformPtr |
|
typedef boost::intrusive_ptr< VRMLInline > | VRMLInlinePtr |
|
typedef boost::intrusive_ptr< VRMLAnotherFormatFile > | VRMLAnotherFormatFilePtr |
|
typedef boost::intrusive_ptr< VRMLAppearance > | VRMLAppearancePtr |
|
typedef boost::intrusive_ptr< VRMLGeometry > | VRMLGeometryPtr |
|
typedef boost::intrusive_ptr< VRMLShape > | VRMLShapePtr |
|
typedef boost::intrusive_ptr< VRMLMaterial > | VRMLMaterialPtr |
|
typedef boost::intrusive_ptr< VRMLTexture > | VRMLTexturePtr |
|
typedef boost::intrusive_ptr< VRMLTextureTransform > | VRMLTextureTransformPtr |
|
typedef boost::intrusive_ptr< VRMLImageTexture > | VRMLImageTexturePtr |
|
typedef boost::intrusive_ptr< VRMLBox > | VRMLBoxPtr |
|
typedef boost::intrusive_ptr< VRMLCone > | VRMLConePtr |
|
typedef boost::intrusive_ptr< VRMLCylinder > | VRMLCylinderPtr |
|
typedef boost::intrusive_ptr< VRMLSphere > | VRMLSpherePtr |
|
typedef boost::intrusive_ptr< VRMLFontStyle > | VRMLFontStylePtr |
|
typedef boost::intrusive_ptr< VRMLText > | VRMLTextPtr |
|
typedef boost::intrusive_ptr< VRMLColor > | VRMLColorPtr |
|
typedef boost::intrusive_ptr< VRMLCoordinate > | VRMLCoordinatePtr |
|
typedef boost::intrusive_ptr< VRMLIndexedLineSet > | VRMLIndexedLineSetPtr |
|
typedef boost::intrusive_ptr< VRMLNormal > | VRMLNormalPtr |
|
typedef boost::intrusive_ptr< VRMLTextureCoordinate > | VRMLTextureCoordinatePtr |
|
typedef boost::intrusive_ptr< VRMLIndexedFaceSet > | VRMLIndexedFaceSetPtr |
|
typedef boost::intrusive_ptr< VRMLCylinderSensor > | VRMLCylinderSensorPtr |
|
typedef boost::intrusive_ptr< VRMLPointSet > | VRMLPointSetPtr |
|
typedef boost::intrusive_ptr< VRMLPixelTexture > | VRMLPixelTexturePtr |
|
typedef boost::intrusive_ptr< VRMLMovieTexture > | VRMLMovieTexturePtr |
|
typedef boost::intrusive_ptr< VRMLElevationGrid > | VRMLElevationGridPtr |
|
typedef boost::intrusive_ptr< VRMLExtrusion > | VRMLExtrusionPtr |
|
typedef boost::intrusive_ptr< VRMLSwitch > | VRMLSwitchPtr |
|
typedef boost::intrusive_ptr< VRMLLOD > | VRMLLODPtr |
|
typedef boost::intrusive_ptr< VRMLCollision > | VRMLCollisionPtr |
|
typedef boost::intrusive_ptr< VRMLAnchor > | VRMLAnchorPtr |
|
typedef boost::intrusive_ptr< VRMLBillboard > | VRMLBillboardPtr |
|
typedef boost::intrusive_ptr< VRMLFog > | VRMLFogPtr |
|
typedef boost::intrusive_ptr< VRMLWorldInfo > | VRMLWorldInfoPtr |
|
typedef boost::intrusive_ptr< VRMLLight > | VRMLLightPtr |
|
typedef boost::intrusive_ptr< VRMLPointLight > | VRMLPointLightPtr |
|
typedef boost::intrusive_ptr< VRMLDirectionalLight > | VRMLDirectionalLightPtr |
|
typedef boost::intrusive_ptr< VRMLSpotLight > | VRMLSpotLightPtr |
|
typedef boost::variant< SFBool, SFInt32, SFFloat, SFVec2f, SFVec3f, SFRotation, SFColor, SFTime, SFString, SFNode, SFImage, MFInt32, MFFloat, MFVec2f, MFVec3f, MFRotation, MFColor, MFTime, MFString, MFNode > | VRMLVariantField |
|
typedef std::map< std::string, VRMLVariantField > | VRMLProtoFieldMap |
|
typedef std::pair< std::string, VRMLVariantField > | VRMLProtoFieldPair |
|
typedef boost::intrusive_ptr< VRMLProto > | VRMLProtoPtr |
|
typedef boost::intrusive_ptr< VRMLProtoInstance > | VRMLProtoInstancePtr |
|
typedef void(VRMLWriter::* | VRMLWriterNodeMethod) (VRMLNodePtr node) |
|
typedef ref_ptr< AbstractSeqItem > | AbstractSeqItemPtr |
|
typedef ref_ptr< AbstractMultiSeqItem > | AbstractMultiSeqItemPtr |
|
typedef ref_ptr< AbstractTextItem > | AbstractTextItemPtr |
|
typedef ref_ptr< Archive > | ArchivePtr |
|
typedef ref_ptr< ExtCommandItem > | ExtCommandItemPtr |
|
typedef ref_ptr< FolderItem > | FolderItemPtr |
|
typedef ref_ptr< SgCustomGLNode > | SgCustomGLNodePtr |
|
typedef boost::shared_ptr< GraphDataHandler > | GraphDataHandlerPtr |
|
typedef ref_ptr< InteractiveCameraTransform > | InteractiveCameraTransformPtr |
|
typedef ref_ptr< Item > | ItemPtr |
|
typedef MultiSeqItem< MultiAffine3Seq > | MultiAffine3SeqItem |
|
typedef MultiAffine3SeqItem::Ptr | MultiAffine3SeqItemPtr |
|
typedef ref_ptr< MultiPointSetItem > | MultiPointSetItemPtr |
|
typedef MultiSeqItem< MultiSE3Seq > | MultiSE3SeqItem |
|
typedef MultiSE3SeqItem::Ptr | MultiSE3SeqItemPtr |
|
typedef MultiSeqItem< MultiValueSeq > | MultiValueSeqItem |
|
typedef MultiValueSeqItem::Ptr | MultiValueSeqItemPtr |
|
typedef ref_ptr< PointSetItem > | PointSetItemPtr |
|
typedef ref_ptr< PositionDragger > | PositionDraggerPtr |
|
typedef std::vector< std::string > | FileDialogFilter |
|
typedef ref_ptr< RectRegionMarker > | RectRegionMarkerPtr |
|
typedef ref_ptr< RootItem > | RootItemPtr |
|
typedef ref_ptr< RotationDragger > | RotationDraggerPtr |
|
typedef ref_ptr< SceneDragger > | SceneDraggerPtr |
|
typedef ref_ptr< SceneItem > | SceneItemPtr |
|
typedef ref_ptr< SceneWidgetRoot > | SceneWidgetRootPtr |
|
typedef ref_ptr< ScriptItem > | ScriptItemPtr |
|
typedef ref_ptr< TimeSyncItemEngine > | TimeSyncItemEnginePtr |
|
typedef ref_ptr< TranslationDragger > | TranslationDraggerPtr |
|
typedef ref_ptr< Vector3SeqItem > | Vector3SeqItemPtr |
|
typedef boost::shared_ptr< AbstractBodyLoader > | AbstractBodyLoaderPtr |
|
typedef ref_ptr< AccelerationSensor > | AccelerationSensorPtr |
|
typedef void * | BodyCustomizerHandle |
|
typedef ref_ptr< Body > | BodyPtr |
|
typedef void * | BodyHandle |
|
typedef int(* | BodyGetLinkIndexFromNameFunc) (BodyHandle bodyHandle, const char *linkName) |
|
typedef const char *(* | BodyGetLinkNameFunc) (BodyHandle bodyHandle, int linkIndex) |
|
typedef double *(* | BodyGetLinkDoubleValuePtrFunc) (BodyHandle bodyHandle, int linkIndex) |
|
typedef const char **(* | BodyCustomizerGetTargetModelNamesFunc) () |
|
typedef BodyCustomizerHandle(* | BodyCustomizerCreateFunc) (BodyHandle bodyHandle, const char *modelName) |
|
typedef void(* | BodyCustomizerDestroyFunc) (BodyCustomizerHandle customizerHandle) |
|
typedef int(* | BodyCustomizerInitializeAnalyticIkFunc) (BodyCustomizerHandle customizerHandle, int baseLinkIndex, int targetLinkIndex) |
|
typedef bool(* | BodyCustomizerCalcAnalyticIkFunc) (BodyCustomizerHandle customizerHandle, int ikPathId, const Vector3 &p, const Matrix3 &R) |
|
typedef void(* | BodyCustomizerSetVirtualJointForcesFunc) (BodyCustomizerHandle customizerHandle) |
|
typedef BodyCustomizerInterface *(* | GetBodyCustomizerInterfaceFunc) (BodyInterface *bodyInterface) |
|
typedef boost::shared_ptr< BodyMotion > | BodyMotionPtr |
|
typedef boost::shared_ptr< JointPath > | JointPathPtr |
|
typedef ref_ptr< Camera > | CameraPtr |
|
typedef map< string, Link * > | LoaderLinks |
|
typedef vector< string > | LoaderJoints |
|
typedef boost::shared_ptr< CollisionLinkPair > | CollisionLinkPairPtr |
|
typedef boost::shared_ptr< CompositeIK > | CompositeIKPtr |
|
typedef ref_ptr< DeviceState > | DeviceStatePtr |
|
typedef ref_ptr< Device > | DevicePtr |
|
typedef ref_ptr< DyBody > | DyBodyPtr |
|
typedef ref_ptr< ExtraBodyStateAccessor > | ExtraBodyStateAccessorPtr |
|
typedef ref_ptr< ForceSensor > | ForceSensorPtr |
|
typedef boost::shared_ptr< ForwardDynamics > | ForwardDynamicsPtr |
|
typedef boost::shared_ptr< ForwardDynamicsCBM > | ForwardDynamicsCBMPtr |
|
typedef boost::shared_ptr< InverseKinematics > | InverseKinematicsPtr |
|
typedef ref_ptr< LeggedBodyHelper > | LeggedBodyHelperPtr |
|
typedef ref_ptr< Light > | LightPtr |
|
typedef ref_ptr< Link > | LinkPtr |
|
typedef boost::shared_ptr< LinkGroup > | LinkGroupPtr |
|
typedef MultiDeviceStateSeq::Ptr | MultiDeviceStateSeqPtr |
|
typedef boost::shared_ptr< PenetrationBlocker > | PenetrationBlockerPtr |
|
typedef boost::shared_ptr< PinDragIK > | PinDragIKptr |
|
typedef ref_ptr< PointLight > | PointLightPtr |
|
typedef ref_ptr< RangeCamera > | RangeCameraPtr |
|
typedef ref_ptr< RangeSensor > | RangeSensorPtr |
|
typedef ref_ptr< RateGyroSensor > | RateGyroSensorPtr |
|
typedef ref_ptr< SceneLink > | SceneLinkPtr |
|
typedef ref_ptr< SceneBody > | SceneBodyPtr |
|
typedef ref_ptr< SceneCollision > | SceneCollisionPtr |
|
typedef ref_ptr< SceneDevice > | SceneDevicePtr |
|
typedef ref_ptr< SpotLight > | SpotLightPtr |
|
typedef boost::intrusive_ptr< VRMLHumanoid > | VRMLHumanoidPtr |
|
typedef boost::intrusive_ptr< VRMLJoint > | VRMLJointPtr |
|
typedef boost::intrusive_ptr< VRMLSegment > | VRMLSegmentPtr |
|
typedef boost::intrusive_ptr< VRMLSurface > | VRMLSurfacePtr |
|
typedef boost::intrusive_ptr< VRMLVisionSensor > | VRMLVisionSensorPtr |
|
typedef boost::intrusive_ptr< VRMLForceSensor > | VRMLForceSensorPtr |
|
typedef boost::intrusive_ptr< VRMLGyro > | VRMLGyroPtr |
|
typedef boost::intrusive_ptr< VRMLAccelerationSensor > | VRMLAccelerationSensorPtr |
|
typedef boost::intrusive_ptr< VRMLRangeSensor > | VRMLRangeSensorPtr |
|
typedef boost::shared_ptr< ZMPSeq > | ZMPSeqPtr |
|
typedef boost::shared_ptr< AISTCollisionDetector > | AISTCollisionDetectorPtr |
|
typedef boost::shared_ptr< ColdetModel > | ColdetModelPtr |
|
typedef boost::shared_ptr< ColdetModelPair > | ColdetModelPairPtr |
|
typedef ref_ptr< AISTSimulatorItem > | AISTSimulatorItemPtr |
|
typedef ref_ptr< BodyItem > | BodyItemPtr |
|
typedef ref_ptr< BodyMotionControllerItem > | BodyMotionControllerItemPtr |
|
typedef ref_ptr< BodyMotionEngine > | BodyMotionEnginePtr |
|
typedef ref_ptr< BodyMotionItem > | BodyMotionItemPtr |
|
typedef ref_ptr< BodyTrackingCameraItem > | BodyTrackingCameraItemPtr |
|
typedef std::vector< CollisionLinkPairPtr > | CollisionLinkPairList |
|
typedef boost::shared_ptr< CollisionLinkPairList > | CollisionLinkPairListPtr |
|
typedef boost::shared_ptr< CollisionSeq > | CollisionSeqPtr |
|
typedef ref_ptr< CollisionSeqEngine > | CollisionSeqEnginePtr |
|
typedef ref_ptr< CollisionSeqItem > | CollisionSeqItemPtr |
|
typedef ref_ptr< ControllerItem > | ControllerItemPtr |
|
typedef ref_ptr< EditableSceneLink > | EditableSceneLinkPtr |
|
typedef ref_ptr< EditableSceneBody > | EditableSceneBodyPtr |
|
typedef ref_ptr< GLVisionSimulatorItem > | GLVisionSimulatorItemPtr |
|
typedef ref_ptr< MultiDeviceStateSeqItem > | MultiDeviceStateSeqItemPtr |
|
typedef ref_ptr< SensorVisualizerItem > | SensorVisualizerItemPtr |
|
typedef ref_ptr< SimulationScriptItem > | SimulationScriptItemPtr |
|
typedef ref_ptr< SimulationBody > | SimulationBodyPtr |
|
typedef ref_ptr< SimulatorItem > | SimulatorItemPtr |
|
typedef ref_ptr< SubSimulatorItem > | SubSimulatorItemPtr |
|
typedef ref_ptr< WorldItem > | WorldItemPtr |
|
typedef ref_ptr< WorldLogFileItem > | WorldLogFileItemPtr |
|
typedef ref_ptr< ZMPSeqItem > | ZMPSeqItemPtr |
|
typedef ref_ptr< SimpleControllerItem > | SimpleControllerItemPtr |
|
typedef ref_ptr< PoseUnit > | PoseUnitPtr |
|
typedef ref_ptr< Pose > | PosePtr |
|
typedef ref_ptr< PoseSeq > | PoseSeqPtr |
|
typedef boost::shared_ptr< PoseSeqInterpolator > | PoseSeqInterpolatorPtr |
|
typedef ref_ptr< PoseSeqItem > | PoseSeqItemPtr |
|
typedef ref_ptr< PronunSymbol > | PronunSymbolPtr |
|
typedef boost::shared_ptr< ODECollisionDetector > | ODECollisionDetectorPtr |
|
typedef std::map< dBodyID, Link * > | CrawlerLinkMap |
|
typedef ref_ptr< ODESimulatorItem > | ODESimulatorItemPtr |
|
typedef boost::shared_ptr< BulletCollisionDetector > | BulletCollisionDetectorPtr |
|
typedef ref_ptr< BulletSimulatorItem > | BulletSimulatorItemPtr |
|
typedef ref_ptr< PythonScriptItem > | PythonScriptItemPtr |
|
typedef ref_ptr< PythonSimScriptItem > | PythonSimScriptItemPtr |
|
typedef ref_ptr< AudioItem > | AudioItemPtr |
|
typedef ref_ptr< MediaItem > | MediaItemPtr |
|
typedef ref_ptr< BodyRTCItem > | BodyRTCItemPtr |
|
typedef ref_ptr< OpenHRPClockGeneratorItem > | OpenHRPClockGeneratorItemPtr |
|
typedef map< string, string > | PropertyMap |
|
typedef ref_ptr< RTCItem > | RTCItemPtr |
|
typedef boost::shared_ptr< PortHandler > | PortHandlerPtr |
|
typedef boost::shared_ptr< OutPortHandler > | OutPortHandlerPtr |
|
typedef boost::shared_ptr< InPortHandler > | InPortHandlerPtr |
|
typedef ref_ptr< OpenHRPControllerItem > | OpenHRPControllerItemPtr |
|
typedef OpenHRPInterpreterServiceItemImpl | ItemImpl |
|
typedef ref_ptr< OpenHRPInterpreterServiceItem > | OpenHRPInterpreterServiceItemPtr |
|
typedef ref_ptr< OpenHRPOnlineViewerItem > | OpenHRPOnlineViewerItemPtr |
|
|
CNOID_EXPORT std::ostream & | operator<< (std::ostream &os, const BoundingBox &bb) |
|
CNOID_EXPORT std::ostream & | operator<< (std::ostream &os, const BoundingBoxf &bb) |
|
CNOID_EXPORT EasyScanner & | operator>> (EasyScanner &scanner, double &value) |
|
CNOID_EXPORT EasyScanner & | operator>> (EasyScanner &scanner, int &value) |
|
CNOID_EXPORT EasyScanner & | operator>> (EasyScanner &scanner, const char *matchString) |
|
CNOID_EXPORT EasyScanner & | operator>> (EasyScanner &scanner, char matchChar) |
|
CNOID_EXPORT EasyScanner & | operator>> (EasyScanner &scanner, std::string &str) |
|
CNOID_EXPORT EasyScanner & | operator>> (EasyScanner &scanner, EasyScanner::Endl endl) |
|
template<typename Derived > |
void | read (const Listing &listing, Eigen::MatrixBase< Derived > &x) |
|
template<typename Derived > |
bool | read (const Mapping &mapping, const std::string &key, Eigen::MatrixBase< Derived > &x) |
|
template<typename Scalar , int Dim, int Mode> |
bool | read (const Mapping &mapping, const std::string &key, Eigen::Transform< Scalar, Dim, Mode > &T) |
|
template<typename Derived > |
void | readEx (const Mapping &mapping, const std::string &key, Eigen::MatrixBase< Derived > &x) |
|
template<typename Derived > |
Listing & | write (Mapping &mapping, const std::string &key, const Eigen::MatrixBase< Derived > &x) |
|
template<typename Scalar , int Dim, int Mode> |
Listing & | write (Mapping &mapping, const std::string &key, const Eigen::Transform< Scalar, Dim, Mode > &T) |
|
template<typename Scalar > |
bool | read (const Mapping &mapping, const std::string &key, Eigen::AngleAxis< Scalar > &r) |
|
template<typename Scalar > |
Listing & | write (Mapping &mapping, const std::string &key, const Eigen::AngleAxis< Scalar > &r) |
|
bool | read (const Mapping &mapping, const std::string &key, boost::function< void(Vector3 &)> setterFunc) |
|
Matrix3 | rotFromRpy (double r, double p, double y) |
|
Vector3 | rpyFromRot (const Matrix3 &R) |
|
Vector3 | omegaFromRot (const Matrix3 &R) |
|
std::string | str (const Vector3 &v) |
|
bool | toVector3 (const std::string &s, Vector3 &out_v) |
|
void | normalizeRotation (Matrix3 &R) |
|
void | normalizeRotation (Position &T) |
|
void | normalizeRotation (Affine3 &T) |
|
double | degree (double rad) |
|
double | radian (double deg) |
|
float | degree (float rad) |
|
float | radian (float deg) |
|
double | radian (int deg) |
|
Matrix3 | rotFromRpy (const Vector3 &rpy) |
|
Matrix3 | hat (const Vector3 &x) |
|
template<class T > |
boost::shared_ptr< T > | make_shared_aligned () |
|
template<class T , class P1 > |
boost::shared_ptr< T > | make_shared_aligned (const P1 &p1) |
|
template<class T , class P1 , class P2 > |
boost::shared_ptr< T > | make_shared_aligned (const P1 &p1, const P2 &p2) |
|
template<class T , class P1 , class P2 , class P3 > |
boost::shared_ptr< T > | make_shared_aligned (const P1 &p1, const P2 &p2, const P3 &p3) |
|
template<class T , class P1 , class P2 , class P3 , class P4 > |
boost::shared_ptr< T > | make_shared_aligned (const P1 &p1, const P2 &p2, const P3 &p3, const P4 &p4) |
|
void | findExecutablePath () |
|
const std::string & | executablePath () |
|
const std::string & | executableDirectory () |
|
const std::string & | executableTopDirectory () |
|
const std::string & | shareDirectory () |
|
const std::string & | executableBasename () |
|
void | makePathCompact (const filesystem::path &path, filesystem::path &out_compact) |
|
int | findSubDirectory (const filesystem::path &directory, const filesystem::path &path, filesystem::path &out_subdirectory) |
|
bool | findRelativePath (const filesystem::path &from_, const filesystem::path &to, filesystem::path &out_relativePath) |
|
std::string | toActualPathName (const std::string &path) |
|
std::string | getExtension (const boost::filesystem::path &path) |
|
std::string | getGenericPathString (const boost::filesystem::path &path) |
|
bool | checkAbsolute (const boost::filesystem::path &path) |
|
boost::filesystem::path | getAbsolutePath (const boost::filesystem::path &path) |
|
std::string | getAbsolutePathString (const boost::filesystem::path &path) |
|
std::string | getFilename (const boost::filesystem::path &path) |
|
std::string | getFilename (const std::string &pathString) |
|
std::string | getBasename (const boost::filesystem::path &path) |
|
std::string | getPathString (const boost::filesystem::path &path) |
|
std::string | getNativePathString (const boost::filesystem::path &path) |
|
CNOID_EXPORT void | makePathCompact (const boost::filesystem::path &path, boost::filesystem::path &out_compact) |
|
CNOID_EXPORT int | findSubDirectory (const boost::filesystem::path &directory, const boost::filesystem::path &path, boost::filesystem::path &out_subdirectory) |
|
CNOID_EXPORT bool | findRelativePath (const boost::filesystem::path &from, const boost::filesystem::path &to, boost::filesystem::path &out_relativePath) |
|
template<class T > |
void | setGaussWindow (T sigma, int range, std::vector< T > &out_window) |
|
template<class RESULTVECTOR , class SRCVECTOR , class ELEMENT , class T > |
void | applyGaussianFilter (RESULTVECTOR &result, const SRCVECTOR &src, std::vector< T > &gwin, ELEMENT zero) |
|
template<class RESULTVECTOR , class SRCVECTOR , class ELEMENT , class T > |
void | applyGaussianFilter (RESULTVECTOR &result, const SRCVECTOR &src, T sigma, int range, ELEMENT zero) |
|
boost::format | fmt (const char *f_string) |
|
boost::format | fmt (const std::string &f_string) |
|
const char * | getText (const char *domainname, const char *msgid) |
|
CNOID_EXPORT void | bindGettextDomain (const char *domainname) |
|
std::ostream & | nullout () |
|
CNOID_EXPORT void | loadPCD (SgPointSet *out_pointSet, const std::string &filename) |
|
CNOID_EXPORT void | savePCD (SgPointSet *pointSet, const std::string &filename, const Affine3d &viewpoint=Affine3d::Identity()) |
|
template<class T , class U > |
bool | operator== (ref_ptr< T > const &a, ref_ptr< U > const &b) |
|
template<class T , class U > |
bool | operator!= (ref_ptr< T > const &a, ref_ptr< U > const &b) |
|
template<class T , class U > |
bool | operator== (ref_ptr< T > const &a, U *b) |
|
template<class T , class U > |
bool | operator!= (ref_ptr< T > const &a, U *b) |
|
template<class T , class U > |
bool | operator== (T *a, ref_ptr< U > const &b) |
|
template<class T , class U > |
bool | operator!= (T *a, ref_ptr< U > const &b) |
|
template<class T > |
bool | operator< (ref_ptr< T > const &a, ref_ptr< T > const &b) |
|
template<class T > |
void | swap (ref_ptr< T > &lhs, ref_ptr< T > &rhs) |
|
template<class T , class U > |
ref_ptr< T > | static_pointer_cast (ref_ptr< U > const &p) |
|
template<class T , class U > |
ref_ptr< T > | const_pointer_cast (ref_ptr< U > const &p) |
|
template<class T , class U > |
ref_ptr< T > | dynamic_pointer_cast (ref_ptr< U > const &p) |
|
template<class Y > |
std::ostream & | operator<< (std::ostream &os, ref_ptr< Y > const &p) |
|
template<class T , class U > |
bool | operator< (weak_ref_ptr< T > const &a, weak_ref_ptr< U > const &b) |
|
template<class T > |
void | swap (weak_ref_ptr< T > &a, weak_ref_ptr< T > &b) |
|
CNOID_EXPORT Affine3 | calcTotalTransform (const SgNodePath &path) |
|
CNOID_EXPORT Affine3 | calcTotalTransform (const SgNodePath &path, const SgNode *targetNode) |
|
CNOID_EXPORT Affine3 | calcTotalTransform (SgNodePath::const_iterator begin, SgNodePath::const_iterator end) |
|
CNOID_EXPORT int | makeTransparent (SgNode *topNode, float transparency, SgCloneMap &cloneMap, bool doKeepOrgTransparency=true) |
|
void | msleep (int msec) |
|
void | usleep (int usec) |
|
const std::string & | toUTF8 (const std::string &text) |
|
const std::string & | fromUTF8 (const std::string &text) |
|
const std::string | toUTF8 (const char *text) |
|
const std::string | fromUTF8 (const char *text) |
|
template<> |
std::string | ValueNode::to< std::string > () const |
|
template<class Container > |
bool | writeElements (Mapping &mapping, const std::string &key, const Container &elements, bool isFlowStyle=false) |
|
template<class Container > |
bool | readElements (const Mapping &mapping, const std::string &key, Container &elements) |
|
void | intrusive_ptr_add_ref (VRMLNode *obj) |
|
void | intrusive_ptr_release (VRMLNode *obj) |
|
CNOID_EXPORT const char * | labelOfVRMLfieldTypeId (const std::type_info &fieldType) |
|
template<typename TValue > |
const char * | labelOfVRMLfieldType () |
|
template<class VRMLNodeType > |
boost::intrusive_ptr< VRMLNodeType > | dynamic_node_cast (VRMLNodePtr node) |
|
std::ostream & | operator<< (std::ostream &out, TIndent &indent) |
|
const char * | boolstr (bool v) |
|
std::ostream & | operator<< (std::ostream &out, const SFVec2f &v) |
|
std::ostream & | operator<< (std::ostream &out, const SFVec3f &v) |
|
std::ostream & | operator<< (std::ostream &out, const SFColor &v) |
|
std::ostream & | operator<< (std::ostream &out, const SFRotation &v) |
|
CNOID_EXPORT SignalProxy< void()> | sigAboutToQuit () |
|
bool | findSubDirectoryOfDirectoryVariable (ArchiveSharedData *shared, const filesystem::path &path, std::string &out_varName, filesystem::path &out_relativePath) |
|
void | replaceDirectoryVariable (ArchiveSharedData *shared, QString &io_pathString, const QString &varname, int pos, int len) |
|
CNOID_EXPORT std::ostream & | mvout (bool doFlush=false) |
|
QString | makeFilterString (const std::string &caption, const std::string &extensions_) |
|
std::string | getOpenFileName (const std::string &caption, const std::string &extensions) |
|
std::vector< std::string > | getOpenFileNames (const std::string &caption, const std::string &extensions) |
|
CNOID_EXPORT void | callLater (const boost::function< void()> &function, int priority=LazyCaller::PRIORITY_NORMAL) |
|
CNOID_EXPORT void | callFromMainThread (const boost::function< void()> &function, int priority=LazyCaller::PRIORITY_NORMAL) |
|
CNOID_EXPORT bool | callSynchronously (const boost::function< void()> &function, int priority=LazyCaller::PRIORITY_NORMAL) |
|
CNOID_EXPORT bool | isRunningInMainThread () |
|
const char * | LGPLtext () |
|
CNOID_EXPORT void | showMessageBox (const std::string &message) |
|
CNOID_EXPORT void | showMessageBox (const boost::format &message) |
|
CNOID_EXPORT void | showMessageBox (const char *message) |
|
CNOID_EXPORT void | showMessageBox (const QString &message) |
|
CNOID_EXPORT void | showWarningDialog (const std::string &message) |
|
CNOID_EXPORT void | showWarningDialog (const boost::format &message) |
|
CNOID_EXPORT void | showWarningDialog (const char *message) |
|
CNOID_EXPORT void | showWarningDialog (const QString &message) |
|
CNOID_EXPORT bool | showConfirmDialog (const char *caption, const char *message) |
|
CNOID_EXPORT bool | showConfirmDialog (const std::string &caption, const std::string &message) |
|
CNOID_EXPORT bool | showConfirmDialog (const QString &caption, const QString &message) |
|
template<class ValueType > |
ChangeProperty< ValueType > | changeProperty (ValueType &variable) |
|
CNOID_EXPORT int | addBodyToCollisionDetector (Body &body, CollisionDetector &detector, bool enableSelfCollisions=true) |
|
CNOID_EXPORT int | loadBodyCustomizers (const std::string pathString, BodyInterface *bodyInterface) |
|
CNOID_EXPORT int | loadBodyCustomizers (const std::string pathString) |
|
CNOID_EXPORT int | loadBodyCustomizers (BodyInterface *bodyInterface) |
|
CNOID_EXPORT int | loadBodyCustomizers () |
|
CNOID_EXPORT BodyCustomizerInterface * | findBodyCustomizer (std::string modelName) |
|
BodyMotion::Frame | operator<< (BodyMotion::Frame frame, const Body &body) |
|
const Body & | operator>> (const Body &body, BodyMotion::Frame frame) |
|
BodyMotion::Frame | operator>> (BodyMotion::Frame frame, Body &body) |
|
BodyMotion::ConstFrame | operator>> (BodyMotion::ConstFrame frame, Body &body) |
|
Body & | operator<< (Body &body, BodyMotion::Frame frame) |
|
Body & | operator<< (Body &body, BodyMotion::ConstFrame frame) |
|
CNOID_EXPORT bool | loadHrpsysSeqFileSet (BodyMotion &motion, const std::string &filename, std::ostream &os) |
|
CNOID_EXPORT bool | saveHrpsysSeqFileSet (BodyMotion &motion, Body *body, const std::string &filename, std::ostream &os) |
|
CNOID_EXPORT void | calcLinkAccSeq (MultiSE3Seq &linkPosSeq, AccelerationSensor *gsens, int frameBegin, int numFrames, Vector3Seq &out_accSeq) |
|
CNOID_EXPORT bool | applyVelocityLimitFilter (MultiValueSeq &seq, Body *body, std::ostream &os=nullout()) |
|
CNOID_EXPORT bool | applyVelocityLimitFilter2 (MultiValueSeq &seq, int part, double absLimit) |
|
CNOID_EXPORT bool | applyVelocityLimitFilterDummy () |
|
CNOID_EXPORT bool | applyPollardVelocityLimitFilter (MultiValueSeq &seq, Body *body, double ks, std::ostream &os=nullout()) |
|
CNOID_EXPORT void | applyGaussianFilter (MultiValueSeq &seq, double sigma, int range, std::ostream &os=nullout()) |
|
CNOID_EXPORT void | applyRangeLimitFilter (MultiValueSeq &seq, Body *body, double limitGrad, double edgeGradRatio, double margin, std::ostream &os=nullout()) |
|
Vector6 | calcInverseDynamics (Link *link) |
|
void | calcCMJacobian (Body *body, Link *base, Eigen::MatrixXd &J) |
| compute CoM Jacobian More...
|
|
void | calcAngularMomentumJacobian (Body *body, Link *base, Eigen::MatrixXd &H) |
| compute Angular Momentum Jacobian More...
|
|
template<int elementMask, int rowOffset, int colOffset, bool useTargetLinkLocalPos> |
void | setJacobian (const JointPath &path, Link *targetLink, const Vector3 &targetLinkLocalPos, MatrixXd &out_J) |
|
template<int elementMask, int rowOffset, int colOffset> |
void | setJacobian (const JointPath &path, Link *targetLink, MatrixXd &out_J) |
|
CNOID_EXPORT JointPathPtr | getCustomJointPath (Body *body, Link *baseLink, Link *targetLink) |
|
LeggedBodyHelper * | getLeggedBodyHelper (Body *body) |
|
void | calcMassMatrix (Body *body, const Vector3 &g, Eigen::MatrixXd &out_M) |
|
void | calcMassMatrix (const BodyPtr &body, MatrixXd &out_M) |
|
CNOID_EXPORT void | calcMassMatrix (Body *body, const Vector3 &g, MatrixXd &out_M) |
|
CNOID_EXPORT void | calcMassMatrix (Body *body, MatrixXd &out_M) |
|
CNOID_EXPORT MultiDeviceStateSeqPtr | getMultiDeviceStateSeq (const BodyMotion &motion) |
|
CNOID_EXPORT MultiDeviceStateSeqPtr | getOrCreateMultiDeviceStateSeq (BodyMotion &motion) |
|
CNOID_EXPORT void | clearMultiDeviceStateSeq (BodyMotion &motion) |
|
CNOID_EXPORT ZMPSeqPtr | getZMPSeq (const BodyMotion &motion) |
|
CNOID_EXPORT ZMPSeqPtr | getOrCreateZMPSeq (BodyMotion &motion) |
|
CNOID_EXPORT void | clearZMPSeq (BodyMotion &motion) |
|
CNOID_EXPORT bool | makeRootRelative (ZMPSeq &zmpseq, BodyMotion &motion, bool on) |
|
TimeSyncItemEngine * | createBodyMotionEngine (Item *sourceItem) |
|
void | initializeFilterDialogs (ExtensionManager &ext) |
|
void | initializeHrpsysFileIO (ExtensionManager *ext) |
|
void | initializeFcpFileLoader (ExtensionManager &ext) |
|
CNOID_EXPORT void | adjustStepPositions (PoseSeqPtr seq, const std::vector< int > &footLinkIndices, PoseSeq::iterator origin) |
|
CNOID_EXPORT void | flipPoses (PoseSeqPtr seq, BodyPtr body) |
|
CNOID_EXPORT void | adjustWaistHeight (PosePtr pose, int waistLinkIndex, const std::vector< int > &footLinkIndices, double offset) |
|
CNOID_EXPORT void | rotateYawOrientations (PoseSeqPtr seq, PoseSeq::iterator begin, const Vector3 ¢er, double angle) |
|
void | initializePoseSeqEngine (ExtensionManager *em) |
|
CNOID_EXPORT void | handlePythonException () |
|
CNOID_EXPORT boost::python::object | pythonMainModule () |
|
CNOID_EXPORT boost::python::object | pythonMainNamespace () |
|
CNOID_EXPORT boost::python::object | pythonSysModule () |
|
CNOID_EXPORT bool | execPythonCode (const std::string &code) |
|
CNOID_EXPORT bool | playAudioFile (const std::string &filename, double volumeRatio=-1.0) |
|
CNOID_EXPORT void | initializeCorbaUtil (bool activatePOAManager=false, int listeningPort=-1) |
|
CNOID_EXPORT void | initializeCorbaUtil (CORBA::ORB_ptr orb, bool activatePOAManager=false) |
|
CNOID_EXPORT CORBA::ORB_ptr | getORB () |
|
CNOID_EXPORT NamingContextHelper * | getDefaultNamingContextHelper () |
|
void | checkOrInvokeCorbaNameServer () |
|
bool | takeOverCorbaPluginInitialization (CORBA::ORB_ptr orb) |
|
template<> |
CORBA::Object::_ptr_type | findRTCService< CORBA::Object > (RTC::RTObject_ptr rtc, const std::string &name) |
|
CNOID_EXPORT RTM::Manager_ptr | getRTCManagerServant () |
|
CNOID_EXPORT RTC::RTObject_impl * | createManagedRTC (const char *comp_args) |
|
CNOID_EXPORT int | numUnmanagedRTCs () |
|
CNOID_EXPORT int | deleteUnmanagedRTCs () |
|
template<class ServiceType > |
ServiceType::_ptr_type | findRTCService (RTC::RTObject_ptr rtc, const std::string &name) |
|
template<> |
CNOID_EXPORT CORBA::Object::_ptr_type | findRTCService< CORBA::Object > (RTC::RTObject_ptr rtc, const std::string &name) |
|
CNOID_EXPORT bool | deleteRTC (RTC::RtcBase *rtc, bool waitToBeDeleted=true) |
|