#include <boost/format.hpp>#include "articulation_model_display.h"#include "rviz/display.h"#include "rviz/common.h"#include "rviz/properties/forwards.h"#include "rviz/helpers/color.h"#include <ros/ros.h>#include <string>#include <vector>#include <ostream>#include "ros/serialization.h"#include "ros/builtin_message_traits.h"#include "ros/message_operations.h"#include "ros/message.h"#include "ros/time.h"#include "std_msgs/Header.h"#include "articulation_msgs/TrackMsg.h"#include <boost/shared_ptr.hpp>#include <typeinfo>#include "generic_model.h"#include "articulation_msgs/ModelMsg.h"#include <message_filters/subscriber.h>#include <tf/message_filter.h>#include <tf/transform_listener.h>#include <ogre_tools/arrow.h>#include <ogre_tools/shape.h>#include <ogre_tools/billboard_line.h>#include <OGRE/OgreMovableObject.h>#include <OGRE/OgreRenderable.h>#include <OGRE/OgreVector3.h>#include <OGRE/OgreQuaternion.h>#include <OGRE/OgreSceneNode.h>#include <OGRE/OgreSceneManager.h>#include <boost/thread/mutex.hpp>#include "rviz/visualization_manager.h"#include "rviz/properties/property.h"#include "rviz/properties/property_manager.h"#include <ogre_tools/axes.h>#include "utils.h"#include "LinearMath/btTransform.h"#include "articulation_msgs/ParamMsg.h"#include "src/Core/util/DisableMSVCWarnings.h"#include "src/Core/util/Macros.h"#include <cerrno>#include <cstdlib>#include <cmath>#include <complex>#include <cassert>#include <functional>#include <iosfwd>#include <cstring>#include <limits>#include <climits>#include <algorithm>#include "src/Core/util/Constants.h"#include "src/Core/util/ForwardDeclarations.h"#include "src/Core/util/Meta.h"#include "src/Core/util/XprHelper.h"#include "src/Core/util/StaticAssert.h"#include "src/Core/util/Memory.h"#include "src/Core/NumTraits.h"#include "src/Core/MathFunctions.h"#include "src/Core/GenericPacketMath.h"#include "src/Core/arch/Default/Settings.h"#include "src/Core/Functors.h"#include "src/Core/DenseCoeffsBase.h"#include "src/Core/DenseBase.h"#include "src/Core/MatrixBase.h"#include "src/Core/EigenBase.h"#include "src/Core/Assign.h"#include "src/Core/util/BlasUtil.h"#include "src/Core/DenseStorage.h"#include "src/Core/NestByValue.h"#include "src/Core/ForceAlignedAccess.h"#include "src/Core/ReturnByValue.h"#include "src/Core/NoAlias.h"#include "src/Core/PlainObjectBase.h"#include "src/Core/Matrix.h"#include "src/Core/Array.h"#include "src/Core/CwiseBinaryOp.h"#include "src/Core/CwiseUnaryOp.h"#include "src/Core/CwiseNullaryOp.h"#include "src/Core/CwiseUnaryView.h"#include "src/Core/SelfCwiseBinaryOp.h"#include "src/Core/Dot.h"#include "src/Core/StableNorm.h"#include "src/Core/MapBase.h"#include "src/Core/Stride.h"#include "src/Core/Map.h"#include "src/Core/Block.h"#include "src/Core/VectorBlock.h"#include "src/Core/Transpose.h"#include "src/Core/DiagonalMatrix.h"#include "src/Core/Diagonal.h"#include "src/Core/DiagonalProduct.h"#include "src/Core/PermutationMatrix.h"#include "src/Core/Transpositions.h"#include "src/Core/Redux.h"#include "src/Core/Visitor.h"#include "src/Core/Fuzzy.h"#include "src/Core/IO.h"#include "src/Core/Swap.h"#include "src/Core/CommaInitializer.h"#include "src/Core/Flagged.h"#include "src/Core/ProductBase.h"#include "src/Core/Product.h"#include "src/Core/TriangularMatrix.h"#include "src/Core/SelfAdjointView.h"#include "src/Core/SolveTriangular.h"#include "src/Core/products/Parallelizer.h"#include "src/Core/products/CoeffBasedProduct.h"#include "src/Core/products/GeneralBlockPanelKernel.h"#include "src/Core/products/GeneralMatrixVector.h"#include "src/Core/products/GeneralMatrixMatrix.h"#include "src/Core/products/GeneralMatrixMatrixTriangular.h"#include "src/Core/products/SelfadjointMatrixVector.h"#include "src/Core/products/SelfadjointMatrixMatrix.h"#include "src/Core/products/SelfadjointProduct.h"#include "src/Core/products/SelfadjointRank2Update.h"#include "src/Core/products/TriangularMatrixVector.h"#include "src/Core/products/TriangularMatrixMatrix.h"#include "src/Core/products/TriangularSolverMatrix.h"#include "src/Core/products/TriangularSolverVector.h"#include "src/Core/BandMatrix.h"#include "src/Core/BooleanRedux.h"#include "src/Core/Select.h"#include "src/Core/VectorwiseOp.h"#include "src/Core/Random.h"#include "src/Core/Replicate.h"#include "src/Core/Reverse.h"#include "src/Core/ArrayBase.h"#include "src/Core/ArrayWrapper.h"#include "src/Core/GlobalFunctions.h"#include "src/Core/util/EnableMSVCWarnings.h"
Go to the source code of this file.
Namespaces | |
| namespace | articulation_rviz_plugin |