test_rviz_node.h
Go to the documentation of this file.
00001 /*
00002  * test_rviz_node.h
00003  *
00004  *  Created on: Nov 19, 2012
00005  *      Author: goa-sn
00006  */
00007 
00008 #ifndef TEST_RVIZ_NODE_H_
00009 #define TEST_RVIZ_NODE_H_
00010 /*
00011  * get_rviz_ogre_camera.h
00012  *
00013  *  Created on: Nov 16, 2012
00014  *      Author: goa-sn
00015  */
00016 
00017 #include <ros/ros.h>
00018 /*OGRE Includes*/
00019 #include <OGRE/OgreCamera.h>
00020 #include <OGRE/OgreVector3.h>
00021 #include <OGRE/OgreQuaternion.h>
00022 #include <OGRE/OgreSceneNode.h>
00023 #include <OGRE/OgreSceneManager.h>
00024 /*rviz Includes*/
00025 #include "rviz/view_controller.h"
00026 #include "rviz/visualization_manager.h"
00027 #include <rviz/render_panel.h>
00028 #include "rviz/display.h"
00029 #include <geometry_msgs/Pose.h>
00030 
00031 namespace rviz
00032 {
00033   class SceneNode;
00034 
00035   class TestRvizNode : public ViewController , public Display
00036   {
00037     public:
00038       TestRvizNode(VisualizationManager* manager, const std::string& name);
00039       ~TestRvizNode() {}
00040 
00041       void testFunc();
00042 
00043     protected:
00044       Ogre::SceneNode* scene_node_;                         
00045       //
00046       ros::Publisher cam_pose_pub_ ;
00047       ros::NodeHandle nh_ ;
00048 
00049   };
00050 }
00051 
00052 #endif /* TEST_RVIZ_NODE_H_ */


cob_3d_visualization
Author(s): Georg Arbeiter
autogenerated on Wed Aug 26 2015 11:04:10