snapshotter_action.cpp File Reference

#include <ros/ros.h>
#include <actionlib/server/action_server.h>
#include <boost/thread.hpp>
#include <boost/shared_ptr.hpp>
#include <actionlib_msgs/GoalID.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 "actionlib_msgs/GoalStatus.h"
#include <sstream>
#include <actionlib/action_definition.h>
#include <actionlib/goal_id_generator.h>
#include <actionlib/server/status_tracker.h>
#include <boost/thread/condition.hpp>
#include <boost/thread/mutex.hpp>
#include <actionlib/destruction_guard.h>
#include <list>
#include "pr2_tilt_laser_interface/GetSnapshotActionGoal.h"
#include "pr2_tilt_laser_interface/GetSnapshotActionResult.h"
#include "pr2_tilt_laser_interface/GetSnapshotActionFeedback.h"
#include "ros/service_traits.h"
#include <map>
#include <iostream>
#include "boost/numeric/ublas/matrix.hpp"
#include <iomanip>
#include <cmath>
#include <stdexcept>
#include "geometry_msgs/Vector3.h"
#include "geometry_msgs/Quaternion.h"
#include "geometry_msgs/Point.h"
#include "btMatrix3x3.h"
#include "ros/console.h"
#include "tf/exceptions.h"
#include "LinearMath/btTransform.h"
#include <boost/signals.hpp>
#include "sensor_msgs/LaserScan.h"
#include "sensor_msgs/PointCloud.h"
#include "src/Core/util/DisableMSVCWarnings.h"
#include "src/Core/util/Macros.h"
#include <cerrno>
#include <cstdlib>
#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"
#include <sensor_msgs/PointCloud2.h>
#include <pcl/point_cloud.h>
#include <Eigen/Core>
#include <bitset>
#include "pcl/ros/point_traits.h"
#include <boost/mpl/vector.hpp>
#include <boost/mpl/for_each.hpp>
#include <boost/mpl/assert.hpp>
#include <boost/preprocessor/seq/enum.hpp>
#include <boost/preprocessor/seq/for_each.hpp>
#include <boost/preprocessor/seq/transform.hpp>
#include <boost/preprocessor/cat.hpp>
#include <boost/preprocessor/repetition/repeat_from_to.hpp>
#include <boost/type_traits/is_pod.hpp>
#include <stddef.h>
#include "pcl/win32_macros.h"
#include <math.h>
#include <Eigen/Geometry>
#include <tf/transform_datatypes.h>
#include "geometry_msgs/TransformStamped.h"
#include "tf/tf.h"
#include "ros/types.h"
#include <boost/thread/shared_mutex.hpp>
#include <boost/thread/condition_variable.hpp>
#include <boost/thread/tss.hpp>
#include <deque>
#include <tf/transform_listener.h>
#include <tf/tfMessage.h>
#include <boost/function.hpp>
#include <boost/bind.hpp>
#include <boost/weak_ptr.hpp>
#include <ros/callback_queue.h>
#include <boost/signals/connection.hpp>
#include <boost/noncopyable.hpp>
#include "connection.h"
#include "signal1.h"
#include <ros/message_event.h>
#include <ros/subscription_callback_helper.h>
#include "simple_filter.h"
#include <pcl/io/io.h>
This graph shows which files directly or indirectly include this file:

Go to the source code of this file.

Classes

class  Snapshotter

Namespaces

namespace  SnapshotStates

Typedefs

typedef
actionlib::ActionServer
< GetSnapshotAction
SnapshotActionServer
typedef
SnapshotStates::SnapshotState 
SnapshotState

Enumerations

enum  SnapshotStates::SnapshotState { SnapshotStates::COLLECTING = 1, SnapshotStates::IDLE = 2 }

Functions

void appendCloud (sensor_msgs::PointCloud2 &dest, const sensor_msgs::PointCloud2 &src)
int main (int argc, char **argv)

Typedef Documentation

typedef actionlib::ActionServer<GetSnapshotAction> SnapshotActionServer

Definition at line 88 of file snapshotter_action.cpp.

Definition at line 86 of file snapshotter_action.cpp.


Function Documentation

void appendCloud ( sensor_msgs::PointCloud2 &  dest,
const sensor_msgs::PointCloud2 &  src 
)

Definition at line 49 of file snapshotter_action.cpp.

int main ( int  argc,
char **  argv 
)

Definition at line 311 of file snapshotter_action.cpp.

 All Classes Namespaces Files Functions Variables Typedefs Enumerations Enumerator


pr2_tilt_laser_interface
Author(s): Radu Rusu, Wim Meeussen, Vijay Pradeep
autogenerated on Fri Jan 11 10:07:18 2013