Functions
camera_core.cpp File Reference
#include <gtest/gtest.h>
#include "camera_core.h"
#include <string>
#include <vector>
Include dependency graph for camera_core.cpp:

Go to the source code of this file.

Functions

void fillConfigMap (int argc, char **argv)
void getCameraInfo (rs_stream stream, const sensor_msgs::CameraInfoConstPtr &info_msg)
void getMsgInfo (rs_stream stream, const sensor_msgs::ImageConstPtr &msg)
void imageColorCallback (const sensor_msgs::ImageConstPtr &msg, const sensor_msgs::CameraInfoConstPtr &info_msg)
void imageDepthCallback (const sensor_msgs::ImageConstPtr &msg, const sensor_msgs::CameraInfoConstPtr &info_msg)
void imageFisheyeCallback (const sensor_msgs::ImageConstPtr &msg, const sensor_msgs::CameraInfoConstPtr &info_msg)
void imageInfrared1Callback (const sensor_msgs::ImageConstPtr &msg, const sensor_msgs::CameraInfoConstPtr &info_msg)
void imageInfrared2Callback (const sensor_msgs::ImageConstPtr &msg, const sensor_msgs::CameraInfoConstPtr &info_msg)
void imuCallback (const sensor_msgs::ImuConstPtr &imu)
int main (int argc, char **argv)
void pcCallback (const sensor_msgs::PointCloud2ConstPtr pc)
 TEST (RealsenseTests, testColorStream)
 TEST (RealsenseTests, testColorResolution)
 TEST (RealsenseTests, testColorCameraInfo)
 TEST (RealsenseTests, testIsDepthStreamEnabled)
 TEST (RealsenseTests, testDepthStream)
 TEST (RealsenseTests, testDepthResolution)
 TEST (RealsenseTests, testDepthCameraInfo)
 TEST (RealsenseTests, testInfrared1Stream)
 TEST (RealsenseTests, testInfrared1Resolution)
 TEST (RealsenseTests, testInfrared1CameraInfo)
 TEST (RealsenseTests, testInfrared2Stream)
 TEST (RealsenseTests, testInfrared2Resolution)
 TEST (RealsenseTests, testInfrared2CameraInfo)
 TEST (RealsenseTests, testFisheyeStream)
 TEST (RealsenseTests, testFisheyeCameraInfo)
 TEST (RealsenseTests, testImu)
 TEST (RealsenseTests, testPointCloud)
 TEST (RealsenseTests, testTransforms)
 TEST (RealsenseTests, testCameraOptions)
 TEST (RealsenseTests, testGetSettingsService)
 TEST (RealsenseTests, testSetPowerOffService)
 TEST (RealsenseTests, testSetPowerOnService)
 TEST (RealsenseTests, testForcePowerOffService)
 TEST (RealsenseTests, testIsPoweredService)
 TEST (RealsenseTests, testForcePowerOnService)

Function Documentation

void fillConfigMap ( int  argc,
char **  argv 
)

Definition at line 828 of file camera_core.cpp.

void getCameraInfo ( rs_stream  stream,
const sensor_msgs::CameraInfoConstPtr &  info_msg 
)

Definition at line 79 of file camera_core.cpp.

void getMsgInfo ( rs_stream  stream,
const sensor_msgs::ImageConstPtr &  msg 
)

Definition at line 71 of file camera_core.cpp.

void imageColorCallback ( const sensor_msgs::ImageConstPtr &  msg,
const sensor_msgs::CameraInfoConstPtr &  info_msg 
)

Definition at line 197 of file camera_core.cpp.

void imageDepthCallback ( const sensor_msgs::ImageConstPtr &  msg,
const sensor_msgs::CameraInfoConstPtr &  info_msg 
)

Definition at line 165 of file camera_core.cpp.

void imageFisheyeCallback ( const sensor_msgs::ImageConstPtr &  msg,
const sensor_msgs::CameraInfoConstPtr &  info_msg 
)

Definition at line 229 of file camera_core.cpp.

void imageInfrared1Callback ( const sensor_msgs::ImageConstPtr &  msg,
const sensor_msgs::CameraInfoConstPtr &  info_msg 
)

Definition at line 99 of file camera_core.cpp.

void imageInfrared2Callback ( const sensor_msgs::ImageConstPtr &  msg,
const sensor_msgs::CameraInfoConstPtr &  info_msg 
)

Definition at line 132 of file camera_core.cpp.

void imuCallback ( const sensor_msgs::ImuConstPtr &  imu)

Definition at line 262 of file camera_core.cpp.

int main ( int  argc,
char **  argv 
)

Definition at line 996 of file camera_core.cpp.

void pcCallback ( const sensor_msgs::PointCloud2ConstPtr  pc)

Definition at line 285 of file camera_core.cpp.

TEST ( RealsenseTests  ,
testColorStream   
)

Definition at line 310 of file camera_core.cpp.

TEST ( RealsenseTests  ,
testColorResolution   
)

Definition at line 332 of file camera_core.cpp.

TEST ( RealsenseTests  ,
testColorCameraInfo   
)

Definition at line 347 of file camera_core.cpp.

TEST ( RealsenseTests  ,
testIsDepthStreamEnabled   
)

Definition at line 392 of file camera_core.cpp.

TEST ( RealsenseTests  ,
testDepthStream   
)

Definition at line 404 of file camera_core.cpp.

TEST ( RealsenseTests  ,
testDepthResolution   
)

Definition at line 426 of file camera_core.cpp.

TEST ( RealsenseTests  ,
testDepthCameraInfo   
)

Definition at line 441 of file camera_core.cpp.

TEST ( RealsenseTests  ,
testInfrared1Stream   
)

Definition at line 485 of file camera_core.cpp.

TEST ( RealsenseTests  ,
testInfrared1Resolution   
)

Definition at line 506 of file camera_core.cpp.

TEST ( RealsenseTests  ,
testInfrared1CameraInfo   
)

Definition at line 521 of file camera_core.cpp.

TEST ( RealsenseTests  ,
testInfrared2Stream   
)

Definition at line 565 of file camera_core.cpp.

TEST ( RealsenseTests  ,
testInfrared2Resolution   
)

Definition at line 582 of file camera_core.cpp.

TEST ( RealsenseTests  ,
testInfrared2CameraInfo   
)

Definition at line 601 of file camera_core.cpp.

TEST ( RealsenseTests  ,
testFisheyeStream   
)

Definition at line 635 of file camera_core.cpp.

TEST ( RealsenseTests  ,
testFisheyeCameraInfo   
)

Definition at line 649 of file camera_core.cpp.

TEST ( RealsenseTests  ,
testImu   
)

Definition at line 694 of file camera_core.cpp.

TEST ( RealsenseTests  ,
testPointCloud   
)

Definition at line 706 of file camera_core.cpp.

TEST ( RealsenseTests  ,
testTransforms   
)

Definition at line 720 of file camera_core.cpp.

TEST ( RealsenseTests  ,
testCameraOptions   
)

Definition at line 757 of file camera_core.cpp.

TEST ( RealsenseTests  ,
testGetSettingsService   
)

Definition at line 779 of file camera_core.cpp.

TEST ( RealsenseTests  ,
testSetPowerOffService   
)

Definition at line 785 of file camera_core.cpp.

TEST ( RealsenseTests  ,
testSetPowerOnService   
)

Definition at line 795 of file camera_core.cpp.

TEST ( RealsenseTests  ,
testForcePowerOffService   
)

Definition at line 805 of file camera_core.cpp.

TEST ( RealsenseTests  ,
testIsPoweredService   
)

Definition at line 813 of file camera_core.cpp.

TEST ( RealsenseTests  ,
testForcePowerOnService   
)

Definition at line 820 of file camera_core.cpp.



realsense_camera
Author(s): Rajvi Jingar , Reagan Lopez , Matt Hansen , Mark Horn
autogenerated on Thu Jun 6 2019 21:15:58