Skip to content

Commit

Permalink
Merge pull request #1442 from tier4/feat/add-glog-simple-sensor-simul…
Browse files Browse the repository at this point in the history
…ator

Feat/add glog simple sensor simulator
  • Loading branch information
hakuturu583 authored Nov 27, 2024
2 parents 3987b52 + 8a6f26e commit 11bfb8d
Show file tree
Hide file tree
Showing 3 changed files with 7 additions and 0 deletions.
1 change: 1 addition & 0 deletions simulation/simple_sensor_simulator/CMakeLists.txt
Original file line number Diff line number Diff line change
Expand Up @@ -56,6 +56,7 @@ ament_auto_add_library(simple_sensor_simulator_component SHARED
src/vehicle_simulation/vehicle_model/sim_model_interface.cpp
)
target_link_libraries(simple_sensor_simulator_component
glog
pthread
sodium
zmq
Expand Down
1 change: 1 addition & 0 deletions simulation/simple_sensor_simulator/package.xml
Original file line number Diff line number Diff line change
Expand Up @@ -40,6 +40,7 @@
<depend>boost</depend>
<depend>eigen</depend>
<depend>embree_vendor</depend>
<depend>libgoogle-glog-dev</depend>
<depend>libpcl-all-dev</depend>
<depend>nav_msgs</depend>
<depend>pcl_conversions</depend>
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -12,13 +12,18 @@
// See the License for the specific language governing permissions and
// limitations under the License.

#include <glog/logging.h>

#include <memory>
#include <rclcpp/rclcpp.hpp>
#include <simple_sensor_simulator/simple_sensor_simulator.hpp>
#include <string>

int main(int argc, char * argv[])
{
google::InitGoogleLogging(argv[0]);
google::InstallFailureSignalHandler();

rclcpp::init(argc, argv);
rclcpp::NodeOptions options;
auto component = std::make_shared<simple_sensor_simulator::ScenarioSimulator>(options);
Expand Down

0 comments on commit 11bfb8d

Please sign in to comment.