#include <gazebo_ros_camera_utils.h>
Definition at line 56 of file gazebo_ros_camera_utils.h.
◆ GazeboRosCameraUtils()
gazebo::GazeboRosCameraUtils::GazeboRosCameraUtils |
( |
| ) |
|
◆ ~GazeboRosCameraUtils()
gazebo::GazeboRosCameraUtils::~GazeboRosCameraUtils |
( |
| ) |
|
◆ CameraQueueThread()
void gazebo::GazeboRosCameraUtils::CameraQueueThread |
( |
| ) |
|
|
protected |
◆ CanTriggerCamera()
bool gazebo::GazeboRosCameraUtils::CanTriggerCamera |
( |
| ) |
|
|
protectedvirtual |
◆ configCallback()
void gazebo::GazeboRosCameraUtils::configCallback |
( |
gazebo_plugins::GazeboRosCameraConfig & |
config, |
|
|
uint32_t |
level |
|
) |
| |
|
private |
◆ ImageConnect()
void gazebo::GazeboRosCameraUtils::ImageConnect |
( |
| ) |
|
|
protected |
◆ ImageDisconnect()
void gazebo::GazeboRosCameraUtils::ImageDisconnect |
( |
| ) |
|
|
protected |
◆ InfoConnect()
void gazebo::GazeboRosCameraUtils::InfoConnect |
( |
| ) |
|
|
private |
Keep track of number of connctions for CameraInfo.
◆ InfoDisconnect()
void gazebo::GazeboRosCameraUtils::InfoDisconnect |
( |
| ) |
|
|
private |
◆ Init()
void gazebo::GazeboRosCameraUtils::Init |
( |
| ) |
|
|
private |
◆ Load() [1/2]
void gazebo::GazeboRosCameraUtils::Load |
( |
sensors::SensorPtr |
_parent, |
|
|
sdf::ElementPtr |
_sdf, |
|
|
const std::string & |
_camera_name_suffix, |
|
|
double |
_hack_baseline |
|
) |
| |
Load the plugin.
- Parameters
-
[in] | _parent | Take in SDF root element. |
[in] | _sdf | SDF values. |
[in] | _camera_name_suffix | Suffix of the camera name. |
[in] | _hack_baseline | Multiple camera baseline. |
Definition at line 86 of file gazebo_ros_camera_utils.cpp.
◆ Load() [2/2]
void gazebo::GazeboRosCameraUtils::Load |
( |
sensors::SensorPtr |
_parent, |
|
|
sdf::ElementPtr |
_sdf, |
|
|
const std::string & |
_camera_name_suffix = "" |
|
) |
| |
Load the plugin.
- Parameters
-
[in] | _parent | Take in SDF root element. |
[in] | _sdf | SDF values. |
[in] | _camera_name_suffix | required before calling LoadThread |
Definition at line 104 of file gazebo_ros_camera_utils.cpp.
◆ LoadThread()
void gazebo::GazeboRosCameraUtils::LoadThread |
( |
| ) |
|
|
private |
◆ OnLoad()
event::ConnectionPtr gazebo::GazeboRosCameraUtils::OnLoad |
( |
const boost::function< void()> & |
load_function | ) |
|
◆ PublishCameraInfo() [1/3]
void gazebo::GazeboRosCameraUtils::PublishCameraInfo |
( |
| ) |
|
|
protected |
◆ PublishCameraInfo() [2/3]
void gazebo::GazeboRosCameraUtils::PublishCameraInfo |
( |
common::Time & |
last_update_time | ) |
|
|
protected |
◆ PublishCameraInfo() [3/3]
void gazebo::GazeboRosCameraUtils::PublishCameraInfo |
( |
ros::Publisher |
camera_info_publisher | ) |
|
|
protected |
◆ PutCameraData() [1/2]
void gazebo::GazeboRosCameraUtils::PutCameraData |
( |
const unsigned char * |
_src | ) |
|
|
protected |
◆ PutCameraData() [2/2]
void gazebo::GazeboRosCameraUtils::PutCameraData |
( |
const unsigned char * |
_src, |
|
|
common::Time & |
last_update_time |
|
) |
| |
|
protected |
◆ SetHFOV()
void gazebo::GazeboRosCameraUtils::SetHFOV |
( |
const std_msgs::Float64::ConstPtr & |
hfov | ) |
|
|
private |
◆ SetUpdateRate()
void gazebo::GazeboRosCameraUtils::SetUpdateRate |
( |
const std_msgs::Float64::ConstPtr & |
update_rate | ) |
|
|
private |
◆ TriggerCamera()
void gazebo::GazeboRosCameraUtils::TriggerCamera |
( |
| ) |
|
|
protectedvirtual |
◆ TriggerCameraInternal()
void gazebo::GazeboRosCameraUtils::TriggerCameraInternal |
( |
const std_msgs::Empty::ConstPtr & |
dummy | ) |
|
|
private |
◆ GazeboRosMultiCamera
◆ GazeboRosTriggeredMultiCamera
◆ auto_distortion_
bool gazebo::GazeboRosCameraUtils::auto_distortion_ |
|
protected |
◆ border_crop_
bool gazebo::GazeboRosCameraUtils::border_crop_ |
|
protected |
◆ callback_queue_thread_
boost::thread gazebo::GazeboRosCameraUtils::callback_queue_thread_ |
|
protected |
◆ camera_
rendering::CameraPtr gazebo::GazeboRosCameraUtils::camera_ |
|
protected |
◆ camera_info_manager_
◆ camera_info_pub_
◆ camera_info_topic_name_
std::string gazebo::GazeboRosCameraUtils::camera_info_topic_name_ |
|
protected |
◆ camera_name_
std::string gazebo::GazeboRosCameraUtils::camera_name_ |
|
private |
◆ camera_queue_
◆ cameraHFOVSubscriber_
◆ cameraUpdateRateSubscriber_
◆ cx_
double gazebo::GazeboRosCameraUtils::cx_ |
|
protected |
◆ cx_prime_
double gazebo::GazeboRosCameraUtils::cx_prime_ |
|
protected |
◆ cy_
double gazebo::GazeboRosCameraUtils::cy_ |
|
protected |
◆ deferred_load_thread_
boost::thread gazebo::GazeboRosCameraUtils::deferred_load_thread_ |
|
private |
◆ depth_
unsigned int gazebo::GazeboRosCameraUtils::depth_ |
|
protected |
◆ distortion_k1_
double gazebo::GazeboRosCameraUtils::distortion_k1_ |
|
protected |
◆ distortion_k2_
double gazebo::GazeboRosCameraUtils::distortion_k2_ |
|
protected |
◆ distortion_k3_
double gazebo::GazeboRosCameraUtils::distortion_k3_ |
|
protected |
◆ distortion_t1_
double gazebo::GazeboRosCameraUtils::distortion_t1_ |
|
protected |
◆ distortion_t2_
double gazebo::GazeboRosCameraUtils::distortion_t2_ |
|
protected |
◆ dyn_srv_
dynamic_reconfigure::Server<gazebo_plugins::GazeboRosCameraConfig>* gazebo::GazeboRosCameraUtils::dyn_srv_ |
|
private |
◆ focal_length_
double gazebo::GazeboRosCameraUtils::focal_length_ |
|
protected |
◆ format_
std::string gazebo::GazeboRosCameraUtils::format_ |
|
protected |
◆ frame_name_
std::string gazebo::GazeboRosCameraUtils::frame_name_ |
|
protected |
ROS frame transform name to use in the image message header. This should typically match the link name the sensor is attached.
Definition at line 142 of file gazebo_ros_camera_utils.h.
◆ hack_baseline_
double gazebo::GazeboRosCameraUtils::hack_baseline_ |
|
protected |
◆ height_
unsigned int gazebo::GazeboRosCameraUtils::height_ |
|
protected |
◆ image_connect_count_
◆ image_connect_count_lock_
boost::shared_ptr<boost::mutex> gazebo::GazeboRosCameraUtils::image_connect_count_lock_ |
|
protected |
◆ image_msg_
sensor_msgs::Image gazebo::GazeboRosCameraUtils::image_msg_ |
|
protected |
◆ image_pub_
◆ image_topic_name_
std::string gazebo::GazeboRosCameraUtils::image_topic_name_ |
|
protected |
◆ initialized_
bool gazebo::GazeboRosCameraUtils::initialized_ |
|
protected |
◆ itnode_
◆ last_info_update_time_
common::Time gazebo::GazeboRosCameraUtils::last_info_update_time_ |
|
protected |
◆ last_update_time_
common::Time gazebo::GazeboRosCameraUtils::last_update_time_ |
|
protected |
◆ load_event_
event::EventT<void()> gazebo::GazeboRosCameraUtils::load_event_ |
|
private |
◆ lock_
boost::mutex gazebo::GazeboRosCameraUtils::lock_ |
|
protected |
◆ newFrameConnection_
◆ parentSensor_
sensors::SensorPtr gazebo::GazeboRosCameraUtils::parentSensor_ |
|
protected |
◆ robot_namespace_
std::string gazebo::GazeboRosCameraUtils::robot_namespace_ |
|
private |
◆ rosnode_
◆ sdf
sdf::ElementPtr gazebo::GazeboRosCameraUtils::sdf |
|
private |
◆ sensor_update_time_
common::Time gazebo::GazeboRosCameraUtils::sensor_update_time_ |
|
protected |
◆ skip_
int gazebo::GazeboRosCameraUtils::skip_ |
|
protected |
◆ tf_prefix_
std::string gazebo::GazeboRosCameraUtils::tf_prefix_ |
|
private |
◆ trigger_subscriber_
◆ trigger_topic_name_
std::string gazebo::GazeboRosCameraUtils::trigger_topic_name_ |
|
protected |
◆ type_
std::string gazebo::GazeboRosCameraUtils::type_ |
|
protected |
◆ update_period_
double gazebo::GazeboRosCameraUtils::update_period_ |
|
protected |
◆ update_rate_
double gazebo::GazeboRosCameraUtils::update_rate_ |
|
protected |
◆ was_active_
Keep track when we activate this camera through ros subscription, was it already active? resume state when unsubscribed.
Definition at line 101 of file gazebo_ros_camera_utils.h.
◆ width_
unsigned int gazebo::GazeboRosCameraUtils::width_ |
|
protected |
◆ world
physics::WorldPtr gazebo::GazeboRosCameraUtils::world |
|
protected |
◆ world_
physics::WorldPtr gazebo::GazeboRosCameraUtils::world_ |
|
protected |
The documentation for this class was generated from the following files: